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

Protected Member Functions

void SetUp () override
 

Protected Attributes

ros::NodeHandle ph_ { "~" }
 
robot_model::RobotModelPtr robot_model_
 
double pose_norm_tolerance_
 
double orientation_norm_tolerance_
 
std::string planning_group_
 
std::string target_link_
 
std::string test_data_file_name_
 
std::unique_ptr< pilz_industrial_motion_planner_testutils::TestdataLoadertest_data_
 
unsigned int num_joints_ { 0 }
 

Detailed Description

PLEASE NOTE: More detailed lin tests are done via unit tests. With the help of the integration tests, it is only checked that a linear command actually performs a linear command.

Definition at line 75 of file integrationtest_command_planning.cpp.

Member Function Documentation

◆ SetUp()

void IntegrationTestCommandPlanning::SetUp ( )
overrideprotected

Definition at line 93 of file integrationtest_command_planning.cpp.

Here is the call graph for this function:

Member Data Documentation

◆ num_joints_

unsigned int IntegrationTestCommandPlanning::num_joints_ { 0 }
protected

Definition at line 90 of file integrationtest_command_planning.cpp.

◆ orientation_norm_tolerance_

double IntegrationTestCommandPlanning::orientation_norm_tolerance_
protected

Definition at line 85 of file integrationtest_command_planning.cpp.

◆ ph_

ros::NodeHandle IntegrationTestCommandPlanning::ph_ { "~" }
protected

Definition at line 81 of file integrationtest_command_planning.cpp.

◆ planning_group_

std::string IntegrationTestCommandPlanning::planning_group_
protected

Definition at line 86 of file integrationtest_command_planning.cpp.

◆ pose_norm_tolerance_

double IntegrationTestCommandPlanning::pose_norm_tolerance_
protected

Definition at line 85 of file integrationtest_command_planning.cpp.

◆ robot_model_

robot_model::RobotModelPtr IntegrationTestCommandPlanning::robot_model_
protected

Definition at line 83 of file integrationtest_command_planning.cpp.

◆ target_link_

std::string IntegrationTestCommandPlanning::target_link_
protected

Definition at line 86 of file integrationtest_command_planning.cpp.

◆ test_data_

std::unique_ptr<pilz_industrial_motion_planner_testutils::TestdataLoader> IntegrationTestCommandPlanning::test_data_
protected

Definition at line 88 of file integrationtest_command_planning.cpp.

◆ test_data_file_name_

std::string IntegrationTestCommandPlanning::test_data_file_name_
protected

Definition at line 86 of file integrationtest_command_planning.cpp.


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