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

Public Member Functions

void SetUp () override
 

Protected Attributes

rclcpp::Node node_
 
MoveItCppPtr moveit_cpp_ptr
 
PlanningComponentPtr planning_component_ptr
 
moveit::core::RobotModelConstPtr robot_model_ptr
 
const moveit::core::JointModelGroupjmg_ptr
 
const std::string PLANNING_GROUP = "panda_arm"
 
geometry_msgs::PoseStamped target_pose1
 
geometry_msgs::Pose target_pose2
 
geometry_msgs::Pose start_pose
 

Detailed Description

Definition at line 55 of file moveit_cpp_test.cpp.

Member Function Documentation

◆ SetUp()

void moveit::planning_interface::MoveItCppTest::SetUp ( )
inlineoverride

Definition at line 58 of file moveit_cpp_test.cpp.

Member Data Documentation

◆ jmg_ptr

const moveit::core::JointModelGroup* moveit::planning_interface::MoveItCppTest::jmg_ptr
protected

Definition at line 94 of file moveit_cpp_test.cpp.

◆ moveit_cpp_ptr

MoveItCppPtr moveit::planning_interface::MoveItCppTest::moveit_cpp_ptr
protected

Definition at line 91 of file moveit_cpp_test.cpp.

◆ node_

rclcpp::Node moveit::planning_interface::MoveItCppTest::node_
protected

Definition at line 90 of file moveit_cpp_test.cpp.

◆ planning_component_ptr

PlanningComponentPtr moveit::planning_interface::MoveItCppTest::planning_component_ptr
protected

Definition at line 92 of file moveit_cpp_test.cpp.

◆ PLANNING_GROUP

const std::string moveit::planning_interface::MoveItCppTest::PLANNING_GROUP = "panda_arm"
protected

Definition at line 95 of file moveit_cpp_test.cpp.

◆ robot_model_ptr

moveit::core::RobotModelConstPtr moveit::planning_interface::MoveItCppTest::robot_model_ptr
protected

Definition at line 93 of file moveit_cpp_test.cpp.

◆ start_pose

geometry_msgs::Pose moveit::planning_interface::MoveItCppTest::start_pose
protected

Definition at line 98 of file moveit_cpp_test.cpp.

◆ target_pose1

geometry_msgs::PoseStamped moveit::planning_interface::MoveItCppTest::target_pose1
protected

Definition at line 96 of file moveit_cpp_test.cpp.

◆ target_pose2

geometry_msgs::Pose moveit::planning_interface::MoveItCppTest::target_pose2
protected

Definition at line 97 of file moveit_cpp_test.cpp.


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