This page lists changes that were made in the 1.4.x series of visualization (Diamondback).

1.4.2 (Forthcoming)

  • rxbag_plugins

    • Fixed plot view PNG export <<Ticket(ros-pkg 5101)>>

1.4.1 (2011-04-26)

Small bug-fix release:

  • rviz

    • Fixed <<Ticket(ros-pkg 4885)>> displays (list) window and selection window can now be shrunk when they are popped out.

    • Fixed <<Ticket(ros-pkg 4911)>> windows created by displays (Camera and Image) now don't appear on startup if the .vcg file says they are disabled.

    • Fixed <<Ticket(ros-pkg 4910)>> new top-level windows (like Camera and Image

      • displays) no longer appear at the very top of the screen.
    • Fixed <<Ticket(ros-pkg 4908)>> interference between camera and image displays.

    • Fixed <<Ticket(ros-pkg 4858)>> Aspect ratio of ortho views was broken after selection.

1.4.0 (2011-01-18)

rviz 1.4 contains a new Image display, which enables viewing images without a CameraInfo. It also adds a new "Axis" point cloud transformer, which is useful for visualizing 3D data by range.

  • rviz

    • Added new Image display, which does not use a CameraInfo topic, and won't show the 3D scene behind it (<<Ticket(ros-pkg,4485)>>, r33821)

    • New "Axis" point cloud color transformer, allows color interpolation based on the position along an axis (<<Ticket(ros-pkg,4278)>>, r33932)

    • Point cloud axis color transformer: added ability to color in the local frame rather than the fixed frame (r34086)
    • fixed crash when a sensor_msgs/PointCloud is received that a channel with a values array that is a different size than the points array (r33966)

    • PointCloud2 display now filters out nan values completely, rather than just moving them to someplace you'll never see. Improves performance for rectangular sensor-based clouds (like stereo or the kinect). (r33978)

    • Fixed performance problems with high datarate, large size point clouds like those that come from the kinect (r33994)
    • Fixed threading crash caused by LaserScan/PointCloud/PointCloud2 displays (<<Ticket(ros-pkg,4426)>>, r34027, r34028)

    • Changed the camera display's near-clip distance to 0.01 meters from 0.1 meters (<<Ticket(ros-pkg,4503)>>, r33819)

    • Compiles with messages using either roslib/Header or the new std_msgs/Header (see REP 100) (r33820)

    • New display management dialog replaces the up/down buttons on the displays panel. (r33829, r33834, r33873). Added functionality:
      • Remove all
      • Rename (<<Ticket(ros-pkg,1392)>>)

  • rxbag_plugins

    • bug fix for displaying images with rgb8 encoding <<Ticket(ros-pkg 4415)>>

    • bug fix for plotting integers <<Ticket(ros 3028)>>

Wiki: visualization/ChangeList/1.4 (last edited 2011-08-01 17:08:58 by TimField)