#include <srdfdom/srdf_writer.h>#include <urdf/model.h>#include <moveit/robot_model/robot_model.h>#include <geometry_msgs/Pose.h>

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 | |
| void | moveit::core::loadIKPluginForGroup (JointModelGroup *jmg, const std::string &base_link, const std::string &tip_link, std::string plugin="KDL", double timeout=0.1) | 
| Load an IK solver plugin for the given joint model group.  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... | |
| moveit::core::RobotModelPtr | moveit::core::loadTestingRobotModel (const std::string &robot_name) | 
| Loads a robot from moveit_resources.  More... | |