diff -Nru ros-common-msgs-1.12.3/actionlib_msgs/CHANGELOG.rst ros-common-msgs-1.12.4/actionlib_msgs/CHANGELOG.rst --- ros-common-msgs-1.12.3/actionlib_msgs/CHANGELOG.rst 2015-04-21 06:30:07.000000000 +0000 +++ ros-common-msgs-1.12.4/actionlib_msgs/CHANGELOG.rst 2016-02-23 07:26:55.000000000 +0000 @@ -2,6 +2,9 @@ Changelog for package actionlib_msgs ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +1.12.4 (2016-02-22) +------------------- + 1.12.3 (2015-04-20) ------------------- diff -Nru ros-common-msgs-1.12.3/actionlib_msgs/package.xml ros-common-msgs-1.12.4/actionlib_msgs/package.xml --- ros-common-msgs-1.12.3/actionlib_msgs/package.xml 2015-04-21 06:30:07.000000000 +0000 +++ ros-common-msgs-1.12.4/actionlib_msgs/package.xml 2016-02-23 07:26:55.000000000 +0000 @@ -1,6 +1,6 @@ actionlib_msgs - 1.12.3 + 1.12.4 actionlib_msgs defines the common messages to interact with an action server and an action client. For full documentation of diff -Nru ros-common-msgs-1.12.3/common_msgs/CHANGELOG.rst ros-common-msgs-1.12.4/common_msgs/CHANGELOG.rst --- ros-common-msgs-1.12.3/common_msgs/CHANGELOG.rst 2015-04-21 06:30:07.000000000 +0000 +++ ros-common-msgs-1.12.4/common_msgs/CHANGELOG.rst 2016-02-23 07:26:55.000000000 +0000 @@ -2,6 +2,9 @@ Changelog for package common_msgs ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +1.12.4 (2016-02-22) +------------------- + 1.12.3 (2015-04-20) ------------------- diff -Nru ros-common-msgs-1.12.3/common_msgs/package.xml ros-common-msgs-1.12.4/common_msgs/package.xml --- ros-common-msgs-1.12.3/common_msgs/package.xml 2015-04-21 06:30:07.000000000 +0000 +++ ros-common-msgs-1.12.4/common_msgs/package.xml 2016-02-23 07:26:55.000000000 +0000 @@ -1,6 +1,6 @@ common_msgs - 1.12.3 + 1.12.4 common_msgs contains messages that are widely used by other ROS packages. These includes messages for diff -Nru ros-common-msgs-1.12.3/debian/changelog ros-common-msgs-1.12.4/debian/changelog --- ros-common-msgs-1.12.3/debian/changelog 2015-12-22 14:56:07.000000000 +0000 +++ ros-common-msgs-1.12.4/debian/changelog 2016-07-21 09:54:29.000000000 +0000 @@ -1,4 +1,35 @@ -ros-common-msgs (1.12.3-2~20151222) trusty; urgency=medium +ros-common-msgs (1.12.4-2~20160721) trusty; urgency=medium + + * Rebuild for updated ros-genlisp. + + -- Jochen Sprickerhof Wed, 13 Jul 2016 07:19:45 +0200 + +ros-common-msgs (1.12.4-1) unstable; urgency=medium + + * Imported Upstream version 1.12.4 + * Remove boost dependency + + -- Jochen Sprickerhof Wed, 24 Feb 2016 14:08:37 +0100 + +ros-common-msgs (1.12.3-5) unstable; urgency=medium + + * Adopt to new libexec location in catkin + + -- Jochen Sprickerhof Tue, 16 Feb 2016 11:04:54 +0100 + +ros-common-msgs (1.12.3-4) unstable; urgency=medium + + * Add dependencies. + + -- Jochen Sprickerhof Sun, 10 Jan 2016 13:03:48 +0100 + +ros-common-msgs (1.12.3-3) unstable; urgency=medium + + * Reupload to unstable. + + -- Jochen Sprickerhof Thu, 17 Dec 2015 17:09:58 +0100 + +ros-common-msgs (1.12.3-2) unstable; urgency=medium [ Jochen Sprickerhof ] * Add multiarch support diff -Nru ros-common-msgs-1.12.3/debian/control ros-common-msgs-1.12.4/debian/control --- ros-common-msgs-1.12.3/debian/control 2015-12-17 22:50:52.000000000 +0000 +++ ros-common-msgs-1.12.4/debian/control 2016-07-21 08:31:43.000000000 +0000 @@ -4,9 +4,8 @@ Uploaders: Thomas Moulard , Jochen Sprickerhof , Leopold Palomo-Avellaneda -Build-Depends: debhelper (>= 9), catkin (>> 0.6.16-2), libroscpp-core-dev, ros-message-generation, libstd-msgs-dev, - python-all (>= 2.6.6-3), python-setuptools (>= 0.6b3), dh-python, - libboost-dev +Build-Depends: debhelper (>= 9), catkin (>= 0.6.16-4), libroscpp-core-dev, ros-message-generation, libstd-msgs-dev, + python-all (>= 2.6.6-3), python-setuptools (>= 0.6b3), dh-python Standards-Version: 3.9.6 Section: libs Homepage: https://github.com/ros/common_msgs @@ -16,7 +15,7 @@ Package: libactionlib-msgs-dev Section: libdevel Architecture: all -Depends: ${misc:Depends}, python +Depends: ${misc:Depends}, python, libstd-msgs-dev Description: Messages relating to the Robot OS actionlib, C/C++ interface This package is part of Robot OS (ROS), and contains the common messages to interact with an action server and an action client. For @@ -40,7 +39,7 @@ Package: cl-actionlib-msgs Section: lisp Architecture: all -Depends: ${misc:Depends} +Depends: ${misc:Depends}, cl-std-msgs Description: Messages relating to Robot OS actionlib, LISP interface This package is part of Robot OS (ROS), and contains the common messages to interact with an action server and an action client. For @@ -52,12 +51,12 @@ Package: libdiagnostic-msgs-dev Section: libdevel Architecture: all -Depends: ${misc:Depends} +Depends: ${misc:Depends}, libstd-msgs-dev Description: Messages relating to Robot OS diagnostic, C/C++ interface This package is part of Robot OS (ROS), and contains the messages which provide the standardized interface for the diagnostic and runtime monitoring systems in ROS. These messages are currently used - by the stack, which provides + by the http://wiki.ros.org/diagnostics stack, which provides libraries for simple ways to set and access the messages, as well as automated ways to process the diagnostic data. . @@ -80,7 +79,7 @@ Package: cl-diagnostic-msgs Section: lisp Architecture: all -Depends: ${misc:Depends} +Depends: ${misc:Depends}, cl-std-msgs Description: Messages relating to Robot OS diagnostic, LISP interface This package is part of Robot OS (ROS), and contains the messages which provide the standardized interface for the diagnostic and @@ -118,7 +117,7 @@ Package: cl-geometry-msgs Section: lisp Architecture: all -Depends: ${misc:Depends} +Depends: ${misc:Depends}, cl-std-msgs Description: Messages relating to Robot OS geometry, LISP interface This package is part of Robot OS (ROS), and provides the messages for common geometric primitives such as points, vectors, and poses. These @@ -130,7 +129,7 @@ Package: libnav-msgs-dev Section: libdevel Architecture: all -Depends: ${misc:Depends} +Depends: ${misc:Depends}, libgeometry-msgs-dev, libactionlib-msgs-dev Description: Messages relating to Robot OS nav, C/C++ interface This package is part of Robot OS (ROS), and provides the common messages used to interact with the 'nav' http://wiki.ros.org/navigation @@ -141,7 +140,7 @@ Package: python-nav-msgs Section: python Architecture: all -Depends: ${python:Depends}, ${shlibs:Depends}, ${misc:Depends}, python-genpy, python-std-msgs +Depends: ${python:Depends}, ${shlibs:Depends}, ${misc:Depends}, python-genpy, libgeometry-msgs-dev, python-actionlib-msgs Description: Messages relating to Robot OS nav, Python interface This package is part of Robot OS (ROS), and provides the common messages used to interact with the 'nav' http://wiki.ros.org/navigation @@ -152,7 +151,7 @@ Package: cl-nav-msgs Section: lisp Architecture: all -Depends: ${misc:Depends} +Depends: ${misc:Depends}, cl-geometry-msgs, cl-actionlib-msgs Description: Messages relating to Robot OS nav, LISP interface This package is part of Robot OS (ROS), and provides the common messages used to interact with the 'nav' http://wiki.ros.org/navigation @@ -163,7 +162,7 @@ Package: libsensor-msgs-dev Section: libdevel Architecture: all -Depends: libboost-dev, libgeometry-msgs-dev, ${misc:Depends} +Depends: libgeometry-msgs-dev, ${misc:Depends} Description: Messages relating to Robot OS sensor, C/C++ interface This package is part of Robot OS (ROS). This package defines messages for commonly used sensors, including @@ -174,7 +173,7 @@ Package: python-sensor-msgs Section: python Architecture: all -Depends: ${python:Depends}, ${shlibs:Depends}, ${misc:Depends}, python-genpy, python-std-msgs +Depends: ${python:Depends}, ${shlibs:Depends}, ${misc:Depends}, python-genpy, python-geometry-msgs Description: Messages relating to Robot OS sensor, Python interface This package is part of Robot OS (ROS), and provides messages for commonly used sensors, including cameras and scanning laser @@ -185,7 +184,7 @@ Package: cl-sensor-msgs Section: lisp Architecture: all -Depends: ${misc:Depends} +Depends: ${misc:Depends}, cl-geometry-msgs Description: Messages relating to Robot OS sensor, LISP interface This package is part of Robot OS (ROS), and provides messages for commonly used sensors, including cameras and scanning laser @@ -196,7 +195,7 @@ Package: libshape-msgs-dev Section: libdevel Architecture: all -Depends: ${misc:Depends} +Depends: ${misc:Depends}, libgeometry-msgs-dev Description: Messages relating to Robot OS shape, C/C++ interface This package is part of Robot OS (ROS), and provides messages for commonly used sensors, including cameras and scanning laser @@ -207,7 +206,7 @@ Package: python-shape-msgs Section: python Architecture: all -Depends: ${python:Depends}, ${shlibs:Depends}, ${misc:Depends}, python-genpy, python-std-msgs +Depends: ${python:Depends}, ${shlibs:Depends}, ${misc:Depends}, python-genpy, python-geometry-msgs Description: Messages relating to Robot OS shape, Python interface This package is part of Robot OS (ROS), and provides messages for defining shapes, such as simple solid object primitives (cube, @@ -218,7 +217,7 @@ Package: cl-shape-msgs Section: lisp Architecture: all -Depends: ${misc:Depends} +Depends: ${misc:Depends}, cl-geometry-msgs Description: Messages relating to Robot OS shape, LISP interface This package is part of Robot OS (ROS), and provides messages for defining shapes, such as simple solid object primitives (cube, @@ -229,7 +228,7 @@ Package: libstereo-msgs-dev Section: libdevel Architecture: all -Depends: ${misc:Depends} +Depends: ${misc:Depends}, libsensor-msgs-dev Description: Messages relating to Robot OS stereo, C/C++ interface This package is part of Robot OS (ROS), and provides messages specific to stereo processing, such as disparity images. @@ -239,7 +238,7 @@ Package: python-stereo-msgs Section: python Architecture: all -Depends: ${python:Depends}, ${shlibs:Depends}, ${misc:Depends}, python-genpy, python-std-msgs +Depends: ${python:Depends}, ${shlibs:Depends}, ${misc:Depends}, python-genpy, python-sensor-msgs Description: Messages relating to Robot OS stereo, Python interface This package is part of Robot OS (ROS), and provides messages specific to stereo processing, such as disparity images. @@ -249,7 +248,7 @@ Package: cl-stereo-msgs Section: lisp Architecture: all -Depends: ${misc:Depends} +Depends: ${misc:Depends}, cl-sensor-msgs Description: Messages relating to Robot OS stereo, LISP interface This package is part of Robot OS (ROS), and provides messages specific to stereo processing, such as disparity images. @@ -259,7 +258,7 @@ Package: libtrajectory-msgs-dev Section: libdevel Architecture: all -Depends: ${misc:Depends} +Depends: ${misc:Depends}, libgeometry-msgs-dev Description: Messages relating to Robot OS trajectory, C/C++ interface This package is part of Robot OS (ROS), and provides messages for defining robot trajectories. These messages are also the building @@ -270,7 +269,7 @@ Package: python-trajectory-msgs Section: python Architecture: all -Depends: ${python:Depends}, ${shlibs:Depends}, ${misc:Depends}, python-genpy, python-std-msgs +Depends: ${python:Depends}, ${shlibs:Depends}, ${misc:Depends}, python-genpy, python-geometry-msgs Description: Messages relating to Robot OS trajectory, Python interface This package is part of Robot OS (ROS), and provides messages for defining robot trajectories. These messages are also the building @@ -281,7 +280,7 @@ Package: cl-trajectory-msgs Section: lisp Architecture: all -Depends: ${misc:Depends} +Depends: ${misc:Depends}, cl-geometry-msgs Description: Messages relating to Robot OS trajectory, LISP interface This package is part of Robot OS (ROS), and provides messages for defining robot trajectories. These messages are also the building @@ -292,7 +291,7 @@ Package: libvisualization-msgs-dev Section: libdevel Architecture: all -Depends: ${misc:Depends}, libgeometry-msgs-dev, ros-message-runtime, libstd-msgs-dev +Depends: ${misc:Depends}, libgeometry-msgs-dev Description: Messages relating to Robot OS visualization, C/C++ interface This package is part of Robot OS (ROS), and provides a set of messages used by higher level packages, such as rviz, that deal in @@ -310,7 +309,7 @@ Package: python-visualization-msgs Section: python Architecture: all -Depends: ${python:Depends}, ${shlibs:Depends}, ${misc:Depends}, python-genpy, python-std-msgs +Depends: ${python:Depends}, ${shlibs:Depends}, ${misc:Depends}, python-genpy, python-geometry-msgs Description: Messages relating to Robot OS visualization, Python interface This package is part of Robot OS (ROS), and provides a set of messages used by higher level packages, such as rviz, that deal in @@ -328,7 +327,7 @@ Package: cl-visualization-msgs Section: lisp Architecture: all -Depends: ${misc:Depends} +Depends: ${misc:Depends}, cl-geometry-msgs Description: Messages relating to Robot OS visualization, LISP interface This package is part of Robot OS (ROS), and provides a set of messages used by higher level packages, such as rviz, that deal in diff -Nru ros-common-msgs-1.12.3/debian/libactionlib-msgs-dev.install ros-common-msgs-1.12.4/debian/libactionlib-msgs-dev.install --- ros-common-msgs-1.12.3/debian/libactionlib-msgs-dev.install 2015-12-17 22:50:53.000000000 +0000 +++ ros-common-msgs-1.12.4/debian/libactionlib-msgs-dev.install 2016-07-21 08:31:43.000000000 +0000 @@ -1,4 +1,4 @@ usr/include/actionlib_msgs usr/share/actionlib_msgs -usr/lib/*/actionlib_msgs usr/lib +usr/lib/actionlib_msgs usr/lib/*/pkgconfig/actionlib_msgs.pc /usr/lib/pkgconfig diff -Nru ros-common-msgs-1.12.3/diagnostic_msgs/CHANGELOG.rst ros-common-msgs-1.12.4/diagnostic_msgs/CHANGELOG.rst --- ros-common-msgs-1.12.3/diagnostic_msgs/CHANGELOG.rst 2015-04-21 06:30:07.000000000 +0000 +++ ros-common-msgs-1.12.4/diagnostic_msgs/CHANGELOG.rst 2016-02-23 07:26:55.000000000 +0000 @@ -2,6 +2,11 @@ Changelog for package diagnostic_msgs ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +1.12.4 (2016-02-22) +------------------- +* diagnostic_msgs: Add messages for service used to add diagnostics to aggregator +* Contributors: Michal Staniaszek + 1.12.3 (2015-04-20) ------------------- diff -Nru ros-common-msgs-1.12.3/diagnostic_msgs/CMakeLists.txt ros-common-msgs-1.12.4/diagnostic_msgs/CMakeLists.txt --- ros-common-msgs-1.12.3/diagnostic_msgs/CMakeLists.txt 2015-04-21 06:30:07.000000000 +0000 +++ ros-common-msgs-1.12.4/diagnostic_msgs/CMakeLists.txt 2016-02-23 07:26:55.000000000 +0000 @@ -13,6 +13,7 @@ add_service_files( DIRECTORY srv FILES + AddDiagnostics.srv SelfTest.srv) generate_messages(DEPENDENCIES std_msgs) diff -Nru ros-common-msgs-1.12.3/diagnostic_msgs/package.xml ros-common-msgs-1.12.4/diagnostic_msgs/package.xml --- ros-common-msgs-1.12.3/diagnostic_msgs/package.xml 2015-04-21 06:30:07.000000000 +0000 +++ ros-common-msgs-1.12.4/diagnostic_msgs/package.xml 2016-02-23 07:26:55.000000000 +0000 @@ -1,6 +1,6 @@ diagnostic_msgs - 1.12.3 + 1.12.4 This package holds the diagnostic messages which provide the standardized interface for the diagnostic and runtime monitoring diff -Nru ros-common-msgs-1.12.3/diagnostic_msgs/srv/AddDiagnostics.srv ros-common-msgs-1.12.4/diagnostic_msgs/srv/AddDiagnostics.srv --- ros-common-msgs-1.12.3/diagnostic_msgs/srv/AddDiagnostics.srv 1970-01-01 00:00:00.000000000 +0000 +++ ros-common-msgs-1.12.4/diagnostic_msgs/srv/AddDiagnostics.srv 2016-02-23 07:26:55.000000000 +0000 @@ -0,0 +1,27 @@ +# This service is used as part of the process for loading analyzers at runtime, +# and should be used by a loader script or program, not as a standalone service. +# Information about dynamic addition of analyzers can be found at +# http://wiki.ros.org/diagnostics/Tutorials/Adding%20Analyzers%20at%20Runtime + +# The load_namespace parameter defines the namespace where parameters for the +# initialization of analyzers in the diagnostic aggregator have been loaded. The +# value should be a global name (i.e. /my/name/space), not a relative +# (my/name/space) or private (~my/name/space) name. Analyzers will not be added +# if a non-global name is used. The call will also fail if the namespace +# contains parameters that follow a namespace structure that does not conform to +# that expected by the analyzer definitions. See +# http://wiki.ros.org/diagnostics/Tutorials/Configuring%20Diagnostic%20Aggregators +# and http://wiki.ros.org/diagnostics/Tutorials/Using%20the%20GenericAnalyzer +# for examples of the structure of yaml files which are expected to have been +# loaded into the namespace. +string load_namespace +--- + +# True if diagnostic aggregator was updated with new diagnostics, False +# otherwise. A false return value means that either there is a bond in the +# aggregator which already used the requested namespace, or the initialization +# of analyzers failed. +bool success + +# Message with additional information about the success or failure +string message diff -Nru ros-common-msgs-1.12.3/geometry_msgs/CHANGELOG.rst ros-common-msgs-1.12.4/geometry_msgs/CHANGELOG.rst --- ros-common-msgs-1.12.3/geometry_msgs/CHANGELOG.rst 2015-04-21 06:30:07.000000000 +0000 +++ ros-common-msgs-1.12.4/geometry_msgs/CHANGELOG.rst 2016-02-23 07:26:55.000000000 +0000 @@ -2,6 +2,11 @@ Changelog for package geometry_msgs ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +1.12.4 (2016-02-22) +------------------- +* clarify the definition of a Vector3 +* Contributors: Vincent Rabaud + 1.12.3 (2015-04-20) ------------------- * geometry_msgs/InertiaStamped uses geometry_msgs/Inertia. diff -Nru ros-common-msgs-1.12.3/geometry_msgs/msg/Vector3.msg ros-common-msgs-1.12.4/geometry_msgs/msg/Vector3.msg --- ros-common-msgs-1.12.3/geometry_msgs/msg/Vector3.msg 2015-04-21 06:30:07.000000000 +0000 +++ ros-common-msgs-1.12.4/geometry_msgs/msg/Vector3.msg 2016-02-23 07:26:55.000000000 +0000 @@ -1,4 +1,9 @@ # This represents a vector in free space. +# It is only meant to represent a direction. Therefore, it does not +# make sense to apply a translation to it (e.g., when applying a +# generic rigid transformation to a Vector3, tf2 will only apply the +# rotation). If you want your data to be translatable too, use the +# geometry_msgs/Point message instead. float64 x float64 y diff -Nru ros-common-msgs-1.12.3/geometry_msgs/package.xml ros-common-msgs-1.12.4/geometry_msgs/package.xml --- ros-common-msgs-1.12.3/geometry_msgs/package.xml 2015-04-21 06:30:07.000000000 +0000 +++ ros-common-msgs-1.12.4/geometry_msgs/package.xml 2016-02-23 07:26:55.000000000 +0000 @@ -1,6 +1,6 @@ geometry_msgs - 1.12.3 + 1.12.4 geometry_msgs provides messages for common geometric primitives such as points, vectors, and poses. These primitives are designed diff -Nru ros-common-msgs-1.12.3/nav_msgs/CHANGELOG.rst ros-common-msgs-1.12.4/nav_msgs/CHANGELOG.rst --- ros-common-msgs-1.12.3/nav_msgs/CHANGELOG.rst 2015-04-21 06:30:07.000000000 +0000 +++ ros-common-msgs-1.12.4/nav_msgs/CHANGELOG.rst 2016-02-23 07:26:55.000000000 +0000 @@ -2,6 +2,9 @@ Changelog for package nav_msgs ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +1.12.4 (2016-02-22) +------------------- + 1.12.3 (2015-04-20) ------------------- diff -Nru ros-common-msgs-1.12.3/nav_msgs/package.xml ros-common-msgs-1.12.4/nav_msgs/package.xml --- ros-common-msgs-1.12.3/nav_msgs/package.xml 2015-04-21 06:30:07.000000000 +0000 +++ ros-common-msgs-1.12.4/nav_msgs/package.xml 2016-02-23 07:26:55.000000000 +0000 @@ -1,6 +1,6 @@ nav_msgs - 1.12.3 + 1.12.4 nav_msgs defines the common messages used to interact with the navigation stack. diff -Nru ros-common-msgs-1.12.3/sensor_msgs/CHANGELOG.rst ros-common-msgs-1.12.4/sensor_msgs/CHANGELOG.rst --- ros-common-msgs-1.12.3/sensor_msgs/CHANGELOG.rst 2015-04-21 06:30:07.000000000 +0000 +++ ros-common-msgs-1.12.4/sensor_msgs/CHANGELOG.rst 2016-02-23 07:26:55.000000000 +0000 @@ -2,6 +2,15 @@ Changelog for package sensor_msgs ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +1.12.4 (2016-02-22) +------------------- +* added type mapping and support for different types of points in point clouds +* remove boost dependency fixes `#81 `_ +* adding a BatteryState message +* fix iterator doc +* remove warning due to anonymous namespace +* Contributors: Sebastian Pütz, Tully Foote, Vincent Rabaud + 1.12.3 (2015-04-20) ------------------- diff -Nru ros-common-msgs-1.12.3/sensor_msgs/CMakeLists.txt ros-common-msgs-1.12.4/sensor_msgs/CMakeLists.txt --- ros-common-msgs-1.12.3/sensor_msgs/CMakeLists.txt 2015-04-21 06:30:07.000000000 +0000 +++ ros-common-msgs-1.12.4/sensor_msgs/CMakeLists.txt 2016-02-23 07:26:55.000000000 +0000 @@ -2,8 +2,6 @@ project(sensor_msgs) find_package(catkin REQUIRED COMPONENTS geometry_msgs message_generation std_msgs) -# We want boost/format.hpp, which isn't in its own component. -find_package(Boost REQUIRED) # For point_cloud2.py catkin_python_setup() @@ -13,6 +11,7 @@ add_message_files( DIRECTORY msg FILES + BatteryState.msg CameraInfo.msg ChannelFloat32.msg CompressedImage.msg @@ -48,8 +47,7 @@ catkin_package( INCLUDE_DIRS include - CATKIN_DEPENDS geometry_msgs message_runtime std_msgs - DEPENDS Boost) + CATKIN_DEPENDS geometry_msgs message_runtime std_msgs) install(DIRECTORY include/${PROJECT_NAME}/ DESTINATION ${CATKIN_PACKAGE_INCLUDE_DESTINATION} diff -Nru ros-common-msgs-1.12.3/sensor_msgs/include/sensor_msgs/impl/point_cloud2_iterator.h ros-common-msgs-1.12.4/sensor_msgs/include/sensor_msgs/impl/point_cloud2_iterator.h --- ros-common-msgs-1.12.3/sensor_msgs/include/sensor_msgs/impl/point_cloud2_iterator.h 2015-04-21 06:30:07.000000000 +0000 +++ ros-common-msgs-1.12.4/sensor_msgs/include/sensor_msgs/impl/point_cloud2_iterator.h 2016-02-23 07:26:55.000000000 +0000 @@ -226,11 +226,10 @@ cloud_msg_.row_step = cloud_msg_.width * cloud_msg_.point_step; cloud_msg_.data.resize(cloud_msg_.height * cloud_msg_.row_step); } -} //////////////////////////////////////////////////////////////////////////////////////////////////////////////////////// -namespace +namespace impl { /** @@ -412,5 +411,6 @@ } } +} #endif// SENSOR_MSGS_IMPL_POINT_CLOUD_ITERATOR_H diff -Nru ros-common-msgs-1.12.3/sensor_msgs/include/sensor_msgs/point_cloud2_iterator.h ros-common-msgs-1.12.4/sensor_msgs/include/sensor_msgs/point_cloud2_iterator.h --- ros-common-msgs-1.12.3/sensor_msgs/include/sensor_msgs/point_cloud2_iterator.h 2015-04-21 06:30:07.000000000 +0000 +++ ros-common-msgs-1.12.4/sensor_msgs/include/sensor_msgs/point_cloud2_iterator.h 2016-02-23 07:26:55.000000000 +0000 @@ -55,7 +55,7 @@ * // 4 is for the number of added fields. Each come in triplet: the name of the PointField, * // the number of occurences of the type in the PointField, the type of the PointField * sensor_msgs::PointCloud2Modifier modifier(cloud_msg); - * modifier.setPointCloud2FieldsByString(4, "x", 1, sensor_msgs::PointField::FLOAT32, + * modifier.setPointCloud2Fields(4, "x", 1, sensor_msgs::PointField::FLOAT32, * "y", 1, sensor_msgs::PointField::FLOAT32, * "z", 1, sensor_msgs::PointField::FLOAT32, * "rgb", 1, sensor_msgs::PointField::FLOAT32); @@ -64,6 +64,8 @@ * // so it is definitely the solution of choice for PointXYZ and PointXYZRGB * // 2 is for the number of fields to add * modifier.setPointCloud2FieldsByString(2, "xyz", "rgb"); + * // You can then reserve / resize as usual + * modifier.resize(100); * * * The second set allow you to traverse your PointCloud using an iterator: @@ -138,7 +140,7 @@ * * E.g, you create your PointCloud2 message with XYZ/RGB as follows: *
-   *   setPointCloud2FieldsByString(cloud_msg, 4, "x", 1, sensor_msgs::PointField::FLOAT32,
+   *   setPointCloud2Fields(cloud_msg, 4, "x", 1, sensor_msgs::PointField::FLOAT32,
    *                                              "y", 1, sensor_msgs::PointField::FLOAT32,
    *                                              "z", 1, sensor_msgs::PointField::FLOAT32,
    *                                              "rgb", 1, sensor_msgs::PointField::FLOAT32);
@@ -163,9 +165,8 @@
   /** A reference to the original sensor_msgs::PointCloud2 that we read */
   PointCloud2& cloud_msg_;
 };
-}
 
-namespace
+namespace impl
 {
 /** Private base class for PointCloud2Iterator and PointCloud2ConstIterator
  * T is the type of the value on which the child class will be templated
@@ -253,8 +254,6 @@
 };
 }
 
-namespace sensor_msgs
-{
 /**
  * \brief Class that can iterate over a PointCloud2
  *
@@ -279,22 +278,22 @@
  * and then access R,G,B through  iter_rgb[0], iter_rgb[1], iter_rgb[2]
  */
 template
-class PointCloud2Iterator : public PointCloud2IteratorBase
+class PointCloud2Iterator : public impl::PointCloud2IteratorBase
 {
 public:
   PointCloud2Iterator(sensor_msgs::PointCloud2 &cloud_msg, const std::string &field_name) :
-    PointCloud2IteratorBase::PointCloud2IteratorBase(cloud_msg, field_name) {}
+    impl::PointCloud2IteratorBase::PointCloud2IteratorBase(cloud_msg, field_name) {}
 };
 
 /**
  * \brief Same as a PointCloud2Iterator but for const data
  */
 template
-class PointCloud2ConstIterator : public PointCloud2IteratorBase
+class PointCloud2ConstIterator : public impl::PointCloud2IteratorBase
 {
 public:
   PointCloud2ConstIterator(const sensor_msgs::PointCloud2 &cloud_msg, const std::string &field_name) :
-    PointCloud2IteratorBase::PointCloud2IteratorBase(cloud_msg, field_name) {}
+    impl::PointCloud2IteratorBase::PointCloud2IteratorBase(cloud_msg, field_name) {}
 };
 }
 
diff -Nru ros-common-msgs-1.12.3/sensor_msgs/include/sensor_msgs/point_cloud_conversion.h ros-common-msgs-1.12.4/sensor_msgs/include/sensor_msgs/point_cloud_conversion.h
--- ros-common-msgs-1.12.3/sensor_msgs/include/sensor_msgs/point_cloud_conversion.h	2015-04-21 06:30:07.000000000 +0000
+++ ros-common-msgs-1.12.4/sensor_msgs/include/sensor_msgs/point_cloud_conversion.h	2016-02-23 07:26:55.000000000 +0000
@@ -30,6 +30,9 @@
  *  LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN
  *  ANY WAY OUT OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE
  *  POSSIBILITY OF SUCH DAMAGE.
+ *
+ * $Id$
+ *
  */
 
 #ifndef SENSOR_MSGS_POINT_CLOUD_CONVERSION_H
@@ -37,9 +40,10 @@
 
 #include 
 #include 
+#include 
 
 /** 
-  * \file Convert between the old (sensor_msgs::PointCloud) and the new (sensor_msgs::PointCloud2) format.
+  * \brief Convert between the old (sensor_msgs::PointCloud) and the new (sensor_msgs::PointCloud2) format.
   * \author Radu Bogdan Rusu
   */
 namespace sensor_msgs
@@ -112,14 +116,6 @@
     */ 
 static inline bool convertPointCloud2ToPointCloud (const sensor_msgs::PointCloud2 &input, sensor_msgs::PointCloud &output)
 {
-  // Get all fields size and check if we have non-float32 values
-  for (size_t d = 0; d < input.fields.size (); ++d)
-  {
-    if (input.fields[d].datatype != sensor_msgs::PointField::FLOAT32)
-    {
-      std::cerr << boost::str(boost::format("sensor_msgs::PointCloud accepts only float32 values, but field %d (%s) has field type %d!")%(int)d% input.fields[d].name%input.fields[d].datatype) << std::endl;
-    }
-  }
 
   output.header = input.header;
   output.points.resize (input.width * input.height);
@@ -136,6 +132,9 @@
   int x_offset = input.fields[x_idx].offset;
   int y_offset = input.fields[y_idx].offset;
   int z_offset = input.fields[z_idx].offset;
+  uint8_t x_datatype = input.fields[x_idx].datatype;
+  uint8_t y_datatype = input.fields[y_idx].datatype;
+  uint8_t z_datatype = input.fields[z_idx].datatype;
    
   // Convert the fields to channels
   int cur_c = 0;
@@ -152,16 +151,16 @@
   for (size_t cp = 0; cp < output.points.size (); ++cp)
   {
     // Copy x/y/z
-    memcpy (&output.points[cp].x, &input.data[cp * input.point_step + x_offset], sizeof (float));
-    memcpy (&output.points[cp].y, &input.data[cp * input.point_step + y_offset], sizeof (float));
-    memcpy (&output.points[cp].z, &input.data[cp * input.point_step + z_offset], sizeof (float));
+    output.points[cp].x = sensor_msgs::readPointCloud2BufferValue(&input.data[cp * input.point_step + x_offset], x_datatype);
+    output.points[cp].y = sensor_msgs::readPointCloud2BufferValue(&input.data[cp * input.point_step + y_offset], y_datatype);
+    output.points[cp].z = sensor_msgs::readPointCloud2BufferValue(&input.data[cp * input.point_step + z_offset], z_datatype);
     // Copy the rest of the data
     int cur_c = 0;
     for (size_t d = 0; d < input.fields.size (); ++d)
     {
       if ((int)input.fields[d].offset == x_offset || (int)input.fields[d].offset == y_offset || (int)input.fields[d].offset == z_offset)
         continue;
-      memcpy (&output.channels[cur_c++].values[cp], &input.data[cp * input.point_step + input.fields[d].offset], sizeof (float));
+      output.channels[cur_c++].values[cp] = sensor_msgs::readPointCloud2BufferValue(&input.data[cp * input.point_step + input.fields[d].offset], input.fields[d].datatype);
     }
   }
   return (true);
diff -Nru ros-common-msgs-1.12.3/sensor_msgs/include/sensor_msgs/point_field_conversion.h ros-common-msgs-1.12.4/sensor_msgs/include/sensor_msgs/point_field_conversion.h
--- ros-common-msgs-1.12.3/sensor_msgs/include/sensor_msgs/point_field_conversion.h	1970-01-01 00:00:00.000000000 +0000
+++ ros-common-msgs-1.12.4/sensor_msgs/include/sensor_msgs/point_field_conversion.h	2016-02-23 07:26:55.000000000 +0000
@@ -0,0 +1,178 @@
+/*
+ * Software License Agreement (BSD License)
+ *
+ * Robot Operating System code by the University of Osnabrück
+ * Copyright (c) 2015, University of Osnabrück
+ * All rights reserved.
+ *
+ * Redistribution and use in source and binary forms, with or without
+ * modification, are permitted provided that the following conditions
+ * are met:
+ *
+ *   1. Redistributions of source code must retain the above 
+ *      copyright notice, this list of conditions and the following
+ *      disclaimer.
+ *
+ *   2. Redistributions in binary form must reproduce the above 
+ *      copyright notice, this list of conditions and the following
+ *      disclaimer in the documentation and/or other materials provided
+ *      with the distribution.
+ *
+ *   3. Neither the name of the copyright holder nor the names of its
+ *      contributors may be used to endorse or promote products derived
+ *      from this software without specific prior written permission.
+ *
+ *
+ * THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS
+ * "AS IS" AND ANY EXPRESS OR IMPLIED WARRANTIES, INCLUDING, BUT NOT LIMITED
+ * TO, THE IMPLIED WARRANTIES OF MERCHANTABILITY AND FITNESS FOR A PARTICULAR
+ * PURPOSE ARE DISCLAIMED. IN NO EVENT SHALL THE COPYRIGHT HOLDER OR
+ * CONTRIBUTORS BE LIABLE FOR ANY DIRECT, INDIRECT, INCIDENTAL, SPECIAL,
+ * EXEMPLARY, OR CONSEQUENTIAL DAMAGES (INCLUDING, BUT NOT LIMITED TO,
+ * PROCUREMENT OF SUBSTITUTE GOODS OR SERVICES; LOSS OF USE, DATA, OR PROFITS;
+ * OR BUSINESS INTERRUPTION) HOWEVER CAUSED AND ON ANY THEORY OF LIABILITY,
+ * WHETHER IN CONTRACT, STRICT LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR
+ * OTHERWISE) ARISING IN ANY WAY OUT OF THE USE OF THIS SOFTWARE, EVEN IF 
+ * ADVISED OF THE POSSIBILITY OF SUCH DAMAGE.
+ *
+ *
+ *
+ * point_field_conversion.h
+ *
+ * Created on: 16.07.2015
+ *  Authors: Sebastian Pütz 
+ */
+
+#ifndef SENSOR_MSGS_POINT_FIELD_CONVERSION_H
+#define SENSOR_MSGS_POINT_FIELD_CONVERSION_H
+
+/** 
+  * \brief  This file provides a type to enum mapping for the different
+  *         PointField types and methods to read and write in 
+  *         a PointCloud2 buffer for the different PointField types.
+  * \author Sebastian Pütz
+  */
+namespace sensor_msgs{
+  /*!
+   * \Enum to type mapping.
+   */
+  template struct pointFieldTypeAsType {};
+  template<> struct pointFieldTypeAsType    { typedef int8_t   type; };
+  template<> struct pointFieldTypeAsType   { typedef uint8_t  type; };
+  template<> struct pointFieldTypeAsType   { typedef int16_t  type; };
+  template<> struct pointFieldTypeAsType  { typedef uint16_t type; };
+  template<> struct pointFieldTypeAsType   { typedef int32_t  type; };
+  template<> struct pointFieldTypeAsType  { typedef uint32_t type; };
+  template<> struct pointFieldTypeAsType { typedef float    type; };
+  template<> struct pointFieldTypeAsType { typedef double   type; };
+  
+  /*!
+   * \Type to enum mapping.
+   */
+  template struct typeAsPointFieldType {};
+  template<> struct typeAsPointFieldType   { static const uint8_t value = sensor_msgs::PointField::INT8;    };
+  template<> struct typeAsPointFieldType  { static const uint8_t value = sensor_msgs::PointField::UINT8;   };
+  template<> struct typeAsPointFieldType  { static const uint8_t value = sensor_msgs::PointField::INT16;   };
+  template<> struct typeAsPointFieldType { static const uint8_t value = sensor_msgs::PointField::UINT16;  };
+  template<> struct typeAsPointFieldType  { static const uint8_t value = sensor_msgs::PointField::INT32;   };
+  template<> struct typeAsPointFieldType { static const uint8_t value = sensor_msgs::PointField::UINT32;  };
+  template<> struct typeAsPointFieldType    { static const uint8_t value = sensor_msgs::PointField::FLOAT32; };
+  template<> struct typeAsPointFieldType   { static const uint8_t value = sensor_msgs::PointField::FLOAT64; };
+ 
+  /*!
+   * \Converts a value at the given pointer position, interpreted as the datatype
+   *  specified by the given template argument point_field_type, to the given
+   *  template type T and returns it.
+   * \param data_ptr            pointer into the point cloud 2 buffer
+   * \tparam point_field_type   sensor_msgs::PointField datatype value
+   * \tparam T                  return type
+   */
+  template
+    inline T readPointCloud2BufferValue(const unsigned char* data_ptr){
+      typedef typename pointFieldTypeAsType::type type;
+      return static_cast(*(reinterpret_cast(data_ptr)));
+    }
+  
+  /*!
+   * \Converts a value at the given pointer position interpreted as the datatype
+   *  specified by the given datatype parameter to the given template type and returns it.
+   * \param data_ptr    pointer into the point cloud 2 buffer
+   * \param datatype    sensor_msgs::PointField datatype value
+   * \tparam T          return type
+   */
+  template
+    inline T readPointCloud2BufferValue(const unsigned char* data_ptr, const unsigned char datatype){
+      switch(datatype){
+        case sensor_msgs::PointField::INT8:
+          return readPointCloud2BufferValue(data_ptr);
+        case sensor_msgs::PointField::UINT8:
+          return readPointCloud2BufferValue(data_ptr);
+        case sensor_msgs::PointField::INT16:
+          return readPointCloud2BufferValue(data_ptr);
+        case sensor_msgs::PointField::UINT16:
+          return readPointCloud2BufferValue(data_ptr);
+        case sensor_msgs::PointField::INT32:
+          return readPointCloud2BufferValue(data_ptr);
+        case sensor_msgs::PointField::UINT32:
+          return readPointCloud2BufferValue(data_ptr);
+        case sensor_msgs::PointField::FLOAT32:
+          return readPointCloud2BufferValue(data_ptr);
+        case sensor_msgs::PointField::FLOAT64:
+          return readPointCloud2BufferValue(data_ptr);
+      }
+    }
+
+  /*!
+   * \Inserts a given value at the given point position interpreted as the datatype
+   *  specified by the template argument point_field_type.
+   * \param data_ptr            pointer into the point cloud 2 buffer
+   * \param value               the value to insert
+   * \tparam point_field_type   sensor_msgs::PointField datatype value
+   * \tparam T                  type of the value to insert
+   */
+  template
+    inline void writePointCloud2BufferValue(unsigned char* data_ptr, T value){
+      typedef typename pointFieldTypeAsType::type type;
+      *(reinterpret_cast(data_ptr)) = static_cast(value);
+    }
+
+  /*!
+   * \Inserts a given value at the given point position interpreted as the datatype
+   *  specified by the given datatype parameter.
+   * \param data_ptr    pointer into the point cloud 2 buffer
+   * \param datatype    sensor_msgs::PointField datatype value
+   * \param value       the value to insert
+   * \tparam T          type of the value to insert
+   */
+  template
+    inline void writePointCloud2BufferValue(unsigned char* data_ptr, const unsigned char datatype, T value){
+      switch(datatype){
+        case sensor_msgs::PointField::INT8:
+          writePointCloud2BufferValue(data_ptr, value);
+          break;
+        case sensor_msgs::PointField::UINT8:
+          writePointCloud2BufferValue(data_ptr, value);
+          break;
+        case sensor_msgs::PointField::INT16:
+          writePointCloud2BufferValue(data_ptr, value);
+          break;
+        case sensor_msgs::PointField::UINT16:
+          writePointCloud2BufferValue(data_ptr, value);
+          break;
+        case sensor_msgs::PointField::INT32:
+          writePointCloud2BufferValue(data_ptr, value);
+          break;
+        case sensor_msgs::PointField::UINT32:
+          writePointCloud2BufferValue(data_ptr, value);
+          break;
+        case sensor_msgs::PointField::FLOAT32:
+          writePointCloud2BufferValue(data_ptr, value);
+          break;
+        case sensor_msgs::PointField::FLOAT64:
+          writePointCloud2BufferValue(data_ptr, value);
+          break;
+      }
+    }
+}
+
+#endif /* point_field_conversion.h */
diff -Nru ros-common-msgs-1.12.3/sensor_msgs/msg/BatteryState.msg ros-common-msgs-1.12.4/sensor_msgs/msg/BatteryState.msg
--- ros-common-msgs-1.12.3/sensor_msgs/msg/BatteryState.msg	1970-01-01 00:00:00.000000000 +0000
+++ ros-common-msgs-1.12.4/sensor_msgs/msg/BatteryState.msg	2016-02-23 07:26:55.000000000 +0000
@@ -0,0 +1,49 @@
+
+# Constants are chosen to match the enums in the linux kernel
+# defined in include/linux/power_supply.h as of version 3.7
+# The one difference is for style reasons the constants are
+# all uppercase not mixed case.
+
+# Power supply status constants
+uint8 POWER_SUPPLY_STATUS_UNKNOWN = 0
+uint8 POWER_SUPPLY_STATUS_CHARGING = 1
+uint8 POWER_SUPPLY_STATUS_DISCHARGING = 2
+uint8 POWER_SUPPLY_STATUS_NOT_CHARGING = 3
+uint8 POWER_SUPPLY_STATUS_FULL = 4
+
+# Power supply health constants
+uint8 POWER_SUPPLY_HEALTH_UNKNOWN = 0
+uint8 POWER_SUPPLY_HEALTH_GOOD = 1
+uint8 POWER_SUPPLY_HEALTH_OVERHEAT = 2
+uint8 POWER_SUPPLY_HEALTH_DEAD = 3
+uint8 POWER_SUPPLY_HEALTH_OVERVOLTAGE = 4
+uint8 POWER_SUPPLY_HEALTH_UNSPEC_FAILURE = 5
+uint8 POWER_SUPPLY_HEALTH_COLD = 6
+uint8 POWER_SUPPLY_HEALTH_WATCHDOG_TIMER_EXPIRE = 7
+uint8 POWER_SUPPLY_HEALTH_SAFETY_TIMER_EXPIRE = 8
+
+# Power supply technology (chemistry) constants
+uint8 POWER_SUPPLY_TECHNOLOGY_UNKNOWN = 0
+uint8 POWER_SUPPLY_TECHNOLOGY_NIMH = 1
+uint8 POWER_SUPPLY_TECHNOLOGY_LION = 2
+uint8 POWER_SUPPLY_TECHNOLOGY_LIPO = 3
+uint8 POWER_SUPPLY_TECHNOLOGY_LIFE = 4
+uint8 POWER_SUPPLY_TECHNOLOGY_NICD = 5
+uint8 POWER_SUPPLY_TECHNOLOGY_LIMN = 6
+
+Header  header
+float32 voltage          # Voltage in Volts (Mandatory)
+float32 current          # Negative when discharging (A)  (If unmeasured NaN)
+float32 charge           # Current charge in Ah  (If unmeasured NaN)
+float32 capacity         # Capacity in Ah (last full capacity)  (If unmeasured NaN)
+float32 design_capacity  # Capacity in Ah (design capacity)  (If unmeasured NaN)
+float32 percentage       # Charge percentage on 0 to 1 range  (If unmeasured NaN)
+uint8   power_supply_status     # The charging status as reported. Values defined above
+uint8   power_supply_health     # The battery health metric. Values defined above
+uint8   power_supply_technology # The battery chemistry. Values defined above
+bool    present          # True if the battery is present
+
+float32[] cell_voltage   # An array of individual cell voltages for each cell in the pack
+                         # If individual voltages unknown but number of cells known set each to NaN
+string location          # The location into which the battery is inserted. (slot number or plug)
+string serial_number     # The best approximation of the battery serial number
diff -Nru ros-common-msgs-1.12.3/sensor_msgs/package.xml ros-common-msgs-1.12.4/sensor_msgs/package.xml
--- ros-common-msgs-1.12.3/sensor_msgs/package.xml	2015-04-21 06:30:07.000000000 +0000
+++ ros-common-msgs-1.12.4/sensor_msgs/package.xml	2016-02-23 07:26:55.000000000 +0000
@@ -1,6 +1,6 @@
 
   sensor_msgs
-  1.12.3
+  1.12.4
   
     This package defines messages for commonly used sensors, including
     cameras and scanning laser rangefinders.
diff -Nru ros-common-msgs-1.12.3/shape_msgs/CHANGELOG.rst ros-common-msgs-1.12.4/shape_msgs/CHANGELOG.rst
--- ros-common-msgs-1.12.3/shape_msgs/CHANGELOG.rst	2015-04-21 06:30:07.000000000 +0000
+++ ros-common-msgs-1.12.4/shape_msgs/CHANGELOG.rst	2016-02-23 07:26:55.000000000 +0000
@@ -2,6 +2,9 @@
 Changelog for package shape_msgs
 ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^
 
+1.12.4 (2016-02-22)
+-------------------
+
 1.12.3 (2015-04-20)
 -------------------
 
diff -Nru ros-common-msgs-1.12.3/shape_msgs/package.xml ros-common-msgs-1.12.4/shape_msgs/package.xml
--- ros-common-msgs-1.12.3/shape_msgs/package.xml	2015-04-21 06:30:07.000000000 +0000
+++ ros-common-msgs-1.12.4/shape_msgs/package.xml	2016-02-23 07:26:55.000000000 +0000
@@ -1,6 +1,6 @@
 
   shape_msgs
-  1.12.3
+  1.12.4
   
     This package contains messages for defining shapes, such as simple solid
     object primitives (cube, sphere, etc), planes, and meshes. 
diff -Nru ros-common-msgs-1.12.3/stereo_msgs/CHANGELOG.rst ros-common-msgs-1.12.4/stereo_msgs/CHANGELOG.rst
--- ros-common-msgs-1.12.3/stereo_msgs/CHANGELOG.rst	2015-04-21 06:30:07.000000000 +0000
+++ ros-common-msgs-1.12.4/stereo_msgs/CHANGELOG.rst	2016-02-23 07:26:55.000000000 +0000
@@ -2,6 +2,9 @@
 Changelog for package stereo_msgs
 ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^
 
+1.12.4 (2016-02-22)
+-------------------
+
 1.12.3 (2015-04-20)
 -------------------
 
diff -Nru ros-common-msgs-1.12.3/stereo_msgs/package.xml ros-common-msgs-1.12.4/stereo_msgs/package.xml
--- ros-common-msgs-1.12.3/stereo_msgs/package.xml	2015-04-21 06:30:07.000000000 +0000
+++ ros-common-msgs-1.12.4/stereo_msgs/package.xml	2016-02-23 07:26:55.000000000 +0000
@@ -1,6 +1,6 @@
 
   stereo_msgs
-  1.12.3
+  1.12.4
   
     stereo_msgs contains messages specific to stereo processing, such as disparity images.
   
diff -Nru ros-common-msgs-1.12.3/trajectory_msgs/CHANGELOG.rst ros-common-msgs-1.12.4/trajectory_msgs/CHANGELOG.rst
--- ros-common-msgs-1.12.3/trajectory_msgs/CHANGELOG.rst	2015-04-21 06:30:07.000000000 +0000
+++ ros-common-msgs-1.12.4/trajectory_msgs/CHANGELOG.rst	2016-02-23 07:26:55.000000000 +0000
@@ -2,6 +2,9 @@
 Changelog for package trajectory_msgs
 ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^
 
+1.12.4 (2016-02-22)
+-------------------
+
 1.12.3 (2015-04-20)
 -------------------
 
diff -Nru ros-common-msgs-1.12.3/trajectory_msgs/package.xml ros-common-msgs-1.12.4/trajectory_msgs/package.xml
--- ros-common-msgs-1.12.3/trajectory_msgs/package.xml	2015-04-21 06:30:07.000000000 +0000
+++ ros-common-msgs-1.12.4/trajectory_msgs/package.xml	2016-02-23 07:26:55.000000000 +0000
@@ -1,6 +1,6 @@
 
   trajectory_msgs
-  1.12.3
+  1.12.4
   
     This package defines messages for defining robot trajectories. These messages are
     also the building blocks of most of the
diff -Nru ros-common-msgs-1.12.3/visualization_msgs/CHANGELOG.rst ros-common-msgs-1.12.4/visualization_msgs/CHANGELOG.rst
--- ros-common-msgs-1.12.3/visualization_msgs/CHANGELOG.rst	2015-04-21 06:30:07.000000000 +0000
+++ ros-common-msgs-1.12.4/visualization_msgs/CHANGELOG.rst	2016-02-23 07:26:55.000000000 +0000
@@ -2,6 +2,9 @@
 Changelog for package visualization_msgs
 ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^
 
+1.12.4 (2016-02-22)
+-------------------
+
 1.12.3 (2015-04-20)
 -------------------
 
diff -Nru ros-common-msgs-1.12.3/visualization_msgs/package.xml ros-common-msgs-1.12.4/visualization_msgs/package.xml
--- ros-common-msgs-1.12.3/visualization_msgs/package.xml	2015-04-21 06:30:07.000000000 +0000
+++ ros-common-msgs-1.12.4/visualization_msgs/package.xml	2016-02-23 07:26:55.000000000 +0000
@@ -1,6 +1,6 @@
 
   visualization_msgs
-  1.12.3
+  1.12.4
   
     visualization_msgs is a set of messages used by higher level packages, such as rviz, that deal in visualization-specific data.