moveit2
The MoveIt Motion Planning Framework for ROS 2.
|
Protected Member Functions | |
void | SetUp () override |
Protected Attributes | |
ros::NodeHandle | ph_ { "~" } |
robot_model::RobotModelConstPtr | robot_model_ { robot_model_loader::RobotModelLoader(ROBOT_DESCRIPTION_STR).getModel() } |
std::shared_ptr< pilz_industrial_motion_planner::CommandListManager > | manager_ |
planning_scene::PlanningScenePtr | scene_ |
planning_pipeline::PlanningPipelinePtr | pipeline_ |
std::unique_ptr< pilz_industrial_motion_planner_testutils::TestdataLoader > | data_loader_ |
Definition at line 88 of file integrationtest_command_list_manager.cpp.
|
overrideprotected |
Definition at line 104 of file integrationtest_command_list_manager.cpp.
|
protected |
Definition at line 101 of file integrationtest_command_list_manager.cpp.
|
protected |
Definition at line 97 of file integrationtest_command_list_manager.cpp.
|
protected |
Definition at line 95 of file integrationtest_command_list_manager.cpp.
|
protected |
Definition at line 99 of file integrationtest_command_list_manager.cpp.
|
protected |
Definition at line 96 of file integrationtest_command_list_manager.cpp.
|
protected |
Definition at line 98 of file integrationtest_command_list_manager.cpp.