Skip to content

Commit 378b3d6

Browse files
authored
Update instructions for Pilz tutorial (#796)
* Update instructions for Pilz tutorial * Small consistency change
1 parent a5e6ae0 commit 378b3d6

File tree

5 files changed

+11
-10
lines changed

5 files changed

+11
-10
lines changed

doc/how_to_guides/pilz_industrial_motion_planner/pilz_industrial_motion_planner.rst

Lines changed: 2 additions & 2 deletions
Original file line numberDiff line numberDiff line change
@@ -267,7 +267,7 @@ By running
267267

268268
::
269269

270-
ros2 launch moveit2_tutorials demo.launch.py rviz_config:=panda_hello_moveit.rviz
270+
ros2 launch moveit_resources_panda_moveit_config demo.launch.py
271271

272272
you can interact with the planner through the RViz MotionPlanning panel.
273273

@@ -280,7 +280,7 @@ To run this, execute the following commands in separate Terminals:
280280

281281
::
282282

283-
ros2 launch moveit2_tutorials demo.launch.py rviz_config:=panda_hello_moveit.rviz
283+
ros2 launch moveit_resources_panda_moveit_config demo.launch.py
284284
ros2 run moveit2_tutorials pilz_move_group
285285

286286

doc/how_to_guides/pilz_industrial_motion_planner/src/pilz_move_group.cpp

Lines changed: 2 additions & 2 deletions
Original file line numberDiff line numberDiff line change
@@ -9,7 +9,7 @@
99
* Pilz Example -- MoveGroup Interface
1010
*
1111
* To run this example, first run this launch file:
12-
* ros2 launch moveit2_tutorials demo.launch.py rviz_config:=panda_hello_moveit.rviz
12+
* ros2 launch moveit_resources_panda_moveit_config demo.launch.py
1313
*
1414
* For best results, hide the "MotionPlanning" widget in RViz.
1515
*
@@ -30,7 +30,7 @@ int main(int argc, char* argv[])
3030
auto spinner = std::thread([&executor]() { executor.spin(); });
3131

3232
// Create a ROS logger
33-
auto const logger = rclcpp::get_logger("pilz_move_group");
33+
auto const logger = rclcpp::get_logger("pilz_move_group_node");
3434

3535
// Create the MoveIt MoveGroup Interface
3636
using moveit::planning_interface::MoveGroupInterface;

doc/how_to_guides/pilz_industrial_motion_planner/src/pilz_mtc.cpp

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -19,7 +19,7 @@
1919
*
2020
*/
2121

22-
static const rclcpp::Logger LOGGER = rclcpp::get_logger("pilz_mtc");
22+
static const rclcpp::Logger LOGGER = rclcpp::get_logger("pilz_mtc_node");
2323
namespace mtc = moveit::task_constructor;
2424

2525
class MTCTaskNode

doc/tutorials/quickstart_in_rviz/launch/demo.launch.py

Lines changed: 0 additions & 2 deletions
Original file line numberDiff line numberDiff line change
@@ -2,10 +2,8 @@
22
from launch import LaunchDescription
33
from launch.actions import DeclareLaunchArgument, OpaqueFunction
44
from launch.substitutions import LaunchConfiguration, PathJoinSubstitution
5-
from launch.conditions import IfCondition, UnlessCondition
65
from launch_ros.actions import Node
76
from launch_ros.substitutions import FindPackageShare
8-
from launch.actions import ExecuteProcess
97
from ament_index_python.packages import get_package_share_directory
108
from moveit_configs_utils import MoveItConfigsBuilder
119

doc/tutorials/your_first_project/your_first_project.rst

Lines changed: 6 additions & 3 deletions
Original file line numberDiff line numberDiff line change
@@ -268,13 +268,16 @@ Summary
268268

269269
* You created a ROS 2 package and wrote your first program using MoveIt.
270270
* You learned about using the MoveGroupInterface to plan and execute moves.
271-
* :codedir:`Here is a copy of the full hello_moveit.cpp source at the end of this tutorial<tutorials/your_first_project/hello_moveit.cpp>`.
271+
* :codedir:`Here is a copy of the full hello_moveit.cpp source at the end of this tutorial<tutorials/your_first_project/kinova_hello_moveit.cpp>`.
272272

273273
Further Reading
274274
---------------
275275

276-
- We used lambdas to be able to initialize objects as constants. This is known as a technique called IIFE. `Read more about this pattern from C++ Stories <https://www.cppstories.com/2016/11/iife-for-complex-initialization/>`_.
277-
- We also declared everything we could as const. `Read more about the usefulness of const here <https://www.cppstories.com/2016/12/please-declare-your-variables-as-const/>`_.
276+
- We used lambdas to be able to initialize objects as constants.
277+
This is known as a technique called IIFE.
278+
`Read more about this pattern from C++ Stories <https://www.cppstories.com/2016/11/iife-for-complex-initialization/>`_.
279+
- We also declared everything we could as const.
280+
`Read more about the usefulness of const here <https://www.cppstories.com/2016/12/please-declare-your-variables-as-const/>`_.
278281

279282
Next Step
280283
---------

0 commit comments

Comments
 (0)