/target_detector_server/image#
Caution
This documentation page has been auto-generated.
It may be missing some details.
/target_detector_server/image Quick Facts
- Category
 - Message type
 - Direction
 ➡️ you normally subscribe to this topic.
Topic to publish the detected image for debugging
Quick snippets#
Check the publication rate#
$ ros2 topic hz /target_detector_server/image
Display the data published on the topic#
$ ros2 topic echo /target_detector_server/image
How to use in your code#
Subscribe to the topic using Python#
 1#!/usr/bin/env python
 2
 3import rclpy
 4from rclpy.node import Node
 5
 6from sensor_msgs.msg import Image
 7
 8
 9class ImageSubscriber(Node):
10
11    def __init__(self):
12        super().__init__('target_detector_server_image_subscriber')
13        self.subscription = self.create_subscription(
14            Image,
15            '/target_detector_server/image',
16            self.listener_callback,
17            10)
18
19    def listener_callback(self, msg):
20        # see https://docs.ros2.org/latest/api/sensor_msgs/msg/Image.html
21        # for the msg structure
22        self.get_logger().info('I heard: "%s"' % msg.data)
23
24
25if __name__ == '__main__':
26    rclpy.init(args=args)
27
28    subscriber = ImageSubscriber()
29
30    rclpy.spin(subscriber)
31
32    rclpy.shutdown()
Subscribe to the topic using C++#
 1#include <memory>
 2
 3#include "rclcpp/rclcpp.hpp"
 4#include "sensor_msgs/msg/image.hpp"
 5
 6using std::placeholders::_1;
 7using namespace rclcpp;
 8
 9class ImageSubscriber : public rclcpp::Node
10{
11public:
12    ImageSubscriber()
13    : Node("target_detector_server_image_subscriber")
14    {
15    subscription_ = this->create_subscription<sensor_msgs::msg::Image>(
16            "/target_detector_server/image",
17            10,
18            std::bind(&ImageSubscriber::topic_callback, this, _1));
19    }
20
21private:
22    void topic_callback(const sensor_msgs::msg::Image::SharedPtr msg) const
23    {
24    // see https://docs.ros2.org/latest/api/sensor_msgs/msg/Image.html
25    // for the msg structure
26    RCLCPP_INFO_STREAM(this->get_logger(), "Got " << msg->data);
27    }
28
29    Subscription<sensor_msgs::msg::Image>::SharedPtr subscription_;
30};
31
32int main(int argc, char * argv[])
33{
34init(argc, argv);
35spin(std::make_shared<ImageSubscriber>());
36shutdown();
37return 0;
38}