#include <ros/ros.h>#include <memory>#include <geometry_msgs/PoseStamped.h>#include <moveit_msgs/GetPositionFK.h>#include <moveit_msgs/GetPositionIK.h>#include <moveit_msgs/KinematicSolverInfo.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>#include "opw_kinematics/opw_kinematics.h"

Go to the source code of this file.
Classes | |
| struct | moveit_opw_kinematics_plugin::MoveItOPWKinematicsPlugin::LimitObeyingSol |
| class | moveit_opw_kinematics_plugin::MoveItOPWKinematicsPlugin |
| 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 | |
| moveit_opw_kinematics_plugin | |