moveit2
The MoveIt Motion Planning Framework for ROS 2.
Loading...
Searching...
No Matches
Protected Member Functions | Protected Attributes | List of all members
TestConstrainedStateSpace Class Reference

Robot independent implementation of the tests.
More...

Inheritance diagram for TestConstrainedStateSpace:
Inheritance graph
[legend]
Collaboration diagram for TestConstrainedStateSpace:
Collaboration graph
[legend]

Protected Member Functions

 TestConstrainedStateSpace (const std::string &robot_name, const std::string &group_name)
 
void SetUp () override
 
void TearDown () override
 
void setupMoveItStateSpace ()
 
void setupOMPLStateSpace ()
 
void testGetValueAddressAtIndex ()
 
void testCopyToRobotState ()
 
void testCopyToOMPLState ()
 
void testCopyJointToOMPLState ()
 
- Protected Member Functions inherited from ompl_interface_testing::LoadTestRobot
 LoadTestRobot (const std::string &robot_name, const std::string &group_name)
 
Eigen::VectorXd getRandomState () const
 
Eigen::VectorXd getDeterministicState () const
 Create a joint position vector with values 0.1, 0.2, 0.3, ... where the length depends on the number of joints in the robot.
 

Protected Attributes

ompl::base::ConstrainedStateSpacePtr constrained_state_space_
 
ompl_interface::ConstrainedPlanningStateSpacePtr moveit_state_space_
 
- Protected Attributes inherited from ompl_interface_testing::LoadTestRobot
std::string group_name_
 
std::string robot_name_
 
moveit::core::RobotModelPtr robot_model_
 
moveit::core::RobotStatePtr robot_state_
 
const moveit::core::JointModelGroupjoint_model_group_
 
std::size_t num_dofs_
 
std::string base_link_name_
 
std::string ee_link_name_
 

Detailed Description

Robot independent implementation of the tests.

Definition at line 81 of file test_constrained_planning_state_space.cpp.

Constructor & Destructor Documentation

◆ TestConstrainedStateSpace()

TestConstrainedStateSpace::TestConstrainedStateSpace ( const std::string &  robot_name,
const std::string &  group_name 
)
inlineprotected

Definition at line 84 of file test_constrained_planning_state_space.cpp.

Member Function Documentation

◆ SetUp()

void TestConstrainedStateSpace::SetUp ( )
inlineoverrideprotected

Definition at line 89 of file test_constrained_planning_state_space.cpp.

Here is the call graph for this function:

◆ setupMoveItStateSpace()

void TestConstrainedStateSpace::setupMoveItStateSpace ( )
inlineprotected

Definition at line 100 of file test_constrained_planning_state_space.cpp.

Here is the caller graph for this function:

◆ setupOMPLStateSpace()

void TestConstrainedStateSpace::setupOMPLStateSpace ( )
inlineprotected

Definition at line 106 of file test_constrained_planning_state_space.cpp.

Here is the caller graph for this function:

◆ TearDown()

void TestConstrainedStateSpace::TearDown ( )
inlineoverrideprotected

Definition at line 96 of file test_constrained_planning_state_space.cpp.

◆ testCopyJointToOMPLState()

void TestConstrainedStateSpace::testCopyJointToOMPLState ( )
inlineprotected

Definition at line 201 of file test_constrained_planning_state_space.cpp.

Here is the call graph for this function:

◆ testCopyToOMPLState()

void TestConstrainedStateSpace::testCopyToOMPLState ( )
inlineprotected

Definition at line 175 of file test_constrained_planning_state_space.cpp.

Here is the call graph for this function:

◆ testCopyToRobotState()

void TestConstrainedStateSpace::testCopyToRobotState ( )
inlineprotected

Definition at line 139 of file test_constrained_planning_state_space.cpp.

Here is the call graph for this function:

◆ testGetValueAddressAtIndex()

void TestConstrainedStateSpace::testGetValueAddressAtIndex ( )
inlineprotected

Definition at line 114 of file test_constrained_planning_state_space.cpp.

Here is the call graph for this function:

Member Data Documentation

◆ constrained_state_space_

ompl::base::ConstrainedStateSpacePtr TestConstrainedStateSpace::constrained_state_space_
protected

Definition at line 240 of file test_constrained_planning_state_space.cpp.

◆ moveit_state_space_

ompl_interface::ConstrainedPlanningStateSpacePtr TestConstrainedStateSpace::moveit_state_space_
protected

Definition at line 241 of file test_constrained_planning_state_space.cpp.


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