Go to the documentation of this file. 1 #ifndef USB_CAM_CONTROLLERS_SIMPLE_PACKET_CONTROLLER
2 #define USB_CAM_CONTROLLERS_SIMPLE_PACKET_CONTROLLER
33 const std::vector< std::string > names(hw->getNames());
38 if (names.size() > 1) {
39 ROS_WARN_STREAM(names.size() <<
" packet handles. camera info synchronized to stamps from "
40 "the first handle will be published.");
47 return initImpl(hw, root_nh, controller_nh);
55 ROS_DEBUG(
"No packet. Will skip publishing camera info.");
59 ROS_DEBUG(
"Packet is not updated. Will skip publishing camera info.");
virtual ~SimplePacketController()
usb_cam_hardware_interface::PacketHandle packet_iface_
ros::Time getStamp() const
virtual void startingImpl(const ros::Time &time)=0
virtual void stopping(const ros::Time &time)
virtual bool initImpl(usb_cam_hardware_interface::PacketInterface *hw, ros::NodeHandle &root_nh, ros::NodeHandle &controller_nh)=0
virtual void stoppingImpl(const ros::Time &time)=0
const void * getStart() const
#define ROS_WARN_STREAM(args)
virtual bool init(usb_cam_hardware_interface::PacketInterface *hw, ros::NodeHandle &root_nh, ros::NodeHandle &controller_nh)
virtual void starting(const ros::Time &time)
virtual void update(const ros::Time &time, const ros::Duration &period)
virtual void updateImpl(const ros::Time &time, const ros::Duration &period)=0