40 #ifndef RRBOT_CONTROL__RRBOT_HW_INTERFACE_H 41 #define RRBOT_CONTROL__RRBOT_HW_INTERFACE_H virtual void read(ros::Duration &elapsed_time)
Read the state from the robot hardware.
RRBotHWInterface(ros::NodeHandle &nh, urdf::Model *urdf_model=NULL)
Constructor.
virtual void write(ros::Duration &elapsed_time)
Write the command to the robot hardware.
Hardware interface for a robot.
virtual void enforceLimits(ros::Duration &period)
Hardware interface for a robot.