Class ImageViewNode

Inheritance Relationships

Base Type

  • public rclcpp::Node

Class Documentation

class ImageViewNode : public rclcpp::Node

Node which receives sensor_msgs/Image messages and renders them using OpenCV.

Public Functions

inline explicit ImageViewNode(const std::string &input, const std::string &node_name = "image_view_node", bool watermark = true)

Construct a new ImageViewNode for visualizing image data.

Parameters:
  • input – The topic name to subscribe to

  • node_name – The node name to use

  • watermark – Whether to add a watermark to the image before displaying