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

Public Member Functions

 TrajectoryTest ()
 

Protected Member Functions

void SetUp () override
 

Protected Attributes

moveit::core::RobotModelPtr robot_model_
 
std::vector< std::string > group_joint_names_
 
const std::string PLANNING_GROUP = "panda_arm"
 
const double GOAL_TOLERANCE = 0.1
 
ros::NodeHandle node_handle_
 

Detailed Description

Definition at line 41 of file trajectory_test.cpp.

Constructor & Destructor Documentation

◆ TrajectoryTest()

TrajectoryTest::TrajectoryTest ( )
inline

Definition at line 44 of file trajectory_test.cpp.

Member Function Documentation

◆ SetUp()

void TrajectoryTest::SetUp ( )
inlineoverrideprotected

Definition at line 49 of file trajectory_test.cpp.

Here is the call graph for this function:

Member Data Documentation

◆ GOAL_TOLERANCE

const double TrajectoryTest::GOAL_TOLERANCE = 0.1
protected

Definition at line 62 of file trajectory_test.cpp.

◆ group_joint_names_

std::vector<std::string> TrajectoryTest::group_joint_names_
protected

Definition at line 60 of file trajectory_test.cpp.

◆ node_handle_

ros::NodeHandle TrajectoryTest::node_handle_
protected

Definition at line 63 of file trajectory_test.cpp.

◆ PLANNING_GROUP

const std::string TrajectoryTest::PLANNING_GROUP = "panda_arm"
protected

Definition at line 61 of file trajectory_test.cpp.

◆ robot_model_

moveit::core::RobotModelPtr TrajectoryTest::robot_model_
protected

Definition at line 59 of file trajectory_test.cpp.


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