Class RosCompressedStreamer

Inheritance Relationships

Base Type

Class Documentation

class RosCompressedStreamer : public web_video_server::ImageStreamer

Public Functions

RosCompressedStreamer(const async_web_server_cpp::HttpRequest &request, async_web_server_cpp::HttpConnectionPtr connection, rclcpp::Node::SharedPtr node)
~RosCompressedStreamer()
virtual void start()
virtual void restreamFrame(double max_age)

Restreams the last received image frame if older than max_age.

Protected Functions

virtual void sendImage(const sensor_msgs::msg::CompressedImage::ConstSharedPtr msg, const rclcpp::Time &time)