39 const std::vector<std::string>& sensor_names = hw->getNames();
40 for (
unsigned i = 0; i < sensor_names.size(); i++)
41 ROS_DEBUG(
"Got sensor %s", sensor_names[i].c_str());
46 ROS_ERROR(
"Parameter 'publish_rate' not set");
50 for (
unsigned i = 0; i < sensor_names.size(); i++)
53 sensors_.push_back(hw->getHandle(sensor_names[i]));
virtual void starting(const ros::Time &time) override
std::vector< scaled_controllers::SpeedScalingHandle > sensors_
std::vector< ros::Time > last_publish_times_
virtual void update(const ros::Time &time, const ros::Duration &) override
bool getParam(const std::string &key, std::string &s) const
std::vector< RtPublisherPtr > realtime_pubs_
virtual void stopping(const ros::Time &) override
std::shared_ptr< realtime_tools::RealtimePublisher< std_msgs::Float64 > > RtPublisherPtr
#define PLUGINLIB_EXPORT_CLASS(class_type, base_class_type)
virtual bool init(scaled_controllers::SpeedScalingInterface *hw, ros::NodeHandle &root_nh, ros::NodeHandle &controller_nh) override