Skip to content

Commit

Permalink
First changelog for ROS Melodic.
Browse files Browse the repository at this point in the history
I've started editing changelog that was generated from catkin_generate_changelog, but I got my urgent work stuff. Since I promised to make a release #806 (comment), I'd rather just make a release with unorganized set of changelog than delaying release.
  • Loading branch information
130s committed May 22, 2018
1 parent c23a023 commit f7929f9
Show file tree
Hide file tree
Showing 26 changed files with 674 additions and 0 deletions.
3 changes: 3 additions & 0 deletions moveit/CHANGELOG.rst
Expand Up @@ -2,6 +2,9 @@
Changelog for package moveit
^^^^^^^^^^^^^^^^^^^^^^^^^^^^

Forthcoming
-----------

0.9.11 (2017-12-25)
-------------------
* [fix][moveit_core] #723; attached bodies are not shown in trajectory visualization anymore `#724 <https://github.com/ros-planning/moveit/issues/724>`_
Expand Down
45 changes: 45 additions & 0 deletions moveit_commander/CHANGELOG.rst
Expand Up @@ -2,6 +2,51 @@
Changelog for package moveit_commander
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

Forthcoming
-----------
* Merge pull request `#861 <https://github.com/ros-planning/moveit/issues/861>`_ from BryceStevenWilley/patch-1
Fix and Test for `#842 <https://github.com/ros-planning/moveit/issues/842>`_
* Added a test for PlanningSceneInterface
Ensures that you can construct a PlanningSceneInterface without having to pass an explicit namespace.
* Fix `#842 <https://github.com/ros-planning/moveit/issues/842>`_
Adds a optional namespace argument to the python side of planning_scene_interface and passes it to the wrapped C++, which expects a namespace after `#835 <https://github.com/ros-planning/moveit/issues/835>`_.
* Remove trailing whitespace from py, xml, launch files (`#837 <https://github.com/ros-planning/moveit/issues/837>`_)
* Feature/markers and states (`#836 <https://github.com/ros-planning/moveit/issues/836>`_)
* Add python goodies
* Update planning interface tests for namespace arg
* Add namespace tests
* Update moveit commander for namespacing
* Add moveit commander tests
* Add movegroup test in namespace
* Update param scopes in template and launch files
* Code formatting
* Add functionality to get robot markers and plan from state
* is None is not None
* Add namespace capabilities to moveit_commander (`#835 <https://github.com/ros-planning/moveit/issues/835>`_)
* Add python goodies
* Update planning interface tests for namespace arg
* Add namespace tests
* Update moveit commander for namespacing
* Add moveit commander tests
* Add movegroup test in namespace
* Update param scopes in template and launch files
* Code formatting
* Add BSD License and name
* Add description
* Fix joy test
* Constrained Cartesian planning using moveit commander (`#805 <https://github.com/ros-planning/moveit/issues/805>`_)
* Add constraints to cartesian planning with moveit commander
* clang formatting
* Formatting, add comments
* Add demo script
* Fix minor typos in comments
* Handle robot_description parameter in RobotCommander (`#782 <https://github.com/ros-planning/moveit/issues/782>`_)
* support TrajectoryConstraints in MoveGroupInterface + MoveitCommander (`#793 <https://github.com/ros-planning/moveit/issues/793>`_)
* Add API to get planner_id (`#788 <https://github.com/ros-planning/moveit/issues/788>`_)
* Add a member function to get the current planner_id
* Add python method to get planner_id
* Contributors: Akiyoshi Ochiai, Bence Magyar, Bryce Willey, Dave Coleman, Michael Görner, Ryan Keating, Will Baker, srsidd

0.9.11 (2017-12-25)
-------------------

Expand Down
155 changes: 155 additions & 0 deletions moveit_core/CHANGELOG.rst
Expand Up @@ -2,6 +2,161 @@
Changelog for package moveit_core
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

Forthcoming
-----------
* Merge pull request `#906 <https://github.com/ros-planning/moveit/issues/906>`_ from ubi-agni/compile-fixes
various fixes for melodic build
* adapt unittests after update to tf2
* KDL solvers: provide dummy updateInternalDataStructures()
... for new abstract method in KDL 1.4.0 of Melodic
* MoveIt! tf2 migration (`#830 <https://github.com/ros-planning/moveit/issues/830>`_)
migration from tf to tf2 API, resolves issue `#745 <https://github.com/ros-planning/moveit/issues/745>`_
- All type conversions now depend on geometry2 ROS packages, rather than geometry
(see https://github.com/ros/geometry2/pull/292 and
https://github.com/ros/geometry2/pull/294 for details of the new conversions)
- Removes all boost::shared_ptr<tf::TransformListener> from the API,
and replaced them with std::shared_ptr<tf2_ros::Buffer>'s
- Utilize new tf2 API in the tf::Transformer library to access the internal tf2::Buffer of RViz
(see https://github.com/ros/geometry/pull/163 for details of the new API)
- Removes prepending of forward slashes ('/') for transforms frames as this is deprecated in tf2
- Replaced deprecated tf2 _getLatestCommonTime
* Fix allocator type to pass GCC8 static assert. (`#888 <https://github.com/ros-planning/moveit/issues/888>`_)
* testAbsoluteJointSpaceJump: improve readability of code (`#864 <https://github.com/ros-planning/moveit/issues/864>`_)
* code clean up of moveit_core (`#882 <https://github.com/ros-planning/moveit/issues/882>`_)
* code clean up of moveit_core
* code clean up of moveit_core
* fixup! do not always print visible messages when attaching (`#878 <https://github.com/ros-planning/moveit/issues/878>`_)
* fixup! fix printf conversion specifiers for logging (`#876 <https://github.com/ros-planning/moveit/issues/876>`_)
* do not always print visible messages when attaching (`#878 <https://github.com/ros-planning/moveit/issues/878>`_)
This should not be a public message.
Especially annoying because the RViz display calls this
function quite often when displaying trajectories with attached objects.
* fix printf conversion specifiers for logging (`#876 <https://github.com/ros-planning/moveit/issues/876>`_)
* printf size_t values with %zu
* [Fix] switch to ROS_LOGGER from CONSOLE_BRIDGE (`#874 <https://github.com/ros-planning/moveit/issues/874>`_)
* [Fix] switch to ROS_LOGGER from CONSOLE_BRIDGE
* [Fix] clang format
* [Fix] manually fix bad clang-formatting in strings
* robot_state/test: remove introduced dependency to moveit_ros_planning/rdf_loader (`#850 <https://github.com/ros-planning/moveit/issues/850>`_)
* Remove variable name KinematicConstraint::print() to avoid compilation warning (`#849 <https://github.com/ros-planning/moveit/issues/849>`_)
* Add ability to request detailed distance information from fcl (`#662 <https://github.com/ros-planning/moveit/issues/662>`_)
Expose the ability to request detailed distance information from FCL. New virtual methods distanceXXX(DistanceRequest&, DistanceResult&) are provided in CollisionRobot and CollisionWorld. Existing methods were adapted to use the new underlying infrastructure of DistanceRequests.
* improved checking for joint-space jumps of Cartesian path (`#843 <https://github.com/ros-planning/moveit/issues/843>`_)
* adding absolute jump threshold capability in parallel, also adding test coverage
* formatting of comments, reduce redundancy
* inline definition of convienency methods
* improve readability: always call testJointSpaceJump()
* reduce redundancy, improve efficiency
* restore old code were applicable
* cleanup tests
* changing struct variable names to be less redundant, improving tests, removing throw error from abs jump test
* revert test changes
* relax testing conditions
- test for both, relative and absolute jumps (if corresponding thresholds > 0)
- skip revolute/prismatic if threshold is <= 0
* cherry-pick reworked log messages
* cherry-pick test changes: use default joint pose
* extend unittests: test both direct and indirect methods
* consistent order: 1st: revolute, 2nd: prismatic
* fixup! extend unittests: test both direct and indirect methods
* computeCartesianPath: only test for jump if there's something to check
If the trajectory consists only of the first (current) robot state,
there is no need to test for joint space jumps and thus we avoid
printing the new warning "too few points to test" in this case.
* code clean up of robot_model (`#820 <https://github.com/ros-planning/moveit/issues/820>`_)
mostly remove explicit `moveit::core` namespaces everywhere
* code clean up of robot_state.cpp (`#815 <https://github.com/ros-planning/moveit/issues/815>`_)
* code clean up of robot_state.cpp
* updated with clang-format
* Simplify adding CollisionObjects with colors (`#810 <https://github.com/ros-planning/moveit/issues/810>`_)
To facilitate assignment of object colors in addCollisionObjects() and applyCollisionObjects(),
the object id of the CollisionObject is reused for ObjectColors if not specified.
* fixed typo
* fix RobotState::computeCartesianPath
- consider both, translational and rotational distance to compute number interpolation of steps
- ensure that quaternions are on same half sphere before doing quaternion slerp
* cleanup jump threshold test in computeCartesianPath (`#784 <https://github.com/ros-planning/moveit/issues/784>`_)
Issue a warning if too few trajectory waypoints are available for jump threshold test.
This would result in unreliable testing.
* Merge pull request `#768 <https://github.com/ros-planning/moveit/issues/768>`_ from ubi-agni/fix-mimic-joint-updates
fix updateMimicJoint()
* mark updated mimic joints as dirty
* test mimic joint updates
* unittests: simplify verification of Eigen matrices
* replace deprecated logging macros with CONSOLE_BRIDGE macros (`#787 <https://github.com/ros-planning/moveit/issues/787>`_)
- replace log* macros with CONSOLE_BRIDGE_log* macros
- replace printf commands for size_t: %u -> %zu
* updateMimicJoint(group->getMimicJointModels()) -> updateMimicJoints(group)
Clearly indicate the fact, that the functions
updateMimicJoint(group->getMimicJointModels()) and
markDirtyJointTransforms(group)
need to be called together!
* Merge pull request `#765 <https://github.com/ros-planning/moveit/issues/765>`_ from ubi-agni/warp-link
improve RobotState::updateStateWithLinkAt()
* extended documentation
* fix computation of shape_extents\_ of links w/o shapes (`#766 <https://github.com/ros-planning/moveit/issues/766>`_)
* Merge pull request `#769 <https://github.com/ros-planning/moveit/issues/769>`_ from ubi-agni/improve-eef-mapping
improve association of IK solvers to groups
* fix updateMimicJoint()
Although the joint transform was marked dirty, the corresponding link transforms were not!
* improve comments associating kinematics solvers to groups
* updateStateWithLinkAt(backward=true): mark all collision body transforms dirty
* improve doc for updateStateWithLinkAt()
* reduce code bloat
* RobotModel::getRigidlyConnectedParentLinkModel()
... to compute earliest parent link that is rigidly connected to a given link
* Iterative cubic spline (`#441 <https://github.com/ros-planning/moveit/issues/441>`_)
* adding iterative spline time parameterization
* add 2nd and 2nd-last points
* move added points near endpoints, but not exactly the same. Fix math error.
* add jerk comment
* clang-formatting
* prevent divide-by-zero. Fix out-of-bounds array write
* fix variables
* off by one error. change default limits
* comments
* fix for setting waypoint durations
* comments
* add time parameterization unit test
* styling
* add compile-time option to disable jerk
* allow jerk to be enabled/disabled at runtime
* make requested changes, the biggest of which is allowing for min and max constraints
* add duration check to unit test
* set default acceleration to 1.0
* fix class name
* add migration notes
* whitespace styling
* set waypoint velocities/accelerations when unset. Increase default jerk limit. Modify test case to catch this.
* improved handling of unspecified initial/final velocities/accelerations
* change 0.01 constant to epsilon()
* simplify tests
* styling
* Remove jerk, as it causes oscillations
* Merge pull request `#703 <https://github.com/ros-planning/moveit/issues/703>`_ from tradr-project/fix_bbox-kinetic
Fixed bugs in computation of AABB in LinkModel and RobotState.
* Addressed rhaschke's comments.
* Added a test for the AABB of a specific rotated link on the PR2.
* Fixed buggy AABB computation.
Also added a way to visualize both AABBs and OBBs in RViz to verify.
* Merge pull request `#731 <https://github.com/ros-planning/moveit/issues/731>`_ from ros-planning/pr-clang-tidy-collision
As per `#28 <https://github.com/ros-planning/moveit/issues/28>`_, I setup and documented how to run clang-tidy on the codebase, and tested it on the collision_detection and collision_detection_fcl folders. I chose these two because they were small, so I could get feedback on what to change before applying to the entire repo.
The clang-tidy config file is based on https://github.com/davetcoleman/rviz_visual_tools/blob/kinetic-devel/.clang-tidy and adds some more checks to the code.
* Better naming for clang-changed variables.
* Changed shared pointer in constructor back and added NOLINT.
* Little fixes following Dave Colemans' suggestions.
* clang-format run
* Fixed computation of a the AABB of links and models.
* Ran clang-format.
* Fixed more modernize issues.
* Moved clang-tidy docs to the website.
* Forgot to format the include files.
* Stopped reusing an existing name and clang-format on collision_dection.
* Ran clang-tidy and clang-format on collision_dection and collision_detection_fcl.
* Documented how to clang-tidy with run-clang-tidy-3.8.py
* Fixed a deprecated call to console bridge.
* Contributors: 2scholz, Bryce Willey, Ian McMahon, Ken Anderson, Levi Armstrong, Maarten de Vries, Martin Pecka, Michael Görner, Mike Lautman, Patrick Holthaus, Robert Haschke, Victor Lamoine, Xiaojian Ma, bailaC

0.9.11 (2017-12-25)
-------------------
* [fix] #723; attached bodies are not shown in trajectory visualization anymore `#724 <https://github.com/ros-planning/moveit/issues/724>`_
Expand Down
32 changes: 32 additions & 0 deletions moveit_experimental/CHANGELOG.rst
Expand Up @@ -2,6 +2,38 @@
Changelog for package moveit_experimental
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

Forthcoming
-----------
* Merge pull request `#906 <https://github.com/ros-planning/moveit/issues/906>`_ from ubi-agni/compile-fixes
various fixes for melodic build
* boost::shared_ptr to std::shared_ptr
* MoveIt! tf2 migration (`#830 <https://github.com/ros-planning/moveit/issues/830>`_)
migration from tf to tf2 API, resolves issue `#745 <https://github.com/ros-planning/moveit/issues/745>`_
- All type conversions now depend on geometry2 ROS packages, rather than geometry
(see https://github.com/ros/geometry2/pull/292 and
https://github.com/ros/geometry2/pull/294 for details of the new conversions)
- Removes all boost::shared_ptr<tf::TransformListener> from the API,
and replaced them with std::shared_ptr<tf2_ros::Buffer>'s
- Utilize new tf2 API in the tf::Transformer library to access the internal tf2::Buffer of RViz
(see https://github.com/ros/geometry/pull/163 for details of the new API)
- Removes prepending of forward slashes ('/') for transforms frames as this is deprecated in tf2
- Replaced deprecated tf2 _getLatestCommonTime
* update include statements to use new pluginlib and class_loader headers (`#827 <https://github.com/ros-planning/moveit/issues/827>`_)
* fix printf conversion specifiers for logging (`#876 <https://github.com/ros-planning/moveit/issues/876>`_)
* printf size_t values with %zu
* [Fix] switch to ROS_LOGGER from CONSOLE_BRIDGE (`#874 <https://github.com/ros-planning/moveit/issues/874>`_)
* [Fix] switch to ROS_LOGGER from CONSOLE_BRIDGE
* [Fix] clang format
* [Fix] manually fix bad clang-formatting in strings
* Merge pull request `#863 <https://github.com/ros-planning/moveit/issues/863>`_ from ubi-agni/fix-buid-farm-issues
* fix various cmake warnings
* remove not required test dependency
* replaced 2nd find_package(catkin ...)
* fix various cmake warnings
* Add ability to request detailed distance information from fcl (`#662 <https://github.com/ros-planning/moveit/issues/662>`_)
Expose the ability to request detailed distance information from FCL. New virtual methods distanceXXX(DistanceRequest&, DistanceResult&) are provided in CollisionRobot and CollisionWorld. Existing methods were adapted to use the new underlying infrastructure of DistanceRequests.
* Contributors: Bence Magyar, Ian McMahon, Levi Armstrong, Mikael Arguedas, Robert Haschke, Xiaojian Ma

0.9.11 (2017-12-25)
-------------------

Expand Down
53 changes: 53 additions & 0 deletions moveit_kinematics/CHANGELOG.rst
Expand Up @@ -2,6 +2,59 @@
Changelog for package moveit_kinematics
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

Forthcoming
-----------
* Merge pull request `#906 <https://github.com/ros-planning/moveit/issues/906>`_ from ubi-agni/compile-fixes
various fixes for melodic build
* KDL solvers: provide dummy updateInternalDataStructures()
... for new abstract method in KDL 1.4.0 of Melodic
* MoveIt! tf2 migration (`#830 <https://github.com/ros-planning/moveit/issues/830>`_)
migration from tf to tf2 API, resolves issue `#745 <https://github.com/ros-planning/moveit/issues/745>`_
- All type conversions now depend on geometry2 ROS packages, rather than geometry
(see https://github.com/ros/geometry2/pull/292 and
https://github.com/ros/geometry2/pull/294 for details of the new conversions)
- Removes all boost::shared_ptr<tf::TransformListener> from the API,
and replaced them with std::shared_ptr<tf2_ros::Buffer>'s
- Utilize new tf2 API in the tf::Transformer library to access the internal tf2::Buffer of RViz
(see https://github.com/ros/geometry/pull/163 for details of the new API)
- Removes prepending of forward slashes ('/') for transforms frames as this is deprecated in tf2
- Replaced deprecated tf2 _getLatestCommonTime
* update include statements to use new pluginlib and class_loader headers (`#827 <https://github.com/ros-planning/moveit/issues/827>`_)
* [Fix] switch to ROS_LOGGER from CONSOLE_BRIDGE (`#874 <https://github.com/ros-planning/moveit/issues/874>`_)
* [Fix] switch to ROS_LOGGER from CONSOLE_BRIDGE
* [Fix] clang format
* [Fix] manually fix bad clang-formatting in strings
* Merge pull request `#863 <https://github.com/ros-planning/moveit/issues/863>`_ from ubi-agni/fix-buid-farm-issues
* fix various cmake warnings
* remove not required test dependency
* replaced 2nd find_package(catkin ...)
* fix various cmake warnings
* Improve ikfast kinematics plugin (`#808 <https://github.com/ros-planning/moveit/issues/808>`_)
* Initialize constant num_joints\_ in constructor.
* Check size of input array in getPositionFK.
* Fix implementation error.
* Add name variable to ikfast plugin.
* Cached ik kinematics plugin (`#612 <https://github.com/ros-planning/moveit/issues/612>`_)
add caching wrapper for IK solvers
* - Remove OMPL dependency, add slightly modified versions of OMPL code to this repo
- Change camelCase variable names to underscore_names
- Use /** ... */ for doxygen comments instead of /// ...
- Fix memory leak
- Various small fixes
* handle optional TRAC-IK dependency a different way
* remove OMPL_INCLUDE_DIRS
* include trac_ik headers optionally *after* moveit includes
Sorting dependency-includes via catkin breaks either way around
with multiple `find_package` calls and can always break
overlaying workspaces.
However, ${catkin_INCLUDE_DIRS} contains many more dependencies
than ${trac_ik_kinematics_plugin_INCLUDE_DIRS}, so avoid more
breakage than necessary by including catkin_INCLUDE_DIRS first.
* add missing include
* Don't write configured file to build dir. Can't write to src dir either since it might be read-only. Instead, just comment out the parts that are for development / testing purposes only.
* ik cache: use lookupParam for plugin parameters
* Contributors: Ian McMahon, Mark Moll, Mikael Arguedas, Robert Haschke, Xiaojian Ma, martiniil

0.9.11 (2017-12-25)
-------------------
* Merge pull request `#714 <https://github.com/ros-planning/moveit/issues/714>`_ from henhenhen/kinetic-devel_lookup-param
Expand Down
7 changes: 7 additions & 0 deletions moveit_planners/chomp/chomp_interface/CHANGELOG.rst
Expand Up @@ -2,6 +2,13 @@
Changelog for package chomp_interface
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

Forthcoming
-----------
* [fix] dependencies for chomp interface test (`#778 <https://github.com/ros-planning/moveit/issues/778>`_)
* [maintenance][chomp_motion_planner] MoveIt! tf2 migration (`#830 <https://github.com/ros-planning/moveit/issues/830>`_)
* [capability] namespace to moveit_commander (`#835 <https://github.com/ros-planning/moveit/issues/835>`_)
* Contributors: Bence Magyar, Dave Coleman, Ian McMahon, Mikael Arguedas, Robert Haschke, Stephan, Will Baker

0.9.11 (2017-12-25)
-------------------

Expand Down

0 comments on commit f7929f9

Please sign in to comment.