This page lists changes that were made in the 1.3.x series of visualization (C Turtle).

1.3.2 (2010-11-22)

  • rviz

    • 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)

    • Point cloud axis color transformer: added ability to color in the local frame rather than the fixed frame (r34086)

1.3.1 (2010-11-15)

  • rviz

    • 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)

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

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

1.3.0 (2010-10-22)

  • Added rx stack dependency

  • 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.3 (last edited 2010-11-22 23:28:58 by JoshFaust)