Contents
1.5.8 (Forthcoming)
sensor_msgs geometry_msgs nav_msgs stereo_msgs updating bag migration exports to rosbag format.
1.5.7 (2011-07-15)
sensor_msgs: Added YUV422 image encoding string constant.
1.5.6 (2011-07-12)
Added explicit include of ros/console.h to point_cloud_conversions.cpp. This is necessary due to ros::Message base class removal.
1.5.5 (2011-07-12)
visualization_msgs/InteractiveMarkerFeedback added mouse_point and mouse_point_valid
1.5.4 (2011-07-06)
sensor_msgs: Added sensor_msgs/JoyFeedback and sensor_msgs/JoyFeedbackArray based on ps3joy review.
1.5.3 (2011-07-01)
visualization_msgs: moved INIT function of visualization_msgs/InteractiveMarkerUpdate into its own message: visualization_msgs/InteractiveMarkerInit, in accordance with <<Ticket(ros-pkg 5021)>>.
1.5.2 (2011-06-22)
sensor_msgs: Added sensor_msgs/Joy with Header
visualization_msgs: Changed menu specification messages. visualization_msgs/InteractiveMarker now has a single array of visualization_msgs/MenuEntrys. Each visualization_msgs/MenuEntry has an id field and a parent_id field, together describing a menu/submenu tree.
1.5.1 (2011-06-07)
visualization_msgs: Added MOUSE_DOWN and MOUSE_UP to InteractiveMarkerFeedback
1.5.0 (2011-06-01)
sensor_msgs Add 16-bit image encodings (<<Ticket(ros-pkg 4738)>>).
visualization_msgs: Added new messages for interactive_markers