#include <kdl/jntarray.hpp>
#include <pr2_controller_interface/controller.h>
#include <pr2_mechanism_model/robot.h>
#include <pr2_mechanism_model/tree.h>
#include <ros/ros.h>
#include <sensor_msgs/JointState.h>
Go to the source code of this file.
Classes | |
class | JointPositionController |
A simple joint position controller, which controls each joint independently of each other using a PD control scheme. More... |