moveit2
The MoveIt Motion Planning Framework for ROS 2.
Loading...
Searching...
No Matches
Protected Member Functions | Protected Attributes | List of all members
IntegrationTestCommandListManager Class Reference
Inheritance diagram for IntegrationTestCommandListManager:
Inheritance graph
[legend]
Collaboration diagram for IntegrationTestCommandListManager:
Collaboration graph
[legend]

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::CommandListManagermanager_
 
planning_scene::PlanningScenePtr scene_
 
planning_pipeline::PlanningPipelinePtr pipeline_
 
std::unique_ptr< pilz_industrial_motion_planner_testutils::TestdataLoaderdata_loader_
 

Detailed Description

Definition at line 88 of file integrationtest_command_list_manager.cpp.

Member Function Documentation

◆ SetUp()

void IntegrationTestCommandListManager::SetUp ( )
overrideprotected

Definition at line 104 of file integrationtest_command_list_manager.cpp.

Here is the call graph for this function:

Member Data Documentation

◆ data_loader_

std::unique_ptr<pilz_industrial_motion_planner_testutils::TestdataLoader> IntegrationTestCommandListManager::data_loader_
protected

Definition at line 101 of file integrationtest_command_list_manager.cpp.

◆ manager_

std::shared_ptr<pilz_industrial_motion_planner::CommandListManager> IntegrationTestCommandListManager::manager_
protected

Definition at line 97 of file integrationtest_command_list_manager.cpp.

◆ ph_

ros::NodeHandle IntegrationTestCommandListManager::ph_ { "~" }
protected

Definition at line 95 of file integrationtest_command_list_manager.cpp.

◆ pipeline_

planning_pipeline::PlanningPipelinePtr IntegrationTestCommandListManager::pipeline_
protected

Definition at line 99 of file integrationtest_command_list_manager.cpp.

◆ robot_model_

robot_model::RobotModelConstPtr IntegrationTestCommandListManager::robot_model_ { robot_model_loader::RobotModelLoader(ROBOT_DESCRIPTION_STR).getModel() }
protected

Definition at line 96 of file integrationtest_command_list_manager.cpp.

◆ scene_

planning_scene::PlanningScenePtr IntegrationTestCommandListManager::scene_
protected

Definition at line 98 of file integrationtest_command_list_manager.cpp.


The documentation for this class was generated from the following file: