[ros-users] image_pipeline-1.1.0 Released (Development Release)

Patrick Mihelich mihelich at willowgarage.com
Thu Mar 11 06:15:00 UTC 2010


image_pipeline-1.1.0 has been released into latest. This is a development
release; it is recommended for users to keep using the 1.0 branch in
boxturtle. For more information see
http://www.ros.org/wiki/StackVersionPolicy.

The major new features are in stereo_image_proc. It takes advantage of
improvements to the OpenCV stereo block matcher, particularly to reduce
fringe artifacts at edges. For comparison, the reference implementation of
stereo block matching (on which OpenCV's was based) can be used instead, but
they should now give roughly the same results. stereo_image_proc now
advertises a separate point cloud topic using the new and improved
PointCloud2<http://www.ros.org/doc/api/sensor_msgs/html/msg/PointCloud2.html>message
type.

Cheers,
Patrick

For the full changelist see
http://www.ros.org/wiki/image_pipeline/ChangeList

camera_calibration:

   - calibration no longer makes buggy assumptions about corner spacing
   always being .108m
   - Added a simple calibration script (camera_calibrate_from_disk.py) that
   loads a set of images from disk and performs monocular calibration returning
   the camera intrinsics.
   - Set projection matrix P correctly in monocular calibration.

image_proc:

   - Warn if color topic requested but raw image data is grayscale.

stereo_image_proc:

   - Allow using either the OpenCV block matcher or the Willow Garage
   reference implementation. Should give roughly the same results with
   vision_opencv 1.1 or greater.
   -

   Added points2 topic with the new
sensor_msgs/PointCloud2<http://ros.org/doc/api/sensor_msgs/html/msg/PointCloud2.html>format.
   - Upped texture_threshold maximum to 10000; high values needed for
   simulated stereo images.
-------------- next part --------------
An HTML attachment was scrubbed...
URL: <http://lists.osuosl.org/pipermail/ros-users/attachments/20100310/197cba9c/attachment-0003.html>
-------------- next part --------------
------------------------------------------------------------------------------
Download Intel® Parallel Studio Eval
Try the new software tools for yourself. Speed compiling, find bugs
proactively, and fine-tune applications for parallel performance.
See why Intel Parallel Studio got high marks during beta.
http://p.sf.net/sfu/intel-sw-dev
-------------- next part --------------
_______________________________________________
ros-users mailing list
ros-users at lists.sourceforge.net
https://lists.sourceforge.net/lists/listinfo/ros-users


More information about the ros-users mailing list