Skip to content

Commit

Permalink
Fix formatting errors
Browse files Browse the repository at this point in the history
  • Loading branch information
tylerjw committed Mar 20, 2021
1 parent c5f031e commit a6e1451
Show file tree
Hide file tree
Showing 26 changed files with 63 additions and 65 deletions.
4 changes: 2 additions & 2 deletions CODE_OF_CONDUCT.md
Original file line number Diff line number Diff line change
Expand Up @@ -2,11 +2,11 @@

Like the technical community as a whole, the MoveIt team and community is made up of a mixture of professionals and volunteers from all over the world, working on every aspect of the mission - including mentorship, teaching, and connecting people.

Diversity is one of our huge strengths, but it can also lead to communication issues and unhappiness. To that end, we have a few basic rules that we ask people to adhere to. This code applies equally to maintainers, contributors, and those seeking help and guidance.
Diversity is one of our huge strengths, but it can also lead to communication issues and unhappiness. To that end, we have a few basic rules that we ask people to adhere to. This code applies equally to maintainers, contributors, and those seeking help and guidance.
It applies to all kinds of communication, including discussions on GitHub (issue tracker, pull requests), MoveIt maintainer meetings and any other forums created by the project team, which the community uses for communication.

- **Be friendly and patient.**
- **Be welcoming.** We strive to be a community that welcomes and supports people of all backgrounds and identities.
- **Be welcoming.** We strive to be a community that welcomes and supports people of all backgrounds and identities.
- **Be considerate.** Your work will be used by other people, and you in turn will depend on the work of others. Any decision you take will affect users and colleagues, and you should take those consequences into account when making decisions. Remember that we're a world-wide community, so you might not be communicating in someone else's primary language.
- **Be respectful.** Not all of us will agree all the time, but disagreement is no excuse for poor behavior and poor manners. We might all experience some frustration now and then, but we cannot allow that frustration to turn into a personal attack. It's important to remember that a community where people feel uncomfortable or threatened is not a productive one. Members of the MoveIt community should be respectful when dealing with other members as well as with people outside the MoveIt community.
- **Be careful in the words that you choose.** We are a community of professionals, and we conduct ourselves professionally. Be kind to others. Do not insult or put down other participants. Harassment and other exclusionary behavior aren't acceptable. Treat others like you want to be treated.
Expand Down
14 changes: 7 additions & 7 deletions doc/MIGRATION_GUIDE.md
Original file line number Diff line number Diff line change
Expand Up @@ -10,23 +10,23 @@ This leads to the following basic migration steps:
1. Replace `LOGNAME` with `rclcpp::Logger` instance:

<b>Old:</b>

constexpr char LOGNAME[] = "logger_name";

<b>New:</b>

static const rclcpp::Logger LOGGER = rclcpp::get_logger("logger_name");

2. Replace logging macros:

<b>Old:</b>

ROS_INFO_NAMED(LOGNAME, "Very important info message");

<b>New:</b>

RCLCPP_INFO(LOGGER, "Very important info message");

### Logger naming convention

Migrating the loggers is a good opportunity to make logger names more consistent.
Expand Down
8 changes: 4 additions & 4 deletions moveit_demo_nodes/run_move_group/README.md
Original file line number Diff line number Diff line change
Expand Up @@ -3,14 +3,14 @@
# MoveIt 2 Beta - MoveGroup Demo

This demo includes a launch configuration for running MoveGroup and a separate MoveGroupInterface demo node.

The MoveGroup setup can be started using the launch file `run_move_group.launch.py`:

ros2 launch run_move_group run_move_group.launch.py

This allows you to start planning and executing motions using the RViz MotionPlanning display.
The MoveGroupInterface demo can be started by additionally running:

ros2 launch run_move_group run_move_group_interface.launch.py

This will open an interactive xterm that will prompt for user input for running consecutive planning/execution steps.
8 changes: 4 additions & 4 deletions moveit_demo_nodes/run_moveit_cpp/README.md
Original file line number Diff line number Diff line change
Expand Up @@ -15,12 +15,12 @@ There are two options and launch files for simulating the robot controllers (the

1. ros2_control using a fake_joint driver: `run_moveit_cpp.launch.py`
1. MoveIt's fake controller: `run_moveit_cpp_fake_controller.launch.py`

## Running the Demo

The demo can be run using the launch files `run_moveit_cpp.launch.py` or `run_moveit_cpp_fake_controller.launch.py`:

ros2 launch run_moveit_cpp run_moveit_cpp.launch.py

The demo launches the RViz GUI and demonstrates planning and execution of a simple collision-free motion plan with the panda robot.
This involves a big range of functioning components: IK solver and collision checking plugins, `PlanningScene`, `RobotModel`, `PlanningPipeline` including adapters, OMPL planner and RViz visualization (`Trajectory` and `PlanningScene` displays).
4 changes: 2 additions & 2 deletions moveit_demo_nodes/run_moveit_cpp/config/moveit_cpp.yaml
Original file line number Diff line number Diff line change
Expand Up @@ -8,11 +8,11 @@ run_moveit_cpp:
publish_planning_scene_topic: "/moveit_cpp/publish_planning_scene"
monitored_planning_scene_topic: "/moveit_cpp/monitored_planning_scene"
wait_for_initial_state_timeout: 10.0

planning_pipelines:
#namespace: "moveit_cpp" # optional, default is ~
pipeline_names: ["ompl"]

plan_request_params:
planning_attempts: 10
planning_pipeline: ompl
Expand Down
12 changes: 6 additions & 6 deletions moveit_demo_nodes/run_ompl_constrained_planning/README.md
Original file line number Diff line number Diff line change
Expand Up @@ -2,8 +2,8 @@

# MoveIt 2 Beta - OMPL Constrained Planning Demo
## Setup
Before running the demo add the following lines to `ompl_planning.yaml` in the `panda_config` package
bellow `panda_arm:`
Before running the demo add the following lines to `ompl_planning.yaml` in the `panda_config` package
bellow `panda_arm:`

```
enforce_constrained_state_space: true
Expand All @@ -13,11 +13,11 @@ projection_evaluator: joints(panda_joint1,panda_joint2)
## Running
This demo includes a launch configuration for running MoveGroup and a separate demo node.

- Note: This demo shows how to construct a variety of
- Note: This demo shows how to construct a variety of
constraints. See [util.cpp](https://github.com/ros-planning/moveit2/blob/main/moveit_core/kinematic_constraints/src/utils.cpp) for helper functions to automate constructing the constraint messages.

The MoveGroup setup can be started:
```
```
ros2 launch run_ompl_constrained_planning run_move_group.launch.py
```

Expand All @@ -26,7 +26,7 @@ This allows you to start planning and executing motions:
ros2 launch run_move_group run_move_group_interface.launch.py
```

## Details
## Details
### State space selection process
There are three options for state space selection.

Expand Down
4 changes: 2 additions & 2 deletions moveit_experimental/collision_distance_field_ros/mainpage.dox
Original file line number Diff line number Diff line change
Expand Up @@ -2,9 +2,9 @@
\mainpage
\htmlinclude manifest.html

\b collision_distance_field_ros
\b collision_distance_field_ros

<!--
<!--
Provide an overview of your package.
-->

Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -2,9 +2,9 @@
\mainpage
\htmlinclude manifest.html

\b kinematics_cache
\b kinematics_cache

<!--
<!--
Provide an overview of your package.
-->

Expand Down
6 changes: 3 additions & 3 deletions moveit_planners/pilz_industrial_motion_planner/doc/.gitignore
Original file line number Diff line number Diff line change
Expand Up @@ -4,9 +4,9 @@
*.dvi
*.log
*.ps
*.tps
*.fdb_latexmk
*.fls
*.tps
*.fdb_latexmk
*.fls
*.out
*.synctex.gz
*.pdf
Original file line number Diff line number Diff line change
Expand Up @@ -88,21 +88,21 @@ \section{Blending the orientation}
\caption{Motion blend case 1: $T_s = 6s$, blending starts at 3.5s, ends at 8s. The resulted blending trajectory comes to a stop in the middle.}%
\label{blend_case_1}%
\end{subfigure}

\begin{subfigure}[ht]{0.8\textwidth}%
\centering
\includegraphics[width=0.8\columnwidth]{figure/blend_case_2.eps}%
\caption{Motion blend case 2: $T_s = 3.5s$, blending starts at 3.5s, ends at 5.5s. The resulted blending trajectory smoothly transits from first trajectory to the second trajectory. The velocity profile has no jumps.}%
\label{blend_case_2}%
\end{subfigure}

\begin{subfigure}[ht]{0.8\textwidth}%
\centering
\includegraphics[width=0.8\columnwidth]{figure/blend_case_3.eps}%
\caption{Motion blend case 3: $T_s = 4.5s$, blending starts at 3.5s, ends at 6.5s. The resulted blending trajectory smoothly transits from first trajectory to the second trajectory. The velocity profile has no jumps.}%
\label{blend_case_3}%
\end{subfigure}

\end{figure}


Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -39,5 +39,5 @@
<group ns="$(arg robot_description)_kinematics">
<rosparam command="load" file="$(find moveit_resources_prbt_moveit_config)/config/kinematics.yaml"/>
</group>

</launch>
Original file line number Diff line number Diff line change
Expand Up @@ -32,7 +32,7 @@
<w>470</w>
<h>80</h>
</coordinates>
<panel_attributes>template=ConfigType&gt;
<panel_attributes>template=ConfigType&gt;
CircAuxiliary
{abstract}
--
Expand All @@ -47,7 +47,7 @@ CircAuxiliary
<w>230</w>
<h>50</h>
</coordinates>
<panel_attributes>template=ConfigType, Builder&gt;
<panel_attributes>template=ConfigType, Builder&gt;
Center</panel_attributes>
<additional_attributes/>
</element>
Expand All @@ -59,7 +59,7 @@ Center</panel_attributes>
<w>220</w>
<h>50</h>
</coordinates>
<panel_attributes>template=ConfigType, Builder&gt;
<panel_attributes>template=ConfigType, Builder&gt;
Interim</panel_attributes>
<additional_attributes/>
</element>
Expand Down Expand Up @@ -94,7 +94,7 @@ Interim</panel_attributes>
<h>130</h>
</coordinates>
<panel_attributes>lt=&lt;&lt;.
&lt;&lt;bind&gt;&gt;
&lt;&lt;bind&gt;&gt;
&lt;ConfigType-&gt;CartesianConfiguration&gt;
&lt;Builder-&gt;CartesianPathConstraintsBuilder&gt;</panel_attributes>
<additional_attributes>10.0;10.0;10.0;110.0</additional_attributes>
Expand Down Expand Up @@ -125,7 +125,7 @@ Interim</panel_attributes>



&lt;&lt;bind&gt;&gt;
&lt;&lt;bind&gt;&gt;
&lt;ConfigType-&gt;CartesianConfiguration&gt;
&lt;Builder-&gt;CartesianPathConstraintsBuilder&gt;</panel_attributes>
<additional_attributes>10.0;10.0;10.0;190.0</additional_attributes>
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -8,7 +8,7 @@
<w>560</w>
<h>150</h>
</coordinates>
<panel_attributes>template=StartType, GoalType
<panel_attributes>template=StartType, GoalType
BaseCommand
{abstract}
--
Expand All @@ -28,7 +28,7 @@ BaseCommand
<w>230</w>
<h>70</h>
</coordinates>
<panel_attributes>template=StartType, GoalType
<panel_attributes>template=StartType, GoalType
Ptp</panel_attributes>
<additional_attributes/>
</element>
Expand Down Expand Up @@ -62,7 +62,7 @@ Ptp</panel_attributes>
<w>230</w>
<h>70</h>
</coordinates>
<panel_attributes>template=StartType, GoalType
<panel_attributes>template=StartType, GoalType
Lin</panel_attributes>
<additional_attributes/>
</element>
Expand All @@ -74,7 +74,7 @@ Lin</panel_attributes>
<w>300</w>
<h>70</h>
</coordinates>
<panel_attributes>template=StartType, AuxiliaryType, GoalType
<panel_attributes>template=StartType, AuxiliaryType, GoalType
Circ</panel_attributes>
<additional_attributes/>
</element>
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -150,7 +150,7 @@ transparency=0</panel_attributes>
<h>48</h>
</coordinates>
<panel_attributes>lt=&lt;-
toRequest() :
toRequest() :
moveit_msgs::MotionPlanRequest</panel_attributes>
<additional_attributes>220.0;20.0;10.0;20.0</additional_attributes>
</element>
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -27,7 +27,7 @@ def load_yaml(package_name, file_path):
def generate_launch_description():

moveit_ros_benchmarks_yaml = load_yaml('moveit_ros_benchmarks', 'demo_panda_predefined_poses.yaml')
moveit_ros_benchmarks_config = { 'benchmark_config' : moveit_ros_benchmarks_yaml }
moveit_ros_benchmarks_config = { 'benchmark_config' : moveit_ros_benchmarks_yaml }

# Component yaml files are grouped in separate namespaces
robot_description_config = load_file('moveit_resources_panda_description', 'urdf/panda.urdf')
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -18,7 +18,7 @@ parameters:
predefined_poses: # List of named targets
- ready
- extended
planning_pipelines:
planning_pipelines:
pipelines: [pipeline1]
pipeline1:
name: ompl
Expand Down
8 changes: 4 additions & 4 deletions moveit_ros/benchmarks/scripts/moveit_benchmark_statistics.py
Original file line number Diff line number Diff line change
Expand Up @@ -355,7 +355,7 @@ def plotAttribute(cur, planners, attribute, typename):
measurementsPercentage = [sum(m) * 100. / len(m) for m in measurements]
ind = range(len(measurements))
plt.bar(ind, measurementsPercentage, width)
### uncommenting this line will remove the term 'kConfigDefault' from the labels for OMPL Solvers.
### uncommenting this line will remove the term 'kConfigDefault' from the labels for OMPL Solvers.
### Fits situations where you need more control in the plot, such as in an academic publication for example
#labels = [l.replace('kConfigDefault', '') for l in labels]

Expand All @@ -371,11 +371,11 @@ def plotAttribute(cur, planners, attribute, typename):

#xtickNames = plt.xticks(labels, rotation=30, fontsize=10)
#plt.subplots_adjust(bottom=0.3) # Squish the plot into the upper 2/3 of the page. Leave room for labels
### uncommenting this line will remove the term 'kConfigDefault' from the labels for OMPL Solvers.

### uncommenting this line will remove the term 'kConfigDefault' from the labels for OMPL Solvers.
### Fits situations where you need more control in the plot, such as in an academic publication for example
#labels = [l.replace('kConfigDefault', '') for l in labels]

xtickNames = plt.setp(ax,xticklabels=labels)
plt.setp(xtickNames, rotation=30, fontsize=8, ha='right')
for tick in ax.xaxis.get_major_ticks(): # shrink the font size of the x tick labels
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -65,7 +65,7 @@
Provide a ROS service that allows for clearing the octomap
</description>
</class>

<class name="move_group/TfPublisher" type="move_group::TfPublisher" base_class_type="move_group::MoveGroupCapability">
<description>
Provide a capability that publishes PlanningScene frames to the tf system
Expand Down
10 changes: 5 additions & 5 deletions moveit_ros/moveit_servo/doc/running_the_demos.md
Original file line number Diff line number Diff line change
Expand Up @@ -31,7 +31,7 @@ colcon build --event-handlers desktop_notification- status- --cmake-args -DCMAKE
```

## Cpp Interface Demo
The simplest demo is the C++ interface demo. In it, a simulated Panda arm is spawned and shown in Rviz, along with a collision object.
The simplest demo is the C++ interface demo. In it, a simulated Panda arm is spawned and shown in Rviz, along with a collision object.

First, a simple joint command is sent to the arm for a few seconds.

Expand All @@ -47,7 +47,7 @@ ros2 launch moveit_servo servo_cpp_interface_demo.launch.py
![Alt Text](Images/C%2B%2B_Interface_Demo.gif)

## Component Demo
`moveit_servo` is also offered as a composable node that may be run in a container with other components.
`moveit_servo` is also offered as a composable node that may be run in a container with other components.

This demo starts a `moveit_servo` instance in a container with the `tf` publisher. Commands may be sent to the arm by publishing to the `moveit_servo` input topics, and the `moveit_servo` behavior may be controlled by its offered services.

Expand All @@ -67,11 +67,11 @@ ros2 run moveit_servo fake_command_publisher
![Alt Text](Images/Servo_Component_Demo.gif)

## Teleoperation Demo
`moveit_servo` is a versatile tool for teleoperating a manipulator. Inputs can include generic `TwistStamped` or `JointJog` commands, collisions can be detected and avoided, and singular positions can be avoided.
`moveit_servo` is a versatile tool for teleoperating a manipulator. Inputs can include generic `TwistStamped` or `JointJog` commands, collisions can be detected and avoided, and singular positions can be avoided.

The teleoperation demo spawns a Panda arm and shows it in Rviz with a few simulated tables. Then it uses `moveit_servo` to control the arm following user inputs with a game controller.
The teleoperation demo spawns a Panda arm and shows it in Rviz with a few simulated tables. Then it uses `moveit_servo` to control the arm following user inputs with a game controller.

This demo was written for an Xbox 1 controller, but can easily be modified for any generic gamepad that works with the [Joy package](https://index.ros.org/p/joy/#foxy).
This demo was written for an Xbox 1 controller, but can easily be modified for any generic gamepad that works with the [Joy package](https://index.ros.org/p/joy/#foxy).

#### To run
Make sure your controller is plugged in and can be detected by `ros2 run joy joy_node`. Usually this happens automatically after plugging the controller in.
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -42,7 +42,7 @@ def generate_launch_description():
servo_params = { 'moveit_servo' : servo_yaml }

kinematics_yaml = load_yaml('moveit_resources_panda_moveit_config', 'config/kinematics.yaml')

#RViz
rviz_config_file = get_package_share_directory('moveit_servo') + "/config/demo_rviz_pose_tracking.rviz"
rviz_node = Node(package='rviz2',
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -17,4 +17,3 @@ fake_joint_driver_node:
- 0.0
- 1.1
- 0.785

Original file line number Diff line number Diff line change
Expand Up @@ -17,4 +17,3 @@ fake_joint_driver_node:
- 0.117
- 1.439
- -1.286

Loading

0 comments on commit a6e1451

Please sign in to comment.