Class RosCompressedStreamer

Inheritance Relationships

Base Type

Class Documentation

class RosCompressedStreamer : public web_video_server::StreamerBase

Public Functions

RosCompressedStreamer(const async_web_server_cpp::HttpRequest &request, async_web_server_cpp::HttpConnectionPtr connection, rclcpp::Node::WeakPtr node)
~RosCompressedStreamer()
virtual void start()

Starts the streaming process.

virtual void restream_frame(std::chrono::duration<double> max_age)

Restreams the last received image frame if older than max_age.

Protected Functions

virtual void send_image(const sensor_msgs::msg::CompressedImage::ConstSharedPtr msg, const std::chrono::steady_clock::time_point &time)