37 #ifndef _JOINT_QUALIFICATION_CONTROLLERS_CHECKOUT_CONTROLLER_H_ 38 #define _JOINT_QUALIFICATION_CONTROLLERS_CHECKOUT_CONTROLLER_H_ 54 #include <boost/scoped_ptr.hpp> 55 #include "joint_qualification_controllers/RobotData.h" 107 void analysis(
double time,
bool timeout =
false);
139 #endif // _JOINT_QUALIFICATION_CONTROLLERS_CHECKOUT_CONTROLLER_H_
bool sendData()
Sends data, returns true if sent.
Checkout Controller checks state of PR2 mechanism.
pr2_mechanism_model::RobotState * robot_
double last_publish_time_
void analysis(double time, bool timeout=false)
Perform the test analysis.
void update()
Checks joint, actuator status for calibrated and enabled.
void starting()
Called when controller is started or restarted.
joint_qualification_controllers::RobotData robot_data_
bool init(pr2_mechanism_model::RobotState *robot, ros::NodeHandle &n)
Functional way to initialize.
boost::scoped_ptr< realtime_tools::RealtimePublisher< joint_qualification_controllers::RobotData > > robot_data_pub_