[ros-users] Running stereo_image_proc

Patrick Mihelich mihelich at willowgarage.com
Fri Jan 21 03:34:28 UTC 2011


Hi Homer,

You must calibrate your cameras before you can do stereo. See
http://www.ros.org/wiki/camera_calibration/Tutorials/StereoCalibration.

Cheers,
Patrick

On Thu, Jan 20, 2011 at 7:27 PM, Homer Manalo
<homer.manalo at roboteknik.com>wrote:

> I wanted to view stereo images using the stereo_image_proc but I always get
> three blank windows(disparity, left, right). I am using the uvc_stereo
> driver for two separate webcams. I am assuming that this driver fakes the
> synchronization. The driver also publishes the topics at this format:
> /left/image_raw, /right/image_raw so I typed in ROS_NAMESPACE=/, am I right
> on this? The stereo_image_proc window is also displaying an error: "[ERROR]
> [1295580006.697030969]: [stereo_image_proc] Rectified or stereo topic
> requested, but cameras are uncalibrated." Should I get the cameras
> calibrated first? Is there any way I can run it without calibrating, just
> for simple testing? Here's the node info if it can help:
>
> Node [/stereo_image_proc_1295578845843245812]
> Publications:
>  * /left/image_mono [sensor_msgs/Image]
>  * /left/image_color [sensor_msgs/Image]
>  * /points2 [sensor_msgs/PointCloud2]
>  * /left/image_rect_color [sensor_msgs/Image]
>  * /rosout [roslib/Log]
>  * /points [sensor_msgs/PointCloud]
>  * /right/image_rect [sensor_msgs/Image]
>  * /right/image_mono [sensor_msgs/Image]
>  * /disparity [stereo_msgs/DisparityImage]
>  * /right/image_color [sensor_msgs/Image]
>  * /stereo_image_proc_1295578845843245812/parameter_updates
> [dynamic_reconfigure/Config]
>  * /left/image_rect [sensor_msgs/Image]
>  * /right/image_rect_color [sensor_msgs/Image]
>  * /stereo_image_proc_1295578845843245812/parameter_descriptions
> [dynamic_reconfigure/ConfigDescription]
>
> Subscriptions:
>  * /right/image_raw [sensor_msgs/Image]
>  * /left/camera_info [sensor_msgs/CameraInfo]
>  * /right/camera_info [sensor_msgs/CameraInfo]
>  * /left/image_raw [sensor_msgs/Image]
>
> Services:
>  * /stereo_image_proc_1295578845843245812/set_logger_level
>  * /stereo_image_proc_1295578845843245812/set_parameters
>  * /stereo_image_proc_1295578845843245812/get_loggers
>
>
> contacting node http://roboteknik-desktop:48241/ ...
> Pid: 3980
> Connections:
>  * topic: /rosout
>     * to: /rosout
>     * direction: outbound
>     * transport: TCPROS
>  * topic: /stereo_image_proc_1295578845843245812/parameter_descriptions
>     * to: /reconfigure_gui_4042_1295578871464
>     * direction: outbound
>     * transport: TCPROS
>  * topic: /stereo_image_proc_1295578845843245812/parameter_updates
>     * to: /reconfigure_gui_4042_1295578871464
>     * direction: outbound
>     * transport: TCPROS
>  * topic: /left/image_rect
>     * to: /stereo_view_1295579688171590464
>     * direction: outbound
>     * transport: TCPROS
>  * topic: /right/image_rect
>     * to: /stereo_view_1295579688171590464
>     * direction: outbound
>     * transport: TCPROS
>  * topic: /disparity
>     * to: /stereo_view_1295579688171590464
>     * direction: outbound
>     * transport: TCPROS
>  * topic: /left/image_raw
>     * to: http://roboteknik-desktop:55552/
>     * direction: inbound
>     * transport: TCPROS
>  * topic: /left/camera_info
>     * to: http://roboteknik-desktop:55552/
>     * direction: inbound
>     * transport: TCPROS
>  * topic: /right/image_raw
>     * to: http://roboteknik-desktop:55552/
>     * direction: inbound
>     * transport: TCPROS
>  * topic: /right/camera_info
>     * to: http://roboteknik-desktop:55552/
>     * direction: inbound
>     * transport: TCPROS
>
> _______________________________________________
> ros-users mailing list
> ros-users at code.ros.org
> https://code.ros.org/mailman/listinfo/ros-users
>
>
-------------- next part --------------
An HTML attachment was scrubbed...
URL: <http://lists.ros.org/pipermail/ros-users/attachments/20110120/5d58e1c8/attachment-0003.html>


More information about the ros-users mailing list