Unable to load plugin for transport 'image_transport/compressed_sub'
I am using Kinect on Ubuntu 16.04. After executing ```rosrun image_view extract_images image_transport/compressed_sub``` I get terminate called after throwing an instance of...
View ArticleImage publisher node publishes empty header
I am trying to make a node that can both capture omnidirectional images to unwrap them and subsequently publish the resulting image in a new topic. As of now, the capturing of images for unwrapping...
View ArticleImplementing SubscriberStatusCallback within ros2
Hi, When reading image_transport source code, ended up at a point where we need to use SubscriberStatusCallback. How do we implement the same on ros2? (LifeCycle nodes?) They do not let enable us to...
View Articlecorrect way to subscribe to image and CameraInfo topic using image_transport...
Hi all, I'm looking for a reference on the correct way to subscribe to an image topic, e.g. from openni2, such that I get the cameraInfo and image data. Most examples only cover the retrieval of image...
View Articletopic remapping in synchronised message_filters
I am trying to synchronise a compressed depth image and its camera info: image_transport::SubscriberFilter sub_image(it, "image", 10); message_filters::Subscriber sub_info(n, "camera_info", 10);...
View ArticleCreate a subscriber to an Image topic
Hi, Im trying to wrtie a node that subscribes to a image topic, however, after almost copying the ros tutorial, I keep getting an error. The relevant parts of my code are: ros::NodeHandle nh;...
View ArticleIs CameraInfoManager needed when using CameraPublisher?
When using `image_transport::CameraPublisher` one can also publish the `sensor_msgs::CameraInfo` message, when publishing the image. In this case, is there a need for having an (extra)...
View ArticlePublishing compressed images
Hi all, I have a camera that is giving me JPEG images. The compressed_image_transport overview says: "When writing a driver for such a camera, a quick and dirty approach is to simply copy the JPEG data...
View ArticleWhat's the difference between message_filters and image_transport?
Hi I am using ROS Fuerte. I need to subscribe to 2 streams from the Kinect (color and depth) and use these to get 3D features. I understand to get the 2D feature I can use OpenCv and then relate this...
View ArticleLow latency image_transport compression
Hi. I'm wondering if it's allowed by design to write custom image_transport plugin which does its compression in separate thread? I.e., upon receiving an image it copies it to separate compressing...
View ArticleCan I use image transport for the two different image topics?
Using an RGBD camera (RealSense D435), we want to log compressed color images (JPEG 'compressed'), and depth images (PNG 'compressedDepth'). The realsense driver publishes these compressed topics...
View Articlemono16 image is wrongly formed when using compressed image_transport
I am dealing with a 16-bit mono image, publishing it using image_transport. I have no issues with the raw data topic, I can view it directly, bag it, replay it, and view again. If I run `rostopic echo...
View ArticleImage transport: Cannot set parameters
Hi! I have set up an image transport publisher like so: image_transport::ImageTransport img_transport(nodeHandle); myPub = img_transport.advertise("myTopic", 50); And then simply use...
View Articleimage_transport rosbag issue
Has anyone else seen problems recording rosbags for all topics of a node using image_transport? > ERROR >...
View Articlerepublish image from rospy node to roscpp node
Hi, I just want to know the right format to republish image data from a python node to a cpp node, because I keep getting an error. My python node is publishing a CompressedImage (from sensor_msgs.msg...
View ArticleExport bag of CompressedImage to disk without decoding
I have a bag of compressed images (*/camera/image/compressed*). I wrote a Python script which reads the bagfile using the Python API and writes JPEGs to disk in this way: cv_img =...
View ArticleRosjava image_transport tutorial - no image display on android tablet despite...
Hi, I am trying out the rosjava image_transport tutorial by importing it as an android project in Eclipse and port it to a Motorola Xoom. To get the sample code to compile, I have modified it slightly...
View Article[image_transport] Topics '/usb_cam/image_color' and '/usb_cam/camera_info' do...
please help me :( $ rosrun image_transport republish compressed in:=usb_cam/image raw out:=usb_cam/image $ ROS_NAMESPACE=usb_cam rosrun image_proc image_proc image_raw:=image _approximate_s=true...
View Article[ROS2] Node pointer from a LifecycleNode
Hi all, the problem of LifecycleNode pointers support comes back. Using ROS2 Bouncy I could not directly publish TF because the broadcaster creator requires only a rclcpp::Node pointer as...
View Article[ROS2] image_transport and RVIZ2 Camera, something wrong
Hi, using Rviz2 and image_transport with Crystal Clemmys I noticed that the `Camera` plugin in Rviz2 is not aligned to how `image_transport::CameraPublisher` creates the topic structure. The `Camera`...
View ArticleopenCv imshow doesn't display image
I'm trying to display a **Compressed Image** from camera/image/Compressed in C++ using OpenCV, however, all I get is a blank window with no image, I've verified with rqt_image_view_imageView that there...
View ArticleHow can image_transport package be configured to use libjpeg-turbo for JPEG...
Hi To improve performance during jpeg encoding, I want to use best algorithm. I found that libjpeg-turbo is fatser than libjpeg. Can libjpeg-turbo's library(2.0.1) be associated in image_transport...
View Articleimage_transport vs nodelets
Hello, After reading the image_transport documentation, it seems like you can subscribe to an image_raw stream, but the callback has a signature that receives const image pointers. My current...
View Articledepth data retrieved by image_transport has confusing format
- OS: Ubuntu 16.04 LTS - ROS distro: kinetic Hey, I am reading depth data from a Microsoft Kinect using the freenect package. My Node: #include #include #include #include #include #include #include...
View ArticleRead image in main loop instead of imageCallback ?
Hello newbie here, I am writing an application where I subscribe to an image topic. I followed this tutorial: http://wiki.ros.org/image_transport/Tutorials/SubscribingToImages. It's a great tutorial...
View Articlecan't initialize image_transport
I have a [VIO sensor](https://github.com/PerceptIn/IRONSIDES) that works with ROS `kinetic`. However, when I test it with an onboard computer running ROS `Melodic`, I can't initialize...
View ArticleEdit encoding of sensor_msgs/Image message
I have a [sensor_msgs/Image message](http://docs.ros.org/melodic/api/sensor_msgs/html/msg/Image.html) that I'm unable to use with standard ROS packages like stereo_image_proc because the "encoding" is...
View ArticleHow to use imagezero_transport package?
Hello guys, I am new in ROS and trying to do some project that contain image transport in it. By using image transport without any compression, it seems like quite lagging. So I tried to search for...
View ArticleImage transport built with colcon in ROS2 states "Plugins are not built"
I wrote a test image transport based on the "Writing a new transport" tutorial, but adapted to ROS2. I sucessfully built it using colcon and sourced the setup file. If I run "ros2 pkg list", my...
View ArticleHow to subscribe multiple images using image_transport
Hi, I would like to subscribe multiple images using image_transport. Here is my code snapshot: std::vecotr topics = {"topicA", "topicB"}; mage_transport::ImageTransport it_(nh); std::vector subs_;...
View Article