Go to the documentation of this file.
47 FakeCalibrationController::FakeCalibrationController()
48 : last_publish_time_(0), joint_(NULL)
63 std::string joint_name;
71 ROS_ERROR(
"Could not find joint \"%s\" (namespace: %s)",
92 pr2_controllers_msgs::QueryCalibrationState::Response& resp)
bool getParam(const std::string &key, bool &b) const
bool isCalibrated(pr2_controllers_msgs::QueryCalibrationState::Request &req, pr2_controllers_msgs::QueryCalibrationState::Response &resp)
ServiceServer advertiseService(AdvertiseServiceOptions &ops)
pr2_mechanism_model::RobotState * robot_
virtual bool init(pr2_mechanism_model::RobotState *robot, ros::NodeHandle &n)
JointState * getJointState(const std::string &name)
~FakeCalibrationController()
PLUGINLIB_EXPORT_CLASS(my_controller_ns::MyControllerClass, pr2_controller_interface::Controller)
boost::scoped_ptr< realtime_tools::RealtimePublisher< std_msgs::Empty > > pub_calibrated_
const std::string & getNamespace() const
pr2_mechanism_model::JointState * joint_
ros::ServiceServer is_calibrated_srv_