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

Protected Member Functions

void SetUp () override
 
void createPlannerInstance ()
 initialize the planner plugin The planner is loaded using the pluginlib. Checks that the planner was loaded properly. Exceptions will cause test failure. More...
 
void TearDown () override
 

Protected Attributes

rclcpp::Node::SharedPtr node_
 
moveit::core::RobotModelConstPtr robot_model_
 
std::unique_ptr< robot_model_loader::RobotModelLoaderrm_loader_
 
std::vector< std::string > planner_plugin_names_
 
std::unique_ptr< pluginlib::ClassLoader< planning_interface::PlannerManager > > planner_plugin_loader_
 
planning_interface::PlannerManagerPtr planner_instance_
 

Detailed Description

Definition at line 49 of file unittest_pilz_industrial_motion_planner.cpp.

Member Function Documentation

◆ createPlannerInstance()

void CommandPlannerTest::createPlannerInstance ( )
inlineprotected

initialize the planner plugin The planner is loaded using the pluginlib. Checks that the planner was loaded properly. Exceptions will cause test failure.

This function should be called only once during initialization of the class.

Definition at line 69 of file unittest_pilz_industrial_motion_planner.cpp.

Here is the caller graph for this function:

◆ SetUp()

void CommandPlannerTest::SetUp ( )
inlineoverrideprotected

Definition at line 52 of file unittest_pilz_industrial_motion_planner.cpp.

Here is the call graph for this function:

◆ TearDown()

void CommandPlannerTest::TearDown ( )
inlineoverrideprotected

Definition at line 105 of file unittest_pilz_industrial_motion_planner.cpp.

Member Data Documentation

◆ node_

rclcpp::Node::SharedPtr CommandPlannerTest::node_
protected

Definition at line 113 of file unittest_pilz_industrial_motion_planner.cpp.

◆ planner_instance_

planning_interface::PlannerManagerPtr CommandPlannerTest::planner_instance_
protected

Definition at line 119 of file unittest_pilz_industrial_motion_planner.cpp.

◆ planner_plugin_loader_

std::unique_ptr<pluginlib::ClassLoader<planning_interface::PlannerManager> > CommandPlannerTest::planner_plugin_loader_
protected

Definition at line 118 of file unittest_pilz_industrial_motion_planner.cpp.

◆ planner_plugin_names_

std::vector<std::string> CommandPlannerTest::planner_plugin_names_
protected

Definition at line 117 of file unittest_pilz_industrial_motion_planner.cpp.

◆ rm_loader_

std::unique_ptr<robot_model_loader::RobotModelLoader> CommandPlannerTest::rm_loader_
protected

Definition at line 115 of file unittest_pilz_industrial_motion_planner.cpp.

◆ robot_model_

moveit::core::RobotModelConstPtr CommandPlannerTest::robot_model_
protected

Definition at line 114 of file unittest_pilz_industrial_motion_planner.cpp.


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