moveit2
The MoveIt Motion Planning Framework for ROS 2.
Classes | Functions | Variables
test_state_space.cpp File Reference
#include <limits>
#include <moveit/ompl_interface/parameterization/joint_space/joint_model_state_space.h>
#include <moveit/ompl_interface/parameterization/work_space/pose_model_state_space.h>
#include <urdf_parser/urdf_parser.h>
#include <ompl/util/Exception.h>
#include <moveit/robot_state/conversions.h>
#include <moveit/utils/robot_model_test_utils.h>
#include <moveit/utils/logger.hpp>
#include <gtest/gtest.h>
#include <fstream>
Include dependency graph for test_state_space.cpp:

Go to the source code of this file.

Classes

class  LoadPlanningModelsPr2
 

Functions

rclcpp::Logger getLogger ()
 
 TEST_F (LoadPlanningModelsPr2, StateSpace)
 
 TEST_F (LoadPlanningModelsPr2, StateSpaces)
 
 TEST_F (LoadPlanningModelsPr2, StateSpaceCopy)
 
 TEST (TestDiffDrive, TestStateSpace)
 
int main (int argc, char **argv)
 

Variables

constexpr double EPSILON = std::numeric_limits<double>::epsilon()
 

Function Documentation

◆ getLogger()

rclcpp::Logger getLogger ( )

Definition at line 51 of file test_state_space.cpp.

Here is the call graph for this function:
Here is the caller graph for this function:

◆ main()

int main ( int  argc,
char **  argv 
)

Definition at line 219 of file test_state_space.cpp.

◆ TEST()

TEST ( TestDiffDrive  ,
TestStateSpace   
)

Definition at line 192 of file test_state_space.cpp.

Here is the call graph for this function:

◆ TEST_F() [1/3]

TEST_F ( LoadPlanningModelsPr2  ,
StateSpace   
)

Definition at line 74 of file test_state_space.cpp.

Here is the call graph for this function:

◆ TEST_F() [2/3]

TEST_F ( LoadPlanningModelsPr2  ,
StateSpaceCopy   
)

Definition at line 117 of file test_state_space.cpp.

Here is the call graph for this function:

◆ TEST_F() [3/3]

TEST_F ( LoadPlanningModelsPr2  ,
StateSpaces   
)

Definition at line 95 of file test_state_space.cpp.

Variable Documentation

◆ EPSILON

constexpr double EPSILON = std::numeric_limits<double>::epsilon()
constexpr

Definition at line 56 of file test_state_space.cpp.