#include <ros/ros.h>#include <boost/shared_ptr.hpp>#include <geometry_msgs/PoseStamped.h>#include <moveit_msgs/GetPositionFK.h>#include <moveit_msgs/GetPositionIK.h>#include <moveit_msgs/GetKinematicSolverInfo.h>#include <moveit_msgs/MoveItErrorCodes.h>#include <moveit/kinematics_base/kinematics_base.h>#include <moveit/robot_model/robot_model.h>#include <moveit/robot_state/robot_state.h>

Go to the source code of this file.
| Classes | |
| class | srv_kinematics_plugin::SrvKinematicsPlugin | 
| Specific implementation of kinematics using ROS service calls to communicate with external IK solvers. This version can be used with any robot. Supports non-chain kinematic groups.  More... | |
| Namespaces | |
| namespace | srv_kinematics_plugin |