#include <cstring>
#include <string>
#include <vector>
#include <hand_kinematics/hand_kinematics_plugin.h>
#include <pluginlib/class_list_macros.h>
#include <ros/ros.h>
#include <tf_conversions/tf_kdl.h>
#include <kdl_parser/kdl_parser.hpp>
#include <moveit_msgs/MoveItErrorCodes.h>
#include <sr_utilities/sr_math_utils.hpp>
Go to the source code of this file.
const std::string FK_SERVICE = "get_fk" |
|
static |
const std::string IK_SERVICE = "get_ik" |
|
static |
const std::string IK_WITH_COLLISION_SERVICE = "get_constraint_aware_ik" |
|
static |