Skip to content

Commit

Permalink
0.244.12
Browse files Browse the repository at this point in the history
  • Loading branch information
azeey committed Dec 13, 2023
1 parent d598e13 commit 78d3398
Show file tree
Hide file tree
Showing 24 changed files with 36 additions and 36 deletions.
4 changes: 2 additions & 2 deletions ros_gz/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,8 +2,8 @@
Changelog for package ros_gz
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

Forthcoming
-----------
0.244.12 (2023-12-13)
---------------------

0.244.11 (2023-05-23)
---------------------
Expand Down
2 changes: 1 addition & 1 deletion ros_gz/package.xml
Original file line number Diff line number Diff line change
Expand Up @@ -4,7 +4,7 @@
<!-- TODO: Make this a metapackage, see
https://github.com/ros2/ros2/issues/408 -->
<name>ros_gz</name>
<version>0.244.11</version>
<version>0.244.12</version>
<description>Meta-package containing interfaces for using ROS 2 with <a href="https://gazebosim.org">Gazebo</a> simulation.</description>
<maintainer email="[email protected]">Louise Poubel</maintainer>
<license>Apache 2.0</license>
Expand Down
4 changes: 2 additions & 2 deletions ros_gz_bridge/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,8 +2,8 @@
Changelog for package ros_gz_bridge
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

Forthcoming
-----------
0.244.12 (2023-12-13)
---------------------
* Backport: Add conversion for geometry_msgs/msg/TwistStamped <-> gz.msgs.Twist (`#468 <https://github.com/gazebosim/ros_gz/issues/468>`_) (`#470 <https://github.com/gazebosim/ros_gz/issues/470>`_)
* Add support for Harmonic/Humble pairing (`#462 <https://github.com/gazebosim/ros_gz/issues/462>`_)
* Added messages for 2D Bounding Boxes to ros_gz_bridge (`#458 <https://github.com/gazebosim/ros_gz/issues/458>`_)
Expand Down
2 changes: 1 addition & 1 deletion ros_gz_bridge/package.xml
Original file line number Diff line number Diff line change
Expand Up @@ -2,7 +2,7 @@
<?xml-model href="http://download.ros.org/schema/package_format3.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
<package format="3">
<name>ros_gz_bridge</name>
<version>0.244.11</version>
<version>0.244.12</version>
<description>Bridge communication between ROS and Gazebo Transport</description>
<maintainer email="[email protected]">Louise Poubel</maintainer>

Expand Down
4 changes: 2 additions & 2 deletions ros_gz_image/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,8 +2,8 @@
Changelog for package ros1_ign_image
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

Forthcoming
-----------
0.244.12 (2023-12-13)
---------------------
* Add support for Harmonic/Humble pairing (`#462 <https://github.com/gazebosim/ros_gz/issues/462>`_)
* Fix double wait in ros_gz_bridge (`#347 <https://github.com/gazebosim/ros_gz/issues/347>`_) (`#450 <https://github.com/gazebosim/ros_gz/issues/450>`_)
* Contributors: Addisu Z. Taddese, Alejandro Hernández Cordero
Expand Down
2 changes: 1 addition & 1 deletion ros_gz_image/package.xml
Original file line number Diff line number Diff line change
@@ -1,6 +1,6 @@
<package format="3">
<name>ros_gz_image</name>
<version>0.244.11</version>
<version>0.244.12</version>
<description>Image utilities for Gazebo simulation with ROS.</description>
<license>Apache 2.0</license>
<maintainer email="[email protected]">Louise Poubel</maintainer>
Expand Down
4 changes: 2 additions & 2 deletions ros_gz_interfaces/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,8 +2,8 @@
Changelog for package ros_gz_interfaces
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

Forthcoming
-----------
0.244.12 (2023-12-13)
---------------------
* [backport humble] SensorNoise msg bridging (`#417 <https://github.com/gazebosim/ros_gz/issues/417>`_)
* [backport humble] Added Altimeter msg bridging (`#413 <https://github.com/gazebosim/ros_gz/issues/413>`_) (`#414 <https://github.com/gazebosim/ros_gz/issues/414>`_) (`#426 <https://github.com/gazebosim/ros_gz/issues/426>`_)
* Contributors: Alejandro Hernández Cordero
Expand Down
2 changes: 1 addition & 1 deletion ros_gz_interfaces/package.xml
Original file line number Diff line number Diff line change
@@ -1,6 +1,6 @@
<package format="3">
<name>ros_gz_interfaces</name>
<version>0.244.11</version>
<version>0.244.12</version>
<description>Message and service data structures for interacting with Gazebo from ROS2.</description>
<license>Apache 2.0</license>
<maintainer email="[email protected]">Louise Poubel</maintainer>
Expand Down
4 changes: 2 additions & 2 deletions ros_gz_sim/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,8 +2,8 @@
Changelog for package ros_gz_sim
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

Forthcoming
-----------
0.244.12 (2023-12-13)
---------------------
* Add support for Harmonic/Humble pairing (`#462 <https://github.com/gazebosim/ros_gz/issues/462>`_)
* Set on_exit_shutdown argument for gz-sim ExecuteProcess (`#355 <https://github.com/gazebosim/ros_gz/issues/355>`_) (`#451 <https://github.com/gazebosim/ros_gz/issues/451>`_)
* Contributors: Addisu Z. Taddese, Michael Carroll
Expand Down
2 changes: 1 addition & 1 deletion ros_gz_sim/package.xml
Original file line number Diff line number Diff line change
Expand Up @@ -2,7 +2,7 @@
<?xml-model href="http://download.ros.org/schema/package_format3.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
<package format="3">
<name>ros_gz_sim</name>
<version>0.244.11</version>
<version>0.244.12</version>
<description>Tools for using Gazebo Sim simulation with ROS.</description>
<maintainer email="[email protected]">Alejandro Hernandez</maintainer>

Expand Down
4 changes: 2 additions & 2 deletions ros_gz_sim_demos/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,8 +2,8 @@
Changelog for package ros1_gz_sim_demos
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

Forthcoming
-----------
0.244.12 (2023-12-13)
---------------------
* [backport Humble] Added more topic to the bridge (`#422 <https://github.com/gazebosim/ros_gz/issues/422>`_)
* Added more topic to the bridge (`#422 <https://github.com/gazebosim/ros_gz/issues/422>`_)
* Fix incorrect subscription on demo (`#405 <https://github.com/gazebosim/ros_gz/issues/405>`_)
Expand Down
2 changes: 1 addition & 1 deletion ros_gz_sim_demos/package.xml
Original file line number Diff line number Diff line change
@@ -1,6 +1,6 @@
<package format="3">
<name>ros_gz_sim_demos</name>
<version>0.244.11</version>
<version>0.244.12</version>
<description>Demos using Gazebo Sim simulation with ROS.</description>
<license>Apache 2.0</license>
<maintainer email="[email protected]">Louise Poubel</maintainer>
Expand Down
4 changes: 2 additions & 2 deletions ros_ign/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,8 +2,8 @@
Changelog for package ros_ign
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

Forthcoming
-----------
0.244.12 (2023-12-13)
---------------------

0.244.11 (2023-05-23)
---------------------
Expand Down
2 changes: 1 addition & 1 deletion ros_ign/package.xml
Original file line number Diff line number Diff line change
Expand Up @@ -2,7 +2,7 @@
<?xml-model href="http://download.ros.org/schema/package_format2.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
<package format="2">
<name>ros_ign</name>
<version>0.244.11</version>
<version>0.244.12</version>
<description>Shim meta-package to redirect to <a href="https://github.com/gazebosim/ros_gz/tree/ros2/ros_gz">ros_gz</a>.</description>
<maintainer email="[email protected]">Brandon Ong</maintainer>
<license>Apache 2.0</license>
Expand Down
4 changes: 2 additions & 2 deletions ros_ign_bridge/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,8 +2,8 @@
Changelog for package ros_ign_bridge
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

Forthcoming
-----------
0.244.12 (2023-12-13)
---------------------

0.244.11 (2023-05-23)
---------------------
Expand Down
2 changes: 1 addition & 1 deletion ros_ign_bridge/package.xml
Original file line number Diff line number Diff line change
Expand Up @@ -2,7 +2,7 @@
<?xml-model href="http://download.ros.org/schema/package_format3.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
<package format="3">
<name>ros_ign_bridge</name>
<version>0.244.11</version>
<version>0.244.12</version>
<description>Shim package to redirect to ros_gz_bridge.</description>
<maintainer email="[email protected]">Brandon Ong</maintainer>

Expand Down
4 changes: 2 additions & 2 deletions ros_ign_gazebo/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,8 +2,8 @@
Changelog for package ros_ign_gazebo
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

Forthcoming
-----------
0.244.12 (2023-12-13)
---------------------
* Add support for Harmonic/Humble pairing (`#462 <https://github.com/gazebosim/ros_gz/issues/462>`_)
* Contributors: Addisu Z. Taddese

Expand Down
2 changes: 1 addition & 1 deletion ros_ign_gazebo/package.xml
Original file line number Diff line number Diff line change
Expand Up @@ -2,7 +2,7 @@
<?xml-model href="http://download.ros.org/schema/package_format3.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
<package format="3">
<name>ros_ign_gazebo</name>
<version>0.244.11</version>
<version>0.244.12</version>
<description>Shim package to redirect to ros_gz_sim.</description>
<maintainer email="[email protected]">Brandon Ong</maintainer>

Expand Down
4 changes: 2 additions & 2 deletions ros_ign_gazebo_demos/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,8 +2,8 @@
Changelog for package ros_ign_gazebo_demos
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

Forthcoming
-----------
0.244.12 (2023-12-13)
---------------------

0.244.11 (2023-05-23)
---------------------
Expand Down
2 changes: 1 addition & 1 deletion ros_ign_gazebo_demos/package.xml
Original file line number Diff line number Diff line change
@@ -1,6 +1,6 @@
<package format="3">
<name>ros_ign_gazebo_demos</name>
<version>0.244.11</version>
<version>0.244.12</version>
<description>Shim package to redirect to ros_gz_sim_demos.</description>
<license>Apache 2.0</license>
<maintainer email="[email protected]">Brandon Ong</maintainer>
Expand Down
4 changes: 2 additions & 2 deletions ros_ign_image/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,8 +2,8 @@
Changelog for package ros_ign_image
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

Forthcoming
-----------
0.244.12 (2023-12-13)
---------------------

0.244.11 (2023-05-23)
---------------------
Expand Down
2 changes: 1 addition & 1 deletion ros_ign_image/package.xml
Original file line number Diff line number Diff line change
Expand Up @@ -2,7 +2,7 @@
<?xml-model href="http://download.ros.org/schema/package_format3.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
<package format="3">
<name>ros_ign_image</name>
<version>0.244.11</version>
<version>0.244.12</version>
<description>Shim package to redirect to ros_gz_image.</description>
<maintainer email="[email protected]">Brandon Ong</maintainer>

Expand Down
4 changes: 2 additions & 2 deletions ros_ign_interfaces/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,8 +2,8 @@
Changelog for package ros_ign_interfaces
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

Forthcoming
-----------
0.244.12 (2023-12-13)
---------------------

0.244.11 (2023-05-23)
---------------------
Expand Down
2 changes: 1 addition & 1 deletion ros_ign_interfaces/package.xml
Original file line number Diff line number Diff line change
@@ -1,6 +1,6 @@
<package format="3">
<name>ros_ign_interfaces</name>
<version>0.244.11</version>
<version>0.244.12</version>
<description>Shim package to redirect to ros_gz_interfaces.</description>
<license>Apache 2.0</license>
<maintainer email="[email protected]">Brandon Ong</maintainer>
Expand Down

0 comments on commit 78d3398

Please sign in to comment.