#include <pr2_arm_kinematics/pr2_arm_kinematics_plugin.h>
#include <geometry_msgs/PoseStamped.h>
#include <kdl_parser/kdl_parser.hpp>
#include <tf_conversions/tf_kdl.h>
#include <ros/ros.h>
#include <algorithm>
#include <numeric>
#include <pluginlib/class_list_macros.h>
Go to the source code of this file.
Namespaces | |
namespace | pr2_arm_kinematics |
Namespace for the PR2ArmKinematics. | |
Functions | |
PLUGINLIB_EXPORT_CLASS (pr2_arm_kinematics::PR2ArmKinematicsPlugin, kinematics::KinematicsBase) |