Skip to content

Commit

Permalink
0.10.2
Browse files Browse the repository at this point in the history
  • Loading branch information
130s committed Oct 24, 2018
1 parent b0e51f1 commit 37284da
Show file tree
Hide file tree
Showing 52 changed files with 78 additions and 78 deletions.
4 changes: 2 additions & 2 deletions moveit/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,8 +2,8 @@
Changelog for package moveit
^^^^^^^^^^^^^^^^^^^^^^^^^^^^

Forthcoming
-----------
0.10.2 (2018-10-24)
-------------------
* [fix] Text refrences to MoveIt! (`#1020 <https://github.com/ros-planning/moveit/issues/1020>`_)
* [fix] Eigen alignment issuses due to missing aligned allocation (`#1039 <https://github.com/ros-planning/moveit/issues/1039>`_)
* [fix][chomp] changelogs: migration from tf -> tf2 only accidentally became part of 0.9.12's changelog
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>
<name>moveit</name>
<version>0.10.1</version>
<version>0.10.2</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@dav.ee">Dave Coleman</maintainer>
<maintainer email="mferguson@fetchrobotics.com">Michael Ferguson</maintainer>
Expand Down
4 changes: 2 additions & 2 deletions moveit_commander/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,8 +2,8 @@
Changelog for package moveit_commander
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

Forthcoming
-----------
0.10.2 (2018-10-24)
-------------------
* [capability] Added plan_only flags to pick and place (`#862 <https://github.com/ros-planning/moveit/issues/862>`_)
* [maintenance] Python3 support (`#1103 <https://github.com/ros-planning/moveit/issues/1103>`_, `#1054 <https://github.com/ros-planning/moveit/issues/1054>`_)
* Contributors: David Watkins, Michael Görner, d-walsh, mike lautman
Expand Down
2 changes: 1 addition & 1 deletion moveit_commander/package.xml
Original file line number Diff line number Diff line change
@@ -1,6 +1,6 @@
<package>
<name>moveit_commander</name>
<version>0.10.1</version>
<version>0.10.2</version>
<description>Python interfaces to MoveIt</description>

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

Forthcoming
-----------
0.10.2 (2018-10-24)
-------------------
* [fix] TFs in subgroups of rigidly-connected links (`#912 <https://github.com/ros-planning/moveit/issues/912>`_)
* [fix] Chomp package handling issue `#1086 <https://github.com/ros-planning/moveit/issues/1086>`_ that was introduced in `ubi-agni/hotfix-#1012 <https://github.com/ubi-agni/hotfix-/issues/1012>`_
* [fix] CurrentStateMonitor update callback for floating joints to handle non-identity joint origins `#984 <https://github.com/ros-planning/moveit/issues/984>`_
Expand Down
2 changes: 1 addition & 1 deletion moveit_core/package.xml
Original file line number Diff line number Diff line change
@@ -1,6 +1,6 @@
<package>
<name>moveit_core</name>
<version>0.10.1</version>
<version>0.10.2</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
4 changes: 2 additions & 2 deletions moveit_experimental/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,8 +2,8 @@
Changelog for package moveit_experimental
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

Forthcoming
-----------
0.10.2 (2018-10-24)
-------------------
* [maintenance] various compiler warnings (`#1038 <https://github.com/ros-planning/moveit/issues/1038>`_)
* [maintenance] add minimum required pluginlib version (`#927 <https://github.com/ros-planning/moveit/issues/927>`_)
* Contributors: Mikael Arguedas, Robert Haschke, mike lautman
Expand Down
2 changes: 1 addition & 1 deletion moveit_experimental/package.xml
Original file line number Diff line number Diff line change
@@ -1,6 +1,6 @@
<package>
<name>moveit_experimental</name>
<version>0.10.1</version>
<version>0.10.2</version>
<description>Experimental packages for moveit.</description>
<author email="isucan@google.com">Ioan Sucan</author>
<author email="robot.moveit@gmail.com">Sachin Chitta</author>
Expand Down
4 changes: 2 additions & 2 deletions moveit_kinematics/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,8 +2,8 @@
Changelog for package moveit_kinematics
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

Forthcoming
-----------
0.10.2 (2018-10-24)
-------------------
* [capability] add IKP_Translation{X,Y,Z}AxisAngle4D to the cpp template, see https://github.com/ros-planning/moveit/issues/548#issuecomment-316298918
* [maintenance] various compiler warnings (`#1038 <https://github.com/ros-planning/moveit/issues/1038>`_)
* Contributors: Kei Okada, Mikael Arguedas, Mohmmad Ayman, Robert Haschke, mike lautman, v4hn
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>
<name>moveit_kinematics</name>
<version>0.10.1</version>
<version>0.10.2</version>
<description>Package for all inverse kinematics solvers in MoveIt!</description>

<author email="dave@dav.ee">Dave Coleman</author>
Expand Down
4 changes: 2 additions & 2 deletions moveit_planners/chomp/chomp_interface/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,8 +2,8 @@
Changelog for package chomp_interface
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

Forthcoming
-----------
0.10.2 (2018-10-24)
-------------------
* [fix] chomp tests: fix order of moveit includes (`#970 <https://github.com/ros-planning/moveit/issues/970>`_)
* [fix] needs to depend on cmake_modules. (`#976 <https://github.com/ros-planning/moveit/issues/976>`_)
* [capability][chomp] Failure recovery options for CHOMP by tweaking parameters (`#987 <https://github.com/ros-planning/moveit/issues/987>`_)
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>0.10.1</version>
<version>0.10.2</version>
<author email="gjones@willowgarage.com">Gil Jones</author>

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

Forthcoming
-----------
0.10.2 (2018-10-24)
-------------------
* [fix] Eigen alignment issuses due to missing aligned allocation (`#1039 <https://github.com/ros-planning/moveit/issues/1039>`_)
* [fix] various compiler warnings (`#1038 <https://github.com/ros-planning/moveit/issues/1038>`_)
* [fix] changelogs: migration from tf -> tf2 only accidentally became part of 0.9.12's changelog
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>0.10.1</version>
<version>0.10.2</version>
<author email="gjones@willowgarage.com">Gil Jones</author>
<author email="mail@mrinal.net">Mrinal Kalakrishnan</author>

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

Forthcoming
-----------
0.10.2 (2018-10-24)
-------------------

0.10.1 (2018-05-25)
-------------------
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>
<name>moveit_planners</name>
<version>0.10.1</version>
<version>0.10.2</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
4 changes: 2 additions & 2 deletions moveit_planners/ompl/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,8 +2,8 @@
Changelog for package moveit_planners_ompl
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

Forthcoming
-----------
0.10.2 (2018-10-24)
-------------------
* [capability] adaptions for OMPL 1.4 (`#903 <https://github.com/ros-planning/moveit/issues/903>`_)
* Contributors: Dave Coleman, Michael Görner, Mikael Arguedas, Mohmmad Ayman, Robert Haschke, mike lautman

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>
<name>moveit_planners_ompl</name>
<version>0.10.1</version>
<version>0.10.2</version>
<description>MoveIt! interface to OMPL</description>

<author email="isucan@google.com">Ioan Sucan</author>
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -2,8 +2,8 @@
Changelog for package moveit_controller_manager_example
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

Forthcoming
-----------
0.10.2 (2018-10-24)
-------------------
* [maintenance] add minimum required pluginlib version (`#927 <https://github.com/ros-planning/moveit/issues/927>`_)
* Contributors: Mikael Arguedas, mike lautman

Expand Down
Original file line number Diff line number Diff line change
@@ -1,6 +1,6 @@
<package>
<name>moveit_controller_manager_example</name>
<version>0.10.1</version>
<version>0.10.2</version>
<description>An example controller manager plugin for MoveIt. This is not functional code.</description>

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

Forthcoming
-----------
0.10.2 (2018-10-24)
-------------------
* [fix] latch initial pose published by fake_controller_manager (`#1092 <https://github.com/ros-planning/moveit/issues/1092>`_)
* [maintenance] add minimum required pluginlib version (`#927 <https://github.com/ros-planning/moveit/issues/927>`_)
* Contributors: Mikael Arguedas, Mike Lautman, Mohmmad Ayman, mike lautman
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>
<name>moveit_fake_controller_manager</name>
<version>0.10.1</version>
<version>0.10.2</version>
<description>A fake controller manager plugin for MoveIt.</description>

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

Forthcoming
-----------
0.10.2 (2018-10-24)
-------------------

0.10.1 (2018-05-25)
-------------------
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>
<name>moveit_plugins</name>
<version>0.10.1</version>
<version>0.10.2</version>
<description>Metapackage for MoveIt! plugins.</description>

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

Forthcoming
-----------
0.10.2 (2018-10-24)
-------------------

0.10.1 (2018-05-25)
-------------------
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>0.10.1</version>
<version>0.10.2</version>
<description>ros_control controller manager interface for MoveIt!</description>

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

Forthcoming
-----------
0.10.2 (2018-10-24)
-------------------
* [maintenance] various compiler warnings (`#1038 <https://github.com/ros-planning/moveit/issues/1038>`_)
* [maintenance] add minimum required pluginlib version (`#927 <https://github.com/ros-planning/moveit/issues/927>`_)
* Contributors: Mikael Arguedas, Mohmmad Ayman, Robert Haschke, mike lautman
Expand Down
Original file line number Diff line number Diff line change
@@ -1,6 +1,6 @@
<package>
<name>moveit_simple_controller_manager</name>
<version>0.10.1</version>
<version>0.10.2</version>
<description>A generic, simple controller manager plugin for MoveIt.</description>

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

Forthcoming
-----------
0.10.2 (2018-10-24)
-------------------
* [capability] Benchmarking with different Motion Planners (STOMP, CHOMP, OMPL) (`#992 <https://github.com/ros-planning/moveit/issues/992>`_)
* [maintenance] various compiler warnings (`#1038 <https://github.com/ros-planning/moveit/issues/1038>`_)
* Contributors: Mohmmad Ayman, Raghavender Sahdev, Robert Haschke, mike lautman
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>
<name>moveit_ros_benchmarks</name>
<version>0.10.1</version>
<version>0.10.2</version>

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

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

Forthcoming
-----------
0.10.2 (2018-10-24)
-------------------
* [fix] Eigen alignment issuses due to missing aligned allocation (`#1039 <https://github.com/ros-planning/moveit/issues/1039>`_)
* [enhancement] Add info messages to pick and place routine (`#1004 <https://github.com/ros-planning/moveit/issues/1004>`_)
* [maintenance] add minimum required pluginlib version (`#927 <https://github.com/ros-planning/moveit/issues/927>`_)
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>
<name>moveit_ros_manipulation</name>
<version>0.10.1</version>
<version>0.10.2</version>
<description>Components of MoveIt! used for manipulation</description>

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

Forthcoming
-----------
0.10.2 (2018-10-24)
-------------------
* [fix] PlanningSceneMonitor lock `#1033 <https://github.com/ros-planning/moveit/issues/1033>`_: Fix `#868 <https://github.com/ros-planning/moveit/issues/868>`_ (`#1057 <https://github.com/ros-planning/moveit/issues/1057>`_)
* [maintenance] various compiler warnings (`#1038 <https://github.com/ros-planning/moveit/issues/1038>`_)
* [maintenance] add minimum required pluginlib version (`#927 <https://github.com/ros-planning/moveit/issues/927>`_)
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>
<name>moveit_ros_move_group</name>
<version>0.10.1</version>
<version>0.10.2</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
4 changes: 2 additions & 2 deletions moveit_ros/moveit_ros/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,8 +2,8 @@
Changelog for package moveit_ros
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

Forthcoming
-----------
0.10.2 (2018-10-24)
-------------------
* fix refrences to moveit! (`#1020 <https://github.com/ros-planning/moveit/issues/1020>`_)
* Contributors: Mohmmad Ayman

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>
<name>moveit_ros</name>
<version>0.10.1</version>
<version>0.10.2</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
4 changes: 2 additions & 2 deletions moveit_ros/perception/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,8 +2,8 @@
Changelog for package moveit_ros_perception
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

Forthcoming
-----------
0.10.2 (2018-10-24)
-------------------
* [fix] Eigen alignment issuses due to missing aligned allocation (`#1039 <https://github.com/ros-planning/moveit/issues/1039>`_)
* [fix] DepthImageOctomapUpdater not found error (`#954 <https://github.com/ros-planning/moveit/issues/954>`_)
* [fix] planning scene lock when octomap updates too quickly (`#920 <https://github.com/ros-planning/moveit/issues/920>`_)
Expand Down
2 changes: 1 addition & 1 deletion moveit_ros/perception/package.xml
Original file line number Diff line number Diff line change
@@ -1,6 +1,6 @@
<package>
<name>moveit_ros_perception</name>
<version>0.10.1</version>
<version>0.10.2</version>
<description>Components of MoveIt! connecting to perception</description>

<author email="isucan@google.com">Ioan Sucan</author>
Expand Down
4 changes: 2 additions & 2 deletions moveit_ros/planning/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,8 +2,8 @@
Changelog for package moveit_ros_planning
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

Forthcoming
-----------
0.10.2 (2018-10-24)
-------------------
* [fix] Chomp package handling issue `#1086 <https://github.com/ros-planning/moveit/issues/1086>`_ that was introduced in `ubi-agni/hotfix-#1012 <https://github.com/ubi-agni/hotfix-/issues/1012>`_
* [fix] PlanningSceneMonitor lock `#1033 <https://github.com/ros-planning/moveit/issues/1033>`_: Fix `#868 <https://github.com/ros-planning/moveit/issues/868>`_ (`#1057 <https://github.com/ros-planning/moveit/issues/1057>`_)
* [fix] CurrentStateMonitor update callback for floating joints to handle non-identity joint origins `#984 <https://github.com/ros-planning/moveit/issues/984>`_
Expand Down
2 changes: 1 addition & 1 deletion moveit_ros/planning/package.xml
Original file line number Diff line number Diff line change
@@ -1,7 +1,7 @@
<?xml version="1.0" encoding="utf-8"?>
<package>
<name>moveit_ros_planning</name>
<version>0.10.1</version>
<version>0.10.2</version>
<description>Planning 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
4 changes: 2 additions & 2 deletions moveit_ros/planning_interface/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,8 +2,8 @@
Changelog for package moveit_ros_planning_interface
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

Forthcoming
-----------
0.10.2 (2018-10-24)
-------------------
* [capability] Added plan_only flags to pick and place (`#862 <https://github.com/ros-planning/moveit/issues/862>`_)
* [maintenance] Python3 support (`#1103 <https://github.com/ros-planning/moveit/issues/1103>`_, `#1054 <https://github.com/ros-planning/moveit/issues/1054>`_)
* [fix] optional namespace args (`#929 <https://github.com/ros-planning/moveit/issues/929>`_)
Expand Down
Loading

0 comments on commit 37284da

Please sign in to comment.