ros_compressed_streamer.h
Go to the documentation of this file.
1 #ifndef ROS_COMPRESSED_STREAMERS_H_
2 #define ROS_COMPRESSED_STREAMERS_H_
3 
4 #include <sensor_msgs/CompressedImage.h>
9 
10 namespace web_video_server
11 {
12 
14 {
15 public:
17  ros::NodeHandle& nh);
19 
20  virtual void start();
21  virtual void restreamFrame(double max_age);
22 
23 protected:
24  virtual void sendImage(const sensor_msgs::CompressedImageConstPtr &msg, const ros::Time &time);
25 
26 private:
27  void imageCallback(const sensor_msgs::CompressedImageConstPtr &msg);
31  sensor_msgs::CompressedImageConstPtr last_msg;
32  boost::mutex send_mutex_;
33 };
34 
36 {
37 public:
40  ros::NodeHandle& nh);
41  std::string create_viewer(const async_web_server_cpp::HttpRequest &request);
42 };
43 
44 }
45 
46 #endif
virtual void sendImage(const sensor_msgs::CompressedImageConstPtr &msg, const ros::Time &time)
sensor_msgs::CompressedImageConstPtr last_msg
RosCompressedStreamer(const async_web_server_cpp::HttpRequest &request, async_web_server_cpp::HttpConnectionPtr connection, ros::NodeHandle &nh)
void imageCallback(const sensor_msgs::CompressedImageConstPtr &msg)


web_video_server
Author(s): Mitchell Wills
autogenerated on Tue Mar 1 2022 00:04:38