Go to the documentation of this file. 1 #ifndef USB_CAM_CONTROLLERS_PACKET_CONTROLLERS
2 #define USB_CAM_CONTROLLERS_PACKET_CONTROLLERS
14 #include <sensor_msgs/CompressedImage.h>
19 #include <opencv2/core/core.hpp>
88 format_ = controller_nh.
param< std::string >(
"format",
"jpeg");
108 const sensor_msgs::CompressedImagePtr msg(
new sensor_msgs::CompressedImage());
usb_cam_hardware_interface::PacketHandle packet_iface_
ros::Time getStamp() const
virtual void updateImpl(const ros::Time &time, const ros::Duration &period)
sensor_msgs::ImagePtr toImageMsg() const
virtual void startingImpl(const ros::Time &time)
virtual void updateImpl(const ros::Time &time, const ros::Duration &period)
const Byte * getStartAs() const
virtual ~CompressedPacketController()
void publish(const boost::shared_ptr< M > &message) const
Publisher advertise(AdvertiseOptions &ops)
Publisher advertise(const std::string &base_topic, uint32_t queue_size, bool latch=false)
virtual void stoppingImpl(const ros::Time &time)
CompressedPacketController()
virtual bool initImpl(usb_cam_hardware_interface::PacketInterface *hw, ros::NodeHandle &root_nh, ros::NodeHandle &controller_nh)
std::size_t getLength() const
void publish(const sensor_msgs::Image &message) const
virtual ~PacketController()
ros::Publisher publisher_
T param(const std::string ¶m_name, const T &default_val) const
virtual void stoppingImpl(const ros::Time &time)
virtual void startingImpl(const ros::Time &time)
virtual bool initImpl(usb_cam_hardware_interface::PacketInterface *hw, ros::NodeHandle &root_nh, ros::NodeHandle &controller_nh)
image_transport::Publisher publisher_