27 #ifndef SR_MECHANISM_CONTROLLERS_SRH_FAKE_JOINT_CALIBRATION_CONTROLLER_H 28 #define SR_MECHANISM_CONTROLLERS_SRH_FAKE_JOINT_CALIBRATION_CONTROLLER_H 32 #include "ros_ethercat_model/robot_state_interface.hpp" 35 #include "std_msgs/Empty.h" 37 #include <boost/smart_ptr.hpp> 67 ros_ethercat_model::RobotState *
robot_;
69 boost::scoped_ptr<realtime_tools::RealtimePublisher<std_msgs::Empty> >
pub_calibrated_;
79 ros_ethercat_model::JointState *
joint_;
98 #endif // SR_MECHANISM_CONTROLLERS_SRH_FAKE_JOINT_CALIBRATION_CONTROLLER_H
std::string actuator_name_
ros_ethercat_model::RobotState * robot_
virtual void update(const ros::Time &time, const ros::Duration &period)
ros_ethercat_model::Actuator * actuator_
ros_ethercat_model::JointState * joint_
boost::scoped_ptr< realtime_tools::RealtimePublisher< std_msgs::Empty > > pub_calibrated_
SrhFakeJointCalibrationController()
virtual bool init(ros_ethercat_model::RobotStateInterface *robot, ros::NodeHandle &n)
ros::Time last_publish_time_
std::string joint_prefix_