ros-perception / image_transport_plugins

A set of plugins for publishing and subscribing to sensor_msgs/Image topics in representations other than raw pixel data.
BSD 3-Clause "New" or "Revised" License
58 stars 119 forks source link

/out/compressed topic no output #101

Open ggao22 opened 2 years ago

ggao22 commented 2 years ago

Hello! I'm trying to get image compression republishing working on foxy. I used the following command: ros2 run image_transport republish raw in:=camera1/image compressed out:=compressed The camera driver is successfully publishing on topic camera1/image, but no compressed image is coming out of /out/compressed which image_transport is republishing to. What might be the issue here?

Any help is appreciated. Thank you so much!

simutisernestas commented 1 year ago

same with humble, although i get an error:

/opt/ros/humble/lib/image_transport/republish compressed in:=/camera/front/driver/image_raw/compressed out:=/topic          
[WARN] [1679909447.858397219] [rcl]: Found remap rule 'in:=/camera/front/driver/image_raw/compressed'. This syntax is deprecated. Use '--ros-args --remap in:=/camera/front/driver/image_raw/compressed' instead.
[WARN] [1679909447.858448762] [rcl]: Found remap rule 'out:=/topic'. This syntax is deprecated. Use '--ros-args --remap out:=/topic' instead.
[ERROR] [1679909447.922390251] [image_republisher]: SubscriberPlugin::subscribeImpl with five arguments has not been overridden