#include <vector>
#include <string>
#include <kdl/chain.hpp>
#include <kdl/frames.hpp>
#include <kdl/velocityprofile_trap.hpp>
#include <tf/transform_listener.h>
#include <tf/message_filter.h>
#include <ros/ros.h>
#include <geometry_msgs/PoseStamped.h>
#include <pr2_controller_interface/controller.h>
#include <robot_mechanism_controllers/cartesian_pose_controller.h>
#include <simple_Jtranspose_controller/MoveToPose.h>
#include <std_srvs/Empty.h>
#include <boost/scoped_ptr.hpp>
Go to the source code of this file.
Classes | |
class | controller::CartesianTrajectoryController |
Namespaces | |
namespace | controller |