Skip to content

Commit

Permalink
1.1.15
Browse files Browse the repository at this point in the history
  • Loading branch information
rhaschke committed Sep 9, 2024
1 parent 9f26220 commit adb3f2c
Show file tree
Hide file tree
Showing 58 changed files with 156 additions and 29 deletions.
3 changes: 3 additions & 0 deletions moveit/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,6 +2,9 @@
Changelog for package moveit
^^^^^^^^^^^^^^^^^^^^^^^^^^^^

1.1.15 (2024-09-09)
-------------------

1.1.14 (2024-05-27)
-------------------

Expand Down
2 changes: 1 addition & 1 deletion moveit/package.xml
Original file line number Diff line number Diff line change
@@ -1,7 +1,7 @@
<?xml version="1.0"?>
<package format="2">
<name>moveit</name>
<version>1.1.14</version>
<version>1.1.15</version>
<description>Meta package that contains all essential package of MoveIt. Until Summer 2016 MoveIt had been developed over multiple repositories, where developers' usability and maintenance effort was non-trivial. See <a href = "http://discourse.ros.org/t/migration-to-one-github-repo-for-moveit/266/34">the detailed discussion for the merge of several repositories</a>.</description>
<maintainer email="dave@picknik.ai">Dave Coleman</maintainer>
<maintainer email="mferguson@fetchrobotics.com">Michael Ferguson</maintainer>
Expand Down
5 changes: 5 additions & 0 deletions moveit_commander/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,6 +2,11 @@
Changelog for package moveit_commander
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

1.1.15 (2024-09-09)
-------------------
* New implementation for computeCartesianPath (`#3618 <https://github.com/ros-planning/moveit/issues/3618>`_)
* Contributors: Robert Haschke

1.1.14 (2024-05-27)
-------------------
* Fixed order of return values in doc string of compute_cartesian_path() (`#3574 <https://github.com/ros-planning/moveit/issues/3574>`_)
Expand Down
2 changes: 1 addition & 1 deletion moveit_commander/package.xml
Original file line number Diff line number Diff line change
@@ -1,7 +1,7 @@
<?xml version="1.0"?>
<package format="3">
<name>moveit_commander</name>
<version>1.1.14</version>
<version>1.1.15</version>
<description>Python interfaces to MoveIt</description>

<author email="isucan@google.com">Ioan Sucan</author>
Expand Down
9 changes: 9 additions & 0 deletions moveit_core/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,6 +2,15 @@
Changelog for package moveit_core
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

1.1.15 (2024-09-09)
-------------------
* Disable ruckig's webclient support in MoveIt build (`#3636 <https://github.com/ros-planning/moveit/issues/3636>`_)
* New implementation for computeCartesianPath (`#3618 <https://github.com/ros-planning/moveit/issues/3618>`_)
* Optimize MOVE_SHAPE operations for FCL (`#3601 <https://github.com/ros-planning/moveit/issues/3601>`_)
* Provide violated bounds for a JointConstraint
* PSM: Correctly handle full planning scene message (`#3610 <https://github.com/ros-planning/moveit/issues/3610>`_)
* Contributors: Captain Yoshi, Michael Görner, Robert Haschke

1.1.14 (2024-05-27)
-------------------
* Allow moving of all shapes of an object in one go (`#3599 <https://github.com/ros-planning/moveit/issues/3599>`_)
Expand Down
2 changes: 1 addition & 1 deletion moveit_core/package.xml
Original file line number Diff line number Diff line change
@@ -1,7 +1,7 @@
<?xml version="1.0"?>
<package format="3">
<name>moveit_core</name>
<version>1.1.14</version>
<version>1.1.15</version>
<description>Core libraries used by MoveIt</description>
<author email="isucan@google.com">Ioan Sucan</author>
<author email="robot.moveit@gmail.com">Sachin Chitta</author>
Expand Down
3 changes: 3 additions & 0 deletions moveit_kinematics/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,6 +2,9 @@
Changelog for package moveit_kinematics
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

1.1.15 (2024-09-09)
-------------------

1.1.14 (2024-05-27)
-------------------
* Addressing discrepancies in angle parameter definition between IKFast solvers and the plugin template (`#3489 <https://github.com/ros-planning/moveit/issues/3489>`_)
Expand Down
2 changes: 1 addition & 1 deletion moveit_kinematics/package.xml
Original file line number Diff line number Diff line change
@@ -1,7 +1,7 @@
<?xml version="1.0"?>
<package format="3">
<name>moveit_kinematics</name>
<version>1.1.14</version>
<version>1.1.15</version>
<description>Package for all inverse kinematics solvers in MoveIt</description>

<author email="dave@picknik.ai">Dave Coleman</author>
Expand Down
5 changes: 5 additions & 0 deletions moveit_planners/chomp/chomp_interface/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,6 +2,11 @@
Changelog for package chomp_interface
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

1.1.15 (2024-09-09)
-------------------
* Fix CHOMP segfault (`#3621 <https://github.com/ros-planning/moveit/issues/3621>`_)
* Contributors: Robert Haschke, Captain Yoshi

1.1.14 (2024-05-27)
-------------------

Expand Down
2 changes: 1 addition & 1 deletion moveit_planners/chomp/chomp_interface/package.xml
Original file line number Diff line number Diff line change
Expand Up @@ -2,7 +2,7 @@
<name>moveit_planners_chomp</name>
<description>The interface for using CHOMP within MoveIt</description>

<version>1.1.14</version>
<version>1.1.15</version>
<author email="gjones@willowgarage.com">Gil Jones</author>

<maintainer email="chitt@live.in">Chittaranjan Srinivas Swaminathan</maintainer>
Expand Down
6 changes: 6 additions & 0 deletions moveit_planners/chomp/chomp_motion_planner/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,6 +2,12 @@
Changelog for package chomp_motion_planner
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

1.1.15 (2024-09-09)
-------------------
* CHOMP: Fix handling of mimic joints (`#3625 <https://github.com/ros-planning/moveit/issues/3625>`_)
* Fix CHOMP segfault (`#3621 <https://github.com/ros-planning/moveit/issues/3621>`_)
* Contributors: Robert Haschke

1.1.14 (2024-05-27)
-------------------

Expand Down
2 changes: 1 addition & 1 deletion moveit_planners/chomp/chomp_motion_planner/package.xml
Original file line number Diff line number Diff line change
Expand Up @@ -2,7 +2,7 @@
<name>chomp_motion_planner</name>
<description>chomp_motion_planner</description>

<version>1.1.14</version>
<version>1.1.15</version>
<author email="gjones@willowgarage.com">Gil Jones</author>
<author email="mail@mrinal.net">Mrinal Kalakrishnan</author>

Expand Down
3 changes: 3 additions & 0 deletions moveit_planners/chomp/chomp_optimizer_adapter/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,6 +2,9 @@
Changelog for package moveit_chomp_optimizer_adapter
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

1.1.15 (2024-09-09)
-------------------

1.1.14 (2024-05-27)
-------------------

Expand Down
2 changes: 1 addition & 1 deletion moveit_planners/chomp/chomp_optimizer_adapter/package.xml
Original file line number Diff line number Diff line change
Expand Up @@ -3,7 +3,7 @@
<name>moveit_chomp_optimizer_adapter</name>
<description>MoveIt planning request adapter utilizing chomp for solution optimization</description>

<version>1.1.14</version>
<version>1.1.15</version>
<author email="raghavendersahdev@gmail.com">Raghavender Sahdev</author>
<maintainer email="raghavendersahdev@gmail.com">Raghavender Sahdev</maintainer>
<maintainer email="moveit_releasers@googlegroups.com">MoveIt Release Team</maintainer>
Expand Down
3 changes: 3 additions & 0 deletions moveit_planners/moveit_planners/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,6 +2,9 @@
Changelog for package moveit_planners
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

1.1.15 (2024-09-09)
-------------------

1.1.14 (2024-05-27)
-------------------

Expand Down
2 changes: 1 addition & 1 deletion moveit_planners/moveit_planners/package.xml
Original file line number Diff line number Diff line change
@@ -1,6 +1,6 @@
<package format="2">
<name>moveit_planners</name>
<version>1.1.14</version>
<version>1.1.15</version>
<description>Metapacakge that installs all available planners for MoveIt</description>
<author email="isucan@google.com">Ioan Sucan</author>
<author email="sachinc@willowgarage.com">Sachin Chitta</author>
Expand Down
5 changes: 5 additions & 0 deletions moveit_planners/ompl/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,6 +2,11 @@
Changelog for package moveit_planners_ompl
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

1.1.15 (2024-09-09)
-------------------
* Fix constrained-based planning / PoseModelStateSpace (`#3615 <https://github.com/ros-planning/moveit/issues/3615>`_)
* Contributors: Robert Haschke

1.1.14 (2024-05-27)
-------------------
* Support ompl::ompl cmake target (`#3549 <https://github.com/ros-planning/moveit/issues/3549>`_)
Expand Down
2 changes: 1 addition & 1 deletion moveit_planners/ompl/package.xml
Original file line number Diff line number Diff line change
@@ -1,6 +1,6 @@
<package format="2">
<name>moveit_planners_ompl</name>
<version>1.1.14</version>
<version>1.1.15</version>
<description>MoveIt interface to OMPL</description>

<author email="isucan@google.com">Ioan Sucan</author>
Expand Down
6 changes: 6 additions & 0 deletions moveit_planners/pilz_industrial_motion_planner/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,6 +2,12 @@
Changelog for package pilz_industrial_motion_planner
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

1.1.15 (2024-09-09)
-------------------
* Fix identical subsequent time stamps generated by Pilz planner (`#3630 <https://github.com/ros-planning/moveit/issues/3630>`_)
* Fix PILZ/LIN segfault (`#3624 <https://github.com/ros-planning/moveit/issues/3624>`_)
* Contributors: Robert Haschke

1.1.14 (2024-05-27)
-------------------
* Don't copy attached collision objects in CommandListManager::setStartState (`#3590 <https://github.com/ros-planning/moveit/issues/3590>`_)
Expand Down
2 changes: 1 addition & 1 deletion moveit_planners/pilz_industrial_motion_planner/package.xml
Original file line number Diff line number Diff line change
@@ -1,7 +1,7 @@
<?xml version="1.0"?>
<package format="3">
<name>pilz_industrial_motion_planner</name>
<version>1.1.14</version>
<version>1.1.15</version>
<description>MoveIt plugin to generate industrial trajectories PTP, LIN, CIRC and sequences thereof.</description>

<maintainer email="a.gutenkunst@pilz.de">Alexander Gutenkunst</maintainer>
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -2,6 +2,9 @@
Changelog for package pilz_industrial_motion_planner_testutils
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

1.1.15 (2024-09-09)
-------------------

1.1.14 (2024-05-27)
-------------------

Expand Down
Original file line number Diff line number Diff line change
@@ -1,7 +1,7 @@
<?xml version="1.0"?>
<package>
<name>pilz_industrial_motion_planner_testutils</name>
<version>1.1.14</version>
<version>1.1.15</version>
<description>Helper scripts and functionality to test industrial motion generation</description>

<maintainer email="a.gutenkunst@pilz.de">Alexander Gutenkunst</maintainer>
Expand Down
3 changes: 3 additions & 0 deletions moveit_plugins/moveit_fake_controller_manager/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,6 +2,9 @@
Changelog for package moveit_fake_controller_manager
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

1.1.15 (2024-09-09)
-------------------

1.1.14 (2024-05-27)
-------------------

Expand Down
2 changes: 1 addition & 1 deletion moveit_plugins/moveit_fake_controller_manager/package.xml
Original file line number Diff line number Diff line change
@@ -1,6 +1,6 @@
<package format="2">
<name>moveit_fake_controller_manager</name>
<version>1.1.14</version>
<version>1.1.15</version>
<description>A fake controller manager plugin for MoveIt.</description>

<author email="isucan@google.com">Ioan Sucan</author>
Expand Down
3 changes: 3 additions & 0 deletions moveit_plugins/moveit_plugins/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,6 +2,9 @@
Changelog for package moveit_plugins
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

1.1.15 (2024-09-09)
-------------------

1.1.14 (2024-05-27)
-------------------

Expand Down
2 changes: 1 addition & 1 deletion moveit_plugins/moveit_plugins/package.xml
Original file line number Diff line number Diff line change
@@ -1,6 +1,6 @@
<package format="2">
<name>moveit_plugins</name>
<version>1.1.14</version>
<version>1.1.15</version>
<description>Metapackage for MoveIt plugins.</description>

<author email="mferguson@fetchrobotics.com">Michael Ferguson</author>
Expand Down
3 changes: 3 additions & 0 deletions moveit_plugins/moveit_ros_control_interface/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,6 +2,9 @@
Changelog for package moveit_ros_control_interface
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

1.1.15 (2024-09-09)
-------------------

1.1.14 (2024-05-27)
-------------------

Expand Down
2 changes: 1 addition & 1 deletion moveit_plugins/moveit_ros_control_interface/package.xml
Original file line number Diff line number Diff line change
@@ -1,7 +1,7 @@
<?xml version="1.0"?>
<package format="2">
<name>moveit_ros_control_interface</name>
<version>1.1.14</version>
<version>1.1.15</version>
<description>ros_control controller manager interface for MoveIt</description>

<author email="mathias.luedtke@ipa.fraunhofer.de">Mathias Lüdtke</author>
Expand Down
5 changes: 5 additions & 0 deletions moveit_plugins/moveit_simple_controller_manager/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,6 +2,11 @@
Changelog for package moveit_simple_controller_manager
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

1.1.15 (2024-09-09)
-------------------
* Fix race condition in trajectory execution (`#3620 <https://github.com/ros-planning/moveit/issues/3620>`_)
* Contributors: Robert Haschke

1.1.14 (2024-05-27)
-------------------
* Simplify code waiting for ActionBasedController, fix timeout to 5s
Expand Down
Original file line number Diff line number Diff line change
@@ -1,6 +1,6 @@
<package format="2">
<name>moveit_simple_controller_manager</name>
<version>1.1.14</version>
<version>1.1.15</version>
<description>A generic, simple controller manager plugin for MoveIt.</description>

<author email="mferguson@fetchrobotics.com">Michael Ferguson</author>
Expand Down
3 changes: 3 additions & 0 deletions moveit_ros/benchmarks/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,6 +2,9 @@
Changelog for package moveit_ros_benchmarks
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

1.1.15 (2024-09-09)
-------------------

1.1.14 (2024-05-27)
-------------------
* Use boost::timer::progress_display if available (`#3547 <https://github.com/ros-planning/moveit/issues/3547>`_)
Expand Down
2 changes: 1 addition & 1 deletion moveit_ros/benchmarks/package.xml
Original file line number Diff line number Diff line change
@@ -1,6 +1,6 @@
<package format="2">
<name>moveit_ros_benchmarks</name>
<version>1.1.14</version>
<version>1.1.15</version>

<description>Enhanced tools for benchmarks in MoveIt</description>

Expand Down
5 changes: 5 additions & 0 deletions moveit_ros/manipulation/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,6 +2,11 @@
Changelog for package moveit_ros_manipulation
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

1.1.15 (2024-09-09)
-------------------
* New implementation for computeCartesianPath (`#3618 <https://github.com/ros-planning/moveit/issues/3618>`_)
* Contributors: Robert Haschke

1.1.14 (2024-05-27)
-------------------

Expand Down
2 changes: 1 addition & 1 deletion moveit_ros/manipulation/package.xml
Original file line number Diff line number Diff line change
@@ -1,6 +1,6 @@
<package format="2">
<name>moveit_ros_manipulation</name>
<version>1.1.14</version>
<version>1.1.15</version>
<description>Components of MoveIt used for manipulation</description>

<author email="isucan@google.com">Ioan Sucan</author>
Expand Down
5 changes: 5 additions & 0 deletions moveit_ros/move_group/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,6 +2,11 @@
Changelog for package moveit_ros_move_group
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

1.1.15 (2024-09-09)
-------------------
* New implementation for computeCartesianPath (`#3618 <https://github.com/ros-planning/moveit/issues/3618>`_)
* Contributors: Robert Haschke

1.1.14 (2024-05-27)
-------------------
* Gracefully handle exceptions thrown by planning pipelines (`#3481 <https://github.com/ros-planning/moveit/issues/3481>`_)
Expand Down
2 changes: 1 addition & 1 deletion moveit_ros/move_group/package.xml
Original file line number Diff line number Diff line change
@@ -1,6 +1,6 @@
<package format="2">
<name>moveit_ros_move_group</name>
<version>1.1.14</version>
<version>1.1.15</version>
<description>The move_group node for MoveIt</description>
<author email="isucan@google.com">Ioan Sucan</author>
<author email="robot.moveit@gmail.com">Sachin Chitta</author>
Expand Down
3 changes: 3 additions & 0 deletions moveit_ros/moveit_ros/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,6 +2,9 @@
Changelog for package moveit_ros
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

1.1.15 (2024-09-09)
-------------------

1.1.14 (2024-05-27)
-------------------

Expand Down
2 changes: 1 addition & 1 deletion moveit_ros/moveit_ros/package.xml
Original file line number Diff line number Diff line change
@@ -1,6 +1,6 @@
<package format="2">
<name>moveit_ros</name>
<version>1.1.14</version>
<version>1.1.15</version>
<description>Components of MoveIt that use ROS</description>
<author email="isucan@google.com">Ioan Sucan</author>
<author email="robot.moveit@gmail.com">Sachin Chitta</author>
Expand Down
6 changes: 6 additions & 0 deletions moveit_ros/moveit_servo/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,6 +2,12 @@
Changelog for package moveit_servo
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

1.1.15 (2024-09-09)
-------------------
* Init joint trajectory with actual robot pose (`#3642 <https://github.com/ros-planning/moveit/issues/3642>`_)
* Use ACM consistently (`#3641 <https://github.com/ros-planning/moveit/issues/3641>`_)
* Contributors: Davide Torielli, Michael Görner

1.1.14 (2024-05-27)
-------------------

Expand Down
2 changes: 1 addition & 1 deletion moveit_ros/moveit_servo/package.xml
Original file line number Diff line number Diff line change
@@ -1,7 +1,7 @@
<?xml version="1.0"?>
<package format="2">
<name>moveit_servo</name>
<version>1.1.14</version>
<version>1.1.15</version>

<description>Provides real-time manipulator Cartesian and joint servoing.</description>

Expand Down
Loading

0 comments on commit adb3f2c

Please sign in to comment.