|
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.
|
|
void | TearDown () override |
|
◆ 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.
◆ SetUp()
void CommandPlannerTest::SetUp |
( |
| ) |
|
|
inlineoverrideprotected |
◆ TearDown()
void CommandPlannerTest::TearDown |
( |
| ) |
|
|
inlineoverrideprotected |
◆ node_
rclcpp::Node::SharedPtr CommandPlannerTest::node_ |
|
protected |
◆ planner_instance_
planning_interface::PlannerManagerPtr CommandPlannerTest::planner_instance_ |
|
protected |
◆ planner_plugin_loader_
◆ planner_plugin_names_
std::vector<std::string> CommandPlannerTest::planner_plugin_names_ |
|
protected |
◆ rm_loader_
◆ robot_model_
moveit::core::RobotModelConstPtr CommandPlannerTest::robot_model_ |
|
protected |
The documentation for this class was generated from the following file: