[ros-common-msgs] 01/04: New upstream version 1.12.5

Jochen Sprickerhof jspricke at moszumanska.debian.org
Tue Oct 4 14:35:52 UTC 2016


This is an automated email from the git hooks/post-receive script.

jspricke pushed a commit to annotated tag debian/1.12.5-1
in repository ros-common-msgs.

commit 1f502c6593fc5aaf28c6615f0406df04aee13ee0
Author: Jochen Sprickerhof <git at jochen.sprickerhof.de>
Date:   Tue Oct 4 15:22:24 2016 +0200

    New upstream version 1.12.5
---
 actionlib_msgs/CHANGELOG.rst                       |  7 +-
 actionlib_msgs/package.xml                         |  2 +-
 common_msgs/CHANGELOG.rst                          |  3 +
 common_msgs/package.xml                            |  2 +-
 diagnostic_msgs/CHANGELOG.rst                      |  3 +
 diagnostic_msgs/package.xml                        |  2 +-
 geometry_msgs/CHANGELOG.rst                        |  5 ++
 geometry_msgs/msg/Pose.msg                         |  2 +-
 geometry_msgs/package.xml                          |  2 +-
 nav_msgs/CHANGELOG.rst                             |  3 +
 nav_msgs/package.xml                               |  2 +-
 sensor_msgs/CHANGELOG.rst                          |  7 ++
 sensor_msgs/include/sensor_msgs/image_encodings.h  | 66 +++++++++---------
 .../include/sensor_msgs/point_cloud2_iterator.h    |  2 +-
 sensor_msgs/msg/CameraInfo.msg                     |  2 +-
 sensor_msgs/package.xml                            |  2 +-
 sensor_msgs/src/sensor_msgs/point_cloud2.py        |  2 +-
 sensor_msgs/test/CMakeLists.txt                    |  1 +
 sensor_msgs/test/test_image_encodings.cpp          | 79 ++++++++++++++++++++++
 shape_msgs/CHANGELOG.rst                           |  3 +
 shape_msgs/package.xml                             |  2 +-
 stereo_msgs/CHANGELOG.rst                          |  7 +-
 stereo_msgs/package.xml                            |  2 +-
 trajectory_msgs/CHANGELOG.rst                      |  7 +-
 trajectory_msgs/package.xml                        |  2 +-
 visualization_msgs/CHANGELOG.rst                   |  7 +-
 visualization_msgs/package.xml                     |  2 +-
 27 files changed, 173 insertions(+), 53 deletions(-)

diff --git a/actionlib_msgs/CHANGELOG.rst b/actionlib_msgs/CHANGELOG.rst
index 190cbd9..2cc68b4 100644
--- a/actionlib_msgs/CHANGELOG.rst
+++ b/actionlib_msgs/CHANGELOG.rst
@@ -2,6 +2,11 @@
 Changelog for package actionlib_msgs
 ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^
 
+1.12.5 (2016-09-30)
+-------------------
+* Fix spelling mistakes
+* Contributors: trorornmn
+
 1.12.4 (2016-02-22)
 -------------------
 
@@ -50,7 +55,7 @@ Changelog for package actionlib_msgs
 
 1.10.5 (2014-02-25)
 -------------------
-* removing usage of catkin function not guarenteed available fixes `#30 <https://github.com/ros/common_msgs/issues/30>`_
+* removing usage of catkin function not guaranteed available fixes `#30 <https://github.com/ros/common_msgs/issues/30>`_
 * Contributors: Tully Foote
 
 1.10.4 (2014-02-18)
diff --git a/actionlib_msgs/package.xml b/actionlib_msgs/package.xml
index 5cd9fa3..2147c88 100644
--- a/actionlib_msgs/package.xml
+++ b/actionlib_msgs/package.xml
@@ -1,6 +1,6 @@
 <package>
   <name>actionlib_msgs</name>
-  <version>1.12.4</version>
+  <version>1.12.5</version>
   <description>
      actionlib_msgs defines the common messages to interact with an
      action server and an action client.  For full documentation of
diff --git a/common_msgs/CHANGELOG.rst b/common_msgs/CHANGELOG.rst
index 53e7f20..5a1f178 100644
--- a/common_msgs/CHANGELOG.rst
+++ b/common_msgs/CHANGELOG.rst
@@ -2,6 +2,9 @@
 Changelog for package common_msgs
 ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^
 
+1.12.5 (2016-09-30)
+-------------------
+
 1.12.4 (2016-02-22)
 -------------------
 
diff --git a/common_msgs/package.xml b/common_msgs/package.xml
index bd9126c..54e67a6 100644
--- a/common_msgs/package.xml
+++ b/common_msgs/package.xml
@@ -1,6 +1,6 @@
 <package>
   <name>common_msgs</name>
-  <version>1.12.4</version>
+  <version>1.12.5</version>
   <description>
     common_msgs contains messages that are widely used by other ROS packages.
     These includes messages for
diff --git a/diagnostic_msgs/CHANGELOG.rst b/diagnostic_msgs/CHANGELOG.rst
index 9e1f834..eabdc74 100644
--- a/diagnostic_msgs/CHANGELOG.rst
+++ b/diagnostic_msgs/CHANGELOG.rst
@@ -2,6 +2,9 @@
 Changelog for package diagnostic_msgs
 ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^
 
+1.12.5 (2016-09-30)
+-------------------
+
 1.12.4 (2016-02-22)
 -------------------
 * diagnostic_msgs: Add messages for service used to add diagnostics to aggregator
diff --git a/diagnostic_msgs/package.xml b/diagnostic_msgs/package.xml
index d657cf5..3e9568c 100644
--- a/diagnostic_msgs/package.xml
+++ b/diagnostic_msgs/package.xml
@@ -1,6 +1,6 @@
 <package>
   <name>diagnostic_msgs</name>
-  <version>1.12.4</version>
+  <version>1.12.5</version>
   <description>
     This package holds the diagnostic messages which provide the
     standardized interface for the diagnostic and runtime monitoring
diff --git a/geometry_msgs/CHANGELOG.rst b/geometry_msgs/CHANGELOG.rst
index 5143659..cdc1fbc 100644
--- a/geometry_msgs/CHANGELOG.rst
+++ b/geometry_msgs/CHANGELOG.rst
@@ -2,6 +2,11 @@
 Changelog for package geometry_msgs
 ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^
 
+1.12.5 (2016-09-30)
+-------------------
+* Fix spelling mistakes
+* Contributors: trorornmn
+
 1.12.4 (2016-02-22)
 -------------------
 * clarify the definition of a Vector3
diff --git a/geometry_msgs/msg/Pose.msg b/geometry_msgs/msg/Pose.msg
index b81919c..763708f 100644
--- a/geometry_msgs/msg/Pose.msg
+++ b/geometry_msgs/msg/Pose.msg
@@ -1,3 +1,3 @@
-# A representation of pose in free space, composed of postion and orientation. 
+# A representation of pose in free space, composed of position and orientation. 
 Point position
 Quaternion orientation
diff --git a/geometry_msgs/package.xml b/geometry_msgs/package.xml
index 1f19f49..d9e5384 100644
--- a/geometry_msgs/package.xml
+++ b/geometry_msgs/package.xml
@@ -1,6 +1,6 @@
 <package>
   <name>geometry_msgs</name>
-  <version>1.12.4</version>
+  <version>1.12.5</version>
   <description>
     geometry_msgs provides messages for common geometric primitives
     such as points, vectors, and poses. These primitives are designed
diff --git a/nav_msgs/CHANGELOG.rst b/nav_msgs/CHANGELOG.rst
index b0705ce..d63b680 100644
--- a/nav_msgs/CHANGELOG.rst
+++ b/nav_msgs/CHANGELOG.rst
@@ -2,6 +2,9 @@
 Changelog for package nav_msgs
 ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^
 
+1.12.5 (2016-09-30)
+-------------------
+
 1.12.4 (2016-02-22)
 -------------------
 
diff --git a/nav_msgs/package.xml b/nav_msgs/package.xml
index 3159f5f..356ef2c 100644
--- a/nav_msgs/package.xml
+++ b/nav_msgs/package.xml
@@ -1,6 +1,6 @@
 <package>
   <name>nav_msgs</name>
-  <version>1.12.4</version>
+  <version>1.12.5</version>
   <description>
     nav_msgs defines the common messages used to interact with the
     <a href="http://wiki.ros.org/navigation">navigation</a> stack.
diff --git a/sensor_msgs/CHANGELOG.rst b/sensor_msgs/CHANGELOG.rst
index 3d8b7d1..37b3a2f 100644
--- a/sensor_msgs/CHANGELOG.rst
+++ b/sensor_msgs/CHANGELOG.rst
@@ -2,6 +2,13 @@
 Changelog for package sensor_msgs
 ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^
 
+1.12.5 (2016-09-30)
+-------------------
+* Deal with abstract image encodings
+* Fix spelling mistakes
+* Fix year
+* Contributors: Jochen Sprickerhof, Kentaro Wada, trorornmn
+
 1.12.4 (2016-02-22)
 -------------------
 * added type mapping and support for different types of points in point clouds
diff --git a/sensor_msgs/include/sensor_msgs/image_encodings.h b/sensor_msgs/include/sensor_msgs/image_encodings.h
index 9c90384..0180491 100644
--- a/sensor_msgs/include/sensor_msgs/image_encodings.h
+++ b/sensor_msgs/include/sensor_msgs/image_encodings.h
@@ -99,6 +99,10 @@ namespace sensor_msgs
     // with an 8-bit depth
     const std::string YUV422="yuv422";
 
+    // Prefixes for abstract image encodings
+    const std::string ABSTRACT_ENCODING_PREFIXES[] = {
+        "8UC", "8SC", "16UC", "16SC", "32SC", "32FC", "64FC"};
+
     // Utility functions for inspecting an encoding string
     static inline bool isColor(const std::string& encoding)
     {
@@ -154,23 +158,19 @@ namespace sensor_msgs
         return 1;
 
       // Now all the generic content encodings
-#define CHECK_CHANNELS(N)                       \
-      if (encoding == TYPE_8UC##N  ||           \
-          encoding == TYPE_8SC##N  ||           \
-          encoding == TYPE_16UC##N ||           \
-          encoding == TYPE_16SC##N ||           \
-          encoding == TYPE_32SC##N ||           \
-          encoding == TYPE_32FC##N ||           \
-          encoding == TYPE_64FC##N)             \
-        return N;                               \
-      /***/
-      
-      CHECK_CHANNELS(1);
-      CHECK_CHANNELS(2);
-      CHECK_CHANNELS(3);
-      CHECK_CHANNELS(4);
-
-#undef CHECK_CHANNELS
+      // TODO: Rewrite with regex when ROS supports C++11
+      for (size_t i=0; i < sizeof(ABSTRACT_ENCODING_PREFIXES) / sizeof(*ABSTRACT_ENCODING_PREFIXES); i++)
+      {
+        std::string prefix = ABSTRACT_ENCODING_PREFIXES[i];
+        if (encoding.substr(0, prefix.size()) != prefix)
+          continue;
+        if (encoding.size() == prefix.size())
+          return 1;  // ex. 8UC -> 1
+        int n_channel = atoi(encoding.substr(prefix.size(),
+                                             encoding.size() - prefix.size()).c_str());  // ex. 8UC5 -> 5
+        if (n_channel != 0)
+          return n_channel;  // valid encoding string
+      }
 
       if (encoding == YUV422)
         return 2;
@@ -205,24 +205,20 @@ namespace sensor_msgs
           encoding == BAYER_GRBG16)
         return 16;
 
-      // B = bits (8, 16, ...), T = type (U, S, F)
-#define CHECK_BIT_DEPTH(B, T)                   \
-      if (encoding == TYPE_##B##T##C1 ||        \
-          encoding == TYPE_##B##T##C2 ||        \
-          encoding == TYPE_##B##T##C3 ||        \
-          encoding == TYPE_##B##T##C4)          \
-        return B;                               \
-      /***/
-
-      CHECK_BIT_DEPTH(8, U);
-      CHECK_BIT_DEPTH(8, S);
-      CHECK_BIT_DEPTH(16, U);
-      CHECK_BIT_DEPTH(16, S);
-      CHECK_BIT_DEPTH(32, S);
-      CHECK_BIT_DEPTH(32, F);
-      CHECK_BIT_DEPTH(64, F);
-
-#undef CHECK_BIT_DEPTH
+      // Now all the generic content encodings
+      // TODO: Rewrite with regex when ROS supports C++11
+      for (size_t i=0; i < sizeof(ABSTRACT_ENCODING_PREFIXES) / sizeof(*ABSTRACT_ENCODING_PREFIXES); i++)
+      {
+        std::string prefix = ABSTRACT_ENCODING_PREFIXES[i];
+        if (encoding.substr(0, prefix.size()) != prefix)
+          continue;
+        if (encoding.size() == prefix.size())
+          return atoi(prefix.c_str());  // ex. 8UC -> 8
+        int n_channel = atoi(encoding.substr(prefix.size(),
+                                             encoding.size() - prefix.size()).c_str());  // ex. 8UC10 -> 10
+        if (n_channel != 0)
+          return atoi(prefix.c_str());  // valid encoding string
+      }
 
       if (encoding == YUV422)
         return 8;
diff --git a/sensor_msgs/include/sensor_msgs/point_cloud2_iterator.h b/sensor_msgs/include/sensor_msgs/point_cloud2_iterator.h
index 8bbc0e1..5b9c7a1 100644
--- a/sensor_msgs/include/sensor_msgs/point_cloud2_iterator.h
+++ b/sensor_msgs/include/sensor_msgs/point_cloud2_iterator.h
@@ -53,7 +53,7 @@
  *   cloud_msgs.height = 1;  cloud_msgs.width = 4;
  *   // Set the point fields to xyzrgb and resize the vector with the following command
  *   // 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
+ *   // the number of occurrences of the type in the PointField, the type of the PointField
  *   sensor_msgs::PointCloud2Modifier modifier(cloud_msg);
  *   modifier.setPointCloud2Fields(4, "x", 1, sensor_msgs::PointField::FLOAT32,
  *                                            "y", 1, sensor_msgs::PointField::FLOAT32,
diff --git a/sensor_msgs/msg/CameraInfo.msg b/sensor_msgs/msg/CameraInfo.msg
index e498e88..924034c 100644
--- a/sensor_msgs/msg/CameraInfo.msg
+++ b/sensor_msgs/msg/CameraInfo.msg
@@ -56,7 +56,7 @@ uint32 width
 
 # The distortion model used. Supported models are listed in
 # sensor_msgs/distortion_models.h. For most cameras, "plumb_bob" - a
-# simple model of radial and tangential distortion - is sufficent.
+# simple model of radial and tangential distortion - is sufficient.
 string distortion_model
 
 # The distortion parameters, size depending on the distortion model.
diff --git a/sensor_msgs/package.xml b/sensor_msgs/package.xml
index 8eb433d..7f27328 100644
--- a/sensor_msgs/package.xml
+++ b/sensor_msgs/package.xml
@@ -1,6 +1,6 @@
 <package>
   <name>sensor_msgs</name>
-  <version>1.12.4</version>
+  <version>1.12.5</version>
   <description>
     This package defines messages for commonly used sensors, including
     cameras and scanning laser rangefinders.
diff --git a/sensor_msgs/src/sensor_msgs/point_cloud2.py b/sensor_msgs/src/sensor_msgs/point_cloud2.py
index 9bfc0c8..b19f103 100644
--- a/sensor_msgs/src/sensor_msgs/point_cloud2.py
+++ b/sensor_msgs/src/sensor_msgs/point_cloud2.py
@@ -2,7 +2,7 @@
 
 # Software License Agreement (BSD License)
 #
-# Copyright (c) 208, Willow Garage, Inc.
+# Copyright (c) 2008, Willow Garage, Inc.
 # All rights reserved.
 #
 # Redistribution and use in source and binary forms, with or without
diff --git a/sensor_msgs/test/CMakeLists.txt b/sensor_msgs/test/CMakeLists.txt
index 8a5acb2..fb2f889 100644
--- a/sensor_msgs/test/CMakeLists.txt
+++ b/sensor_msgs/test/CMakeLists.txt
@@ -1,2 +1,3 @@
 include_directories(${catkin_INCLUDE_DIRS})
 catkin_add_gtest(sensor_msgs_test main.cpp)
+catkin_add_gtest(sensor_msgs_test_image_encodings test_image_encodings.cpp)
diff --git a/sensor_msgs/test/test_image_encodings.cpp b/sensor_msgs/test/test_image_encodings.cpp
new file mode 100644
index 0000000..8b20c01
--- /dev/null
+++ b/sensor_msgs/test/test_image_encodings.cpp
@@ -0,0 +1,79 @@
+/*
+ * Software License Agreement (BSD License)
+ *
+ *  Copyright (c) 2016, Kentaro Wada.
+ *  All rights reserved.
+ *
+ *  Redistribution and use in source and binary forms, with or without
+ *  modification, are permitted provided that the following conditions
+ *  are met:
+ *
+ *   * Redistributions of source code must retain the above copyright
+ *     notice, this list of conditions and the following disclaimer.
+ *   * 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.
+ *   * Neither the name of Willow Garage, Inc. 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 OWNER 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.
+ */
+
+#include <gtest/gtest.h>
+
+#include <sensor_msgs/image_encodings.h>
+
+TEST(sensor_msgs, NumChannels)
+{
+  ASSERT_EQ(sensor_msgs::image_encodings::numChannels("mono8"), 1);
+  ASSERT_EQ(sensor_msgs::image_encodings::numChannels("rgb8"), 3);
+  ASSERT_EQ(sensor_msgs::image_encodings::numChannels("8UC"), 1);
+  ASSERT_EQ(sensor_msgs::image_encodings::numChannels("8UC3"), 3);
+  ASSERT_EQ(sensor_msgs::image_encodings::numChannels("8UC10"), 10);
+  ASSERT_EQ(sensor_msgs::image_encodings::numChannels("16UC"), 1);
+  ASSERT_EQ(sensor_msgs::image_encodings::numChannels("16UC3"), 3);
+  ASSERT_EQ(sensor_msgs::image_encodings::numChannels("16UC10"), 10);
+  ASSERT_EQ(sensor_msgs::image_encodings::numChannels("32SC"), 1);
+  ASSERT_EQ(sensor_msgs::image_encodings::numChannels("32SC3"), 3);
+  ASSERT_EQ(sensor_msgs::image_encodings::numChannels("32SC10"), 10);
+  ASSERT_EQ(sensor_msgs::image_encodings::numChannels("64FC"), 1);
+  ASSERT_EQ(sensor_msgs::image_encodings::numChannels("64FC3"), 3);
+  ASSERT_EQ(sensor_msgs::image_encodings::numChannels("64FC10"), 10);
+}
+
+TEST(sensor_msgs, bitDepth)
+{
+  ASSERT_EQ(sensor_msgs::image_encodings::bitDepth("mono8"), 8);
+  ASSERT_EQ(sensor_msgs::image_encodings::bitDepth("rgb8"), 8);
+  ASSERT_EQ(sensor_msgs::image_encodings::bitDepth("8UC"), 8);
+  ASSERT_EQ(sensor_msgs::image_encodings::bitDepth("8UC3"), 8);
+  ASSERT_EQ(sensor_msgs::image_encodings::bitDepth("8UC10"), 8);
+  ASSERT_EQ(sensor_msgs::image_encodings::bitDepth("16UC"), 16);
+  ASSERT_EQ(sensor_msgs::image_encodings::bitDepth("16UC3"), 16);
+  ASSERT_EQ(sensor_msgs::image_encodings::bitDepth("16UC10"), 16);
+  ASSERT_EQ(sensor_msgs::image_encodings::bitDepth("32SC"), 32);
+  ASSERT_EQ(sensor_msgs::image_encodings::bitDepth("32SC3"), 32);
+  ASSERT_EQ(sensor_msgs::image_encodings::bitDepth("32SC10"), 32);
+  ASSERT_EQ(sensor_msgs::image_encodings::bitDepth("64FC"), 64);
+  ASSERT_EQ(sensor_msgs::image_encodings::bitDepth("64FC3"), 64);
+  ASSERT_EQ(sensor_msgs::image_encodings::bitDepth("64FC10"), 64);
+}
+
+int main(int argc, char** argv)
+{
+  ::testing::InitGoogleTest(&argc, argv);
+  return RUN_ALL_TESTS();
+}
diff --git a/shape_msgs/CHANGELOG.rst b/shape_msgs/CHANGELOG.rst
index fd61d87..f40cdf3 100644
--- a/shape_msgs/CHANGELOG.rst
+++ b/shape_msgs/CHANGELOG.rst
@@ -2,6 +2,9 @@
 Changelog for package shape_msgs
 ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^
 
+1.12.5 (2016-09-30)
+-------------------
+
 1.12.4 (2016-02-22)
 -------------------
 
diff --git a/shape_msgs/package.xml b/shape_msgs/package.xml
index d53383c..810ea23 100644
--- a/shape_msgs/package.xml
+++ b/shape_msgs/package.xml
@@ -1,6 +1,6 @@
 <package>
   <name>shape_msgs</name>
-  <version>1.12.4</version>
+  <version>1.12.5</version>
   <description>
     This package contains messages for defining shapes, such as simple solid
     object primitives (cube, sphere, etc), planes, and meshes. 
diff --git a/stereo_msgs/CHANGELOG.rst b/stereo_msgs/CHANGELOG.rst
index 5a540bd..f99c06f 100644
--- a/stereo_msgs/CHANGELOG.rst
+++ b/stereo_msgs/CHANGELOG.rst
@@ -2,6 +2,11 @@
 Changelog for package stereo_msgs
 ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^
 
+1.12.5 (2016-09-30)
+-------------------
+* Fix spelling mistakes
+* Contributors: trorornmn
+
 1.12.4 (2016-02-22)
 -------------------
 
@@ -144,5 +149,5 @@ Changelog for package stereo_msgs
 * missing dependencies
 * updating bagmigration exports
 * rosbuild2 taking shape
-* removing old exports for msg/cpp and reving to 1.3.7 in preperation for release
+* removing old exports for msg/cpp and reving to 1.3.7 in preparation for release
 * stereo_msgs into common_msgs `#4637 <https://github.com/ros/common_msgs/issues/4637>`_
diff --git a/stereo_msgs/package.xml b/stereo_msgs/package.xml
index 427544e..68ebe5c 100644
--- a/stereo_msgs/package.xml
+++ b/stereo_msgs/package.xml
@@ -1,6 +1,6 @@
 <package>
   <name>stereo_msgs</name>
-  <version>1.12.4</version>
+  <version>1.12.5</version>
   <description>
     stereo_msgs contains messages specific to stereo processing, such as disparity images.
   </description>
diff --git a/trajectory_msgs/CHANGELOG.rst b/trajectory_msgs/CHANGELOG.rst
index 18953ed..4268774 100644
--- a/trajectory_msgs/CHANGELOG.rst
+++ b/trajectory_msgs/CHANGELOG.rst
@@ -2,6 +2,11 @@
 Changelog for package trajectory_msgs
 ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^
 
+1.12.5 (2016-09-30)
+-------------------
+* Fix spelling mistakes
+* Contributors: trorornmn
+
 1.12.4 (2016-02-22)
 -------------------
 
@@ -147,5 +152,5 @@ Changelog for package trajectory_msgs
 * common_msgs: starting catkin conversion
 * adios rosbuild2 in manifest.xml
 * rosbuild2 taking shape
-* removing old exports for msg/cpp and reving to 1.3.7 in preperation for release
+* removing old exports for msg/cpp and reving to 1.3.7 in preparation for release
 * migrating trajectory_msgs to common_msgs from pr2_controllers `#4675 <https://github.com/ros/common_msgs/issues/4675>`_
diff --git a/trajectory_msgs/package.xml b/trajectory_msgs/package.xml
index 819c033..02919e3 100644
--- a/trajectory_msgs/package.xml
+++ b/trajectory_msgs/package.xml
@@ -1,6 +1,6 @@
 <package>
   <name>trajectory_msgs</name>
-  <version>1.12.4</version>
+  <version>1.12.5</version>
   <description>
     This package defines messages for defining robot trajectories. These messages are
     also the building blocks of most of the
diff --git a/visualization_msgs/CHANGELOG.rst b/visualization_msgs/CHANGELOG.rst
index aedad22..1d4c8e5 100644
--- a/visualization_msgs/CHANGELOG.rst
+++ b/visualization_msgs/CHANGELOG.rst
@@ -2,6 +2,11 @@
 Changelog for package visualization_msgs
 ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^
 
+1.12.5 (2016-09-30)
+-------------------
+* Fix spelling mistakes
+* Contributors: trorornmn
+
 1.12.4 (2016-02-22)
 -------------------
 
@@ -179,6 +184,6 @@ Changelog for package visualization_msgs
 * added more functions to include/visualization_msgs/interactive_marker_tools.h
 * added initial version of interactive marker messages
 * rosbuild2 taking shape
-* removing old exports for msg/cpp and reving to 1.3.7 in preperation for release
+* removing old exports for msg/cpp and reving to 1.3.7 in preparation for release
 * update rosbagmigration dependency (`#4510 <https://github.com/ros/common_msgs/issues/4510>`_)
 * add visualization_msgs to common_msgs
diff --git a/visualization_msgs/package.xml b/visualization_msgs/package.xml
index 8371720..7f85b77 100644
--- a/visualization_msgs/package.xml
+++ b/visualization_msgs/package.xml
@@ -1,6 +1,6 @@
 <package>
   <name>visualization_msgs</name>
-  <version>1.12.4</version>
+  <version>1.12.5</version>
   <description>
     visualization_msgs is a set of messages used by higher level packages, such as <a href="/wiki/rviz">rviz</a>, that deal in visualization-specific data.
 

-- 
Alioth's /usr/local/bin/git-commit-notice on /srv/git.debian.org/git/debian-science/packages/ros/ros-common-msgs.git



More information about the debian-science-commits mailing list