27 #ifndef SRH_SYNTOUCH_CONTROLLER_H 28 #define SRH_SYNTOUCH_CONTROLLER_H 31 #include <sr_robot_msgs/JointControllerState.h>
boost::scoped_ptr< realtime_tools::RealtimePublisher< sr_robot_msgs::JointControllerState > > controller_state_publisher_
A generic controller for the Shadow Robot EtherCAT hand's joints.
virtual void update(const ros::Time &time, const ros::Duration &period)
Issues commands to the joint. Should be called at regular intervals.
sr_actuator::SrMotorActuator * actuator_
bool init(ros_ethercat_model::RobotStateInterface *robot, ros::NodeHandle &n)
virtual void starting(const ros::Time &time)