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