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

Protected Member Functions

void SetUp () override
 To initialize the planning context loader The planning context loader is loaded using the pluginlib. Checks if planning context loader was loaded properly are performed. 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::unique_ptr< pluginlib::ClassLoader< pilz_industrial_motion_planner::PlanningContextLoader > > planning_context_loader_class_loader_
 
pilz_industrial_motion_planner::PlanningContextLoaderPtr planning_context_loader_
 

Detailed Description

Definition at line 50 of file unittest_planning_context_loaders.cpp.

Member Function Documentation

◆ SetUp()

void PlanningContextLoadersTest::SetUp ( )
inlineoverrideprotected

To initialize the planning context loader The planning context loader is loaded using the pluginlib. Checks if planning context loader was loaded properly are performed. Exceptions will cause test failure.

Definition at line 59 of file unittest_planning_context_loaders.cpp.

◆ TearDown()

void PlanningContextLoadersTest::TearDown ( )
inlineoverrideprotected

Definition at line 95 of file unittest_planning_context_loaders.cpp.

Member Data Documentation

◆ node_

rclcpp::Node::SharedPtr PlanningContextLoadersTest::node_
protected

Definition at line 105 of file unittest_planning_context_loaders.cpp.

◆ planning_context_loader_

pilz_industrial_motion_planner::PlanningContextLoaderPtr PlanningContextLoadersTest::planning_context_loader_
protected

Definition at line 113 of file unittest_planning_context_loaders.cpp.

◆ planning_context_loader_class_loader_

std::unique_ptr<pluginlib::ClassLoader<pilz_industrial_motion_planner::PlanningContextLoader> > PlanningContextLoadersTest::planning_context_loader_class_loader_
protected

Definition at line 111 of file unittest_planning_context_loaders.cpp.

◆ rm_loader_

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

Definition at line 107 of file unittest_planning_context_loaders.cpp.

◆ robot_model_

moveit::core::RobotModelConstPtr PlanningContextLoadersTest::robot_model_
protected

Definition at line 106 of file unittest_planning_context_loaders.cpp.


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