35 #ifndef _JOINT_QUALIFICATION_CONTROLLERS_WRIST_DIFFERENCE_CONTROLLER_H_ 36 #define _JOINT_QUALIFICATION_CONTROLLERS_WRIST_DIFFERENCE_CONTROLLER_H_ 51 #include <joint_qualification_controllers/WristDiffData.h> 56 #include <boost/scoped_ptr.hpp> 126 boost::scoped_ptr<realtime_tools::RealtimePublisher<joint_qualification_controllers::WristDiffData> >
wrist_data_pub_;
void analysis()
Perform the test analysis.
~WristDifferenceController()
controller::JointPositionController * flex_controller_
pr2_mechanism_model::JointState * flex_joint_
boost::scoped_ptr< realtime_tools::RealtimePublisher< joint_qualification_controllers::WristDiffData > > wrist_data_pub_
joint_qualification_controllers::WristDiffData wrist_test_data_
pr2_mechanism_model::JointState * roll_joint_
bool init(pr2_mechanism_model::RobotState *robot, ros::NodeHandle &n)
Functional way to initialize.
void starting()
Called when controller is started.
pr2_mechanism_model::RobotState * robot_
controller::JointVelocityController * roll_controller_
bool sendData()
Sends data, returns true if sent.
void update()
Issues commands to the joint to perform hysteresis test.
WristDifferenceController()