moveit2
The MoveIt Motion Planning Framework for ROS 2.
Classes | Namespaces | Functions
robot_model_test_utils.h File Reference
#include <srdfdom/srdf_writer.h>
#include <urdf/model.h>
#include <moveit/robot_model/robot_model.h>
#include <geometry_msgs/msg/pose.hpp>
Include dependency graph for robot_model_test_utils.h:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Classes

class  moveit::core::RobotModelBuilder
 Easily build different robot models for testing. Essentially a programmer-friendly light wrapper around URDF and SRDF. Best shown by an example: More...
 

Namespaces

 moveit
 Main namespace for MoveIt.
 
 moveit::core
 Core components of MoveIt.
 

Functions

moveit::core::RobotModelPtr moveit::core::loadTestingRobotModel (const std::string &robot_name)
 Loads a robot from moveit_resources. More...
 
urdf::ModelInterfaceSharedPtr moveit::core::loadModelInterface (const std::string &robot_name)
 Loads a URDF Model Interface from moveit_resources. More...
 
srdf::ModelSharedPtr moveit::core::loadSRDFModel (const std::string &robot_name)
 Loads an SRDF Model from moveit_resources. More...