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

Protected Member Functions

void SetUp () override
 
void TearDown () override
 

Protected Attributes

std::shared_ptr< rclcpp::Node > node_
 
std::shared_ptr< const moveit::core::RobotModelrobot_model_
 
planning_pipeline::PlanningPipelinePtr pipeline_ptr_ { nullptr }
 

Detailed Description

Definition at line 51 of file planning_pipeline_tests.cpp.

Member Function Documentation

◆ SetUp()

void TestPlanningPipeline::SetUp ( )
inlineoverrideprotected

Definition at line 54 of file planning_pipeline_tests.cpp.

Here is the call graph for this function:

◆ TearDown()

void TestPlanningPipeline::TearDown ( )
inlineoverrideprotected

Definition at line 59 of file planning_pipeline_tests.cpp.

Member Data Documentation

◆ node_

std::shared_ptr<rclcpp::Node> TestPlanningPipeline::node_
protected

Definition at line 63 of file planning_pipeline_tests.cpp.

◆ pipeline_ptr_

planning_pipeline::PlanningPipelinePtr TestPlanningPipeline::pipeline_ptr_ { nullptr }
protected

Definition at line 65 of file planning_pipeline_tests.cpp.

◆ robot_model_

std::shared_ptr<const moveit::core::RobotModel> TestPlanningPipeline::robot_model_
protected

Definition at line 64 of file planning_pipeline_tests.cpp.


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