| 
    moveit2
    
   The MoveIt Motion Planning Framework for ROS 2. 
   | 
 
#include <limits>#include <moveit/ompl_interface/parameterization/joint_space/joint_model_state_space.hpp>#include <moveit/ompl_interface/parameterization/work_space/pose_model_state_space.hpp>#include <urdf_parser/urdf_parser.h>#include <ompl/util/Exception.h>#include <moveit/robot_state/conversions.hpp>#include <moveit/utils/robot_model_test_utils.hpp>#include <moveit/utils/logger.hpp>#include <gtest/gtest.h>#include <fstream>
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() | 
| rclcpp::Logger getLogger | ( | ) | 
Definition at line 51 of file test_state_space.cpp.


| int main | ( | int | argc, | 
| char ** | argv | ||
| ) | 
Definition at line 219 of file test_state_space.cpp.
| TEST | ( | TestDiffDrive | , | 
| TestStateSpace | |||
| ) | 
| TEST_F | ( | LoadPlanningModelsPr2 | , | 
| StateSpace | |||
| ) | 
| TEST_F | ( | LoadPlanningModelsPr2 | , | 
| StateSpaceCopy | |||
| ) | 
| TEST_F | ( | LoadPlanningModelsPr2 | , | 
| StateSpaces | |||
| ) | 
Definition at line 95 of file test_state_space.cpp.
      
  | 
  constexpr | 
Definition at line 56 of file test_state_space.cpp.