47 static const double BILLION = 1000000000.0;
80 std::string
name_ =
"generic_hw_control_loop";
struct timespec current_time_
double cycle_time_error_threshold_
GenericHWControlLoop(ros::NodeHandle &nh, boost::shared_ptr< hardware_interface::RobotHW > hardware_interface)
Constructor.
ros::Duration elapsed_time_
boost::shared_ptr< hardware_interface::RobotHW > hardware_interface_
Abstract Hardware Interface for your robot.
boost::shared_ptr< controller_manager::ControllerManager > controller_manager_
ROS Controller Manager and Runner.
static const double BILLION
The control loop - repeatidly calls read() and write() to the hardware interface at a specified frequ...
ros::Duration desired_update_period_
struct timespec last_time_