ros-perception / image_pipeline

An image processing pipeline for ROS.
Other
786 stars 726 forks source link

image_transport publishers don't remap correctly #940

Closed mikeferguson closed 7 months ago

mikeferguson commented 7 months ago

The subscribers have all been fixed - but anywhere we use image_transport for a publisher, we also need to do the fully resolved name trick or we get things like:

    /stereo/left/image_rect/compressed: sensor_msgs/msg/CompressedImage
    /stereo/left/image_rect/compressedDepth: sensor_msgs/msg/CompressedImage
    /stereo/left/image_rect/theora: theora_image_transport/msg/Packet
    /stereo/left/image_rect_color: sensor_msgs/msg/Image

It appears this possibly affects (based on grep for image_transport functions):

mikeferguson commented 7 months ago

Fixed in 941