diff --git a/moveit/CHANGELOG.rst b/moveit/CHANGELOG.rst index d673326c76..74474f6e12 100644 --- a/moveit/CHANGELOG.rst +++ b/moveit/CHANGELOG.rst @@ -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 `_ diff --git a/moveit_commander/CHANGELOG.rst b/moveit_commander/CHANGELOG.rst index adc94740c4..193aaafb04 100644 --- a/moveit_commander/CHANGELOG.rst +++ b/moveit_commander/CHANGELOG.rst @@ -2,6 +2,51 @@ Changelog for package moveit_commander ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +Forthcoming +----------- +* Merge pull request `#861 `_ from BryceStevenWilley/patch-1 + Fix and Test for `#842 `_ +* Added a test for PlanningSceneInterface + Ensures that you can construct a PlanningSceneInterface without having to pass an explicit namespace. +* Fix `#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 `_. +* Remove trailing whitespace from py, xml, launch files (`#837 `_) +* Feature/markers and states (`#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 `_) + * 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 `_) + * 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 `_) +* support TrajectoryConstraints in MoveGroupInterface + MoveitCommander (`#793 `_) +* Add API to get planner_id (`#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) ------------------- diff --git a/moveit_core/CHANGELOG.rst b/moveit_core/CHANGELOG.rst index 3c4e3c983a..f3e1ddec1b 100644 --- a/moveit_core/CHANGELOG.rst +++ b/moveit_core/CHANGELOG.rst @@ -2,6 +2,161 @@ Changelog for package moveit_core ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +Forthcoming +----------- +* Merge pull request `#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 `_) + migration from tf to tf2 API, resolves issue `#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 from the API, + and replaced them with std::shared_ptr'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 `_) +* testAbsoluteJointSpaceJump: improve readability of code (`#864 `_) +* code clean up of moveit_core (`#882 `_) + * code clean up of moveit_core + * code clean up of moveit_core +* fixup! do not always print visible messages when attaching (`#878 `_) +* fixup! fix printf conversion specifiers for logging (`#876 `_) +* do not always print visible messages when attaching (`#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 `_) + * printf size_t values with %zu +* [Fix] switch to ROS_LOGGER from CONSOLE_BRIDGE (`#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 `_) +* Remove variable name KinematicConstraint::print() to avoid compilation warning (`#849 `_) +* Add ability to request detailed distance information from fcl (`#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 `_) + * 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 `_) + mostly remove explicit `moveit::core` namespaces everywhere +* code clean up of robot_state.cpp (`#815 `_) + * code clean up of robot_state.cpp + * updated with clang-format +* Simplify adding CollisionObjects with colors (`#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 `_) + Issue a warning if too few trajectory waypoints are available for jump threshold test. + This would result in unreliable testing. +* Merge pull request `#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 `_) + - 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 `_ from ubi-agni/warp-link + improve RobotState::updateStateWithLinkAt() +* extended documentation +* fix computation of shape_extents\_ of links w/o shapes (`#766 `_) +* Merge pull request `#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 `_) + * 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 `_ 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 `_ from ros-planning/pr-clang-tidy-collision + As per `#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 `_ diff --git a/moveit_experimental/CHANGELOG.rst b/moveit_experimental/CHANGELOG.rst index 8cef49670d..da5ccee552 100644 --- a/moveit_experimental/CHANGELOG.rst +++ b/moveit_experimental/CHANGELOG.rst @@ -2,6 +2,38 @@ Changelog for package moveit_experimental ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +Forthcoming +----------- +* Merge pull request `#906 `_ from ubi-agni/compile-fixes + various fixes for melodic build +* boost::shared_ptr to std::shared_ptr +* MoveIt! tf2 migration (`#830 `_) + migration from tf to tf2 API, resolves issue `#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 from the API, + and replaced them with std::shared_ptr'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 `_) +* fix printf conversion specifiers for logging (`#876 `_) + * printf size_t values with %zu +* [Fix] switch to ROS_LOGGER from CONSOLE_BRIDGE (`#874 `_) + * [Fix] switch to ROS_LOGGER from CONSOLE_BRIDGE + * [Fix] clang format + * [Fix] manually fix bad clang-formatting in strings +* Merge pull request `#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 `_) + 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) ------------------- diff --git a/moveit_kinematics/CHANGELOG.rst b/moveit_kinematics/CHANGELOG.rst index 36ee1b6f9c..2770d779d9 100644 --- a/moveit_kinematics/CHANGELOG.rst +++ b/moveit_kinematics/CHANGELOG.rst @@ -2,6 +2,59 @@ Changelog for package moveit_kinematics ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +Forthcoming +----------- +* Merge pull request `#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 `_) + migration from tf to tf2 API, resolves issue `#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 from the API, + and replaced them with std::shared_ptr'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 `_) +* [Fix] switch to ROS_LOGGER from CONSOLE_BRIDGE (`#874 `_) + * [Fix] switch to ROS_LOGGER from CONSOLE_BRIDGE + * [Fix] clang format + * [Fix] manually fix bad clang-formatting in strings +* Merge pull request `#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 `_) + * 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 `_) + 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 `_ from henhenhen/kinetic-devel_lookup-param diff --git a/moveit_planners/chomp/chomp_interface/CHANGELOG.rst b/moveit_planners/chomp/chomp_interface/CHANGELOG.rst index cdfdd9b6d1..79246892ee 100644 --- a/moveit_planners/chomp/chomp_interface/CHANGELOG.rst +++ b/moveit_planners/chomp/chomp_interface/CHANGELOG.rst @@ -2,6 +2,13 @@ Changelog for package chomp_interface ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +Forthcoming +----------- +* [fix] dependencies for chomp interface test (`#778 `_) +* [maintenance][chomp_motion_planner] MoveIt! tf2 migration (`#830 `_) +* [capability] namespace to moveit_commander (`#835 `_) +* Contributors: Bence Magyar, Dave Coleman, Ian McMahon, Mikael Arguedas, Robert Haschke, Stephan, Will Baker + 0.9.11 (2017-12-25) ------------------- diff --git a/moveit_planners/chomp/chomp_motion_planner/CHANGELOG.rst b/moveit_planners/chomp/chomp_motion_planner/CHANGELOG.rst index fdd347a882..9d8d8634bb 100644 --- a/moveit_planners/chomp/chomp_motion_planner/CHANGELOG.rst +++ b/moveit_planners/chomp/chomp_motion_planner/CHANGELOG.rst @@ -2,6 +2,13 @@ Changelog for package chomp_motion_planner ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +Forthcoming +----------- +* [fix] for chomp fixed base joint bug (`#870 `_) +* [maintenance] MoveIt! tf2 migration (`#830 `_) +* [maintenance] switch to ROS_LOGGER from CONSOLE_BRIDGE (`#874 `_) +* Contributors: Bence Magyar, Dave Coleman, Ian McMahon, Mike Lautman, Xiaojian Ma + 0.9.11 (2017-12-25) ------------------- diff --git a/moveit_planners/moveit_planners/CHANGELOG.rst b/moveit_planners/moveit_planners/CHANGELOG.rst index 2717b6df65..f63a8329c2 100644 --- a/moveit_planners/moveit_planners/CHANGELOG.rst +++ b/moveit_planners/moveit_planners/CHANGELOG.rst @@ -2,6 +2,9 @@ Changelog for package moveit_planners ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +Forthcoming +----------- + 0.9.11 (2017-12-25) ------------------- diff --git a/moveit_planners/ompl/CHANGELOG.rst b/moveit_planners/ompl/CHANGELOG.rst index 2cb4730d39..88f706869a 100644 --- a/moveit_planners/ompl/CHANGELOG.rst +++ b/moveit_planners/ompl/CHANGELOG.rst @@ -2,6 +2,35 @@ Changelog for package moveit_planners_ompl ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +Forthcoming +----------- +* Merge pull request `#906 `_ from ubi-agni/compile-fixes + various fixes for melodic build +* ompl's cmake file uses lowercase +* adaptions for OMPL 1.4 (`#903 `_) + Defined an OMPLProjection that is typedef'd to work with versions <= 1.4 of OMPL +* MoveIt! tf2 migration (`#830 `_) + migration from tf to tf2 API, resolves issue `#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 from the API, + and replaced them with std::shared_ptr'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 `_) +* [Fix] switch to ROS_LOGGER from CONSOLE_BRIDGE (`#874 `_) + * [Fix] switch to ROS_LOGGER from CONSOLE_BRIDGE + * [Fix] clang format + * [Fix] manually fix bad clang-formatting in strings +* Make trajectory interpolation in MoveIt consistent to OMPL (`#869 `_) + Adapt final path simplification to match latest OMPL changes: + As optimizing planners, like RRT*, consume all planning time, there should be at least one final simplification step. If more time is available OMPL will continue simplifying the path. No need for checking the time in MoveIt anymore. + Resolved redundancy of parameters `longest_valid_segment_fraction` and `max_waypoint_distance`, only passing the most conservative to OMPL. +* Contributors: Bryce Willey, Ian McMahon, Mikael Arguedas, Robert Haschke, Xiaojian Ma + 0.9.11 (2017-12-25) ------------------- diff --git a/moveit_plugins/moveit_controller_manager_example/CHANGELOG.rst b/moveit_plugins/moveit_controller_manager_example/CHANGELOG.rst index a9fdbbd0ee..2dfb66af15 100644 --- a/moveit_plugins/moveit_controller_manager_example/CHANGELOG.rst +++ b/moveit_plugins/moveit_controller_manager_example/CHANGELOG.rst @@ -2,6 +2,11 @@ Changelog for package moveit_controller_manager_example ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +Forthcoming +----------- +* update include statements to use new pluginlib and class_loader headers (`#827 `_) +* Contributors: Mikael Arguedas + 0.9.11 (2017-12-25) ------------------- diff --git a/moveit_plugins/moveit_fake_controller_manager/CHANGELOG.rst b/moveit_plugins/moveit_fake_controller_manager/CHANGELOG.rst index ac30cf05d5..1465871bd5 100644 --- a/moveit_plugins/moveit_fake_controller_manager/CHANGELOG.rst +++ b/moveit_plugins/moveit_fake_controller_manager/CHANGELOG.rst @@ -2,6 +2,15 @@ Changelog for package moveit_fake_controller_manager ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +Forthcoming +----------- +* update include statements to use new pluginlib and class_loader headers (`#827 `_) +* [Fix] switch to ROS_LOGGER from CONSOLE_BRIDGE (`#874 `_) + * [Fix] switch to ROS_LOGGER from CONSOLE_BRIDGE + * [Fix] clang format + * [Fix] manually fix bad clang-formatting in strings +* Contributors: Mikael Arguedas, Xiaojian Ma + 0.9.11 (2017-12-25) ------------------- diff --git a/moveit_plugins/moveit_plugins/CHANGELOG.rst b/moveit_plugins/moveit_plugins/CHANGELOG.rst index be7540c927..28089b3edb 100644 --- a/moveit_plugins/moveit_plugins/CHANGELOG.rst +++ b/moveit_plugins/moveit_plugins/CHANGELOG.rst @@ -2,6 +2,9 @@ Changelog for package moveit_plugins ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +Forthcoming +----------- + 0.9.11 (2017-12-25) ------------------- diff --git a/moveit_plugins/moveit_ros_control_interface/CHANGELOG.rst b/moveit_plugins/moveit_ros_control_interface/CHANGELOG.rst index 222176ddd2..cccbb2e6ef 100644 --- a/moveit_plugins/moveit_ros_control_interface/CHANGELOG.rst +++ b/moveit_plugins/moveit_ros_control_interface/CHANGELOG.rst @@ -2,6 +2,12 @@ Changelog for package moveit_ros_control_interface ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +Forthcoming +----------- +* update include statements to use new pluginlib and class_loader headers (`#827 `_) +* fixed a small typo in README (`#794 `_) +* Contributors: Mikael Arguedas, Mohmmad Ayman + 0.9.11 (2017-12-25) ------------------- diff --git a/moveit_plugins/moveit_simple_controller_manager/CHANGELOG.rst b/moveit_plugins/moveit_simple_controller_manager/CHANGELOG.rst index 54706990e7..9661e5d259 100644 --- a/moveit_plugins/moveit_simple_controller_manager/CHANGELOG.rst +++ b/moveit_plugins/moveit_simple_controller_manager/CHANGELOG.rst @@ -2,6 +2,15 @@ Changelog for package moveit_simple_controller_manager ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +Forthcoming +----------- +* update include statements to use new pluginlib and class_loader headers (`#827 `_) +* [Fix] switch to ROS_LOGGER from CONSOLE_BRIDGE (`#874 `_) + * [Fix] switch to ROS_LOGGER from CONSOLE_BRIDGE + * [Fix] clang format + * [Fix] manually fix bad clang-formatting in strings +* Contributors: Mikael Arguedas, Xiaojian Ma + 0.9.11 (2017-12-25) ------------------- diff --git a/moveit_ros/benchmarks/CHANGELOG.rst b/moveit_ros/benchmarks/CHANGELOG.rst index e6553f4a02..2b0c18b5ac 100644 --- a/moveit_ros/benchmarks/CHANGELOG.rst +++ b/moveit_ros/benchmarks/CHANGELOG.rst @@ -2,6 +2,22 @@ Changelog for package moveit_ros_benchmarks ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +Forthcoming +----------- +* MoveIt! tf2 migration (`#830 `_) + migration from tf to tf2 API, resolves issue `#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 from the API, + and replaced them with std::shared_ptr'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 `_) +* Contributors: Ian McMahon, Mikael Arguedas + 0.9.11 (2017-12-25) ------------------- diff --git a/moveit_ros/manipulation/CHANGELOG.rst b/moveit_ros/manipulation/CHANGELOG.rst index b76ed0d77b..7c71c746a8 100644 --- a/moveit_ros/manipulation/CHANGELOG.rst +++ b/moveit_ros/manipulation/CHANGELOG.rst @@ -2,6 +2,22 @@ Changelog for package moveit_ros_manipulation ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +Forthcoming +----------- +* MoveIt! tf2 migration (`#830 `_) + migration from tf to tf2 API, resolves issue `#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 from the API, + and replaced them with std::shared_ptr'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 `_) +* Contributors: Ian McMahon, Mikael Arguedas + 0.9.11 (2017-12-25) ------------------- diff --git a/moveit_ros/move_group/CHANGELOG.rst b/moveit_ros/move_group/CHANGELOG.rst index 3cf9641ac5..ebfa949eee 100644 --- a/moveit_ros/move_group/CHANGELOG.rst +++ b/moveit_ros/move_group/CHANGELOG.rst @@ -2,6 +2,43 @@ Changelog for package moveit_ros_move_group ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +Forthcoming +----------- +* Merge pull request `#833 `_ from davetcoleman-melodic-execute-service +* MoveIt! tf2 migration (`#830 `_) + migration from tf to tf2 API, resolves issue `#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 from the API, + and replaced them with std::shared_ptr'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 +* Remove deprecated ExecuteTrajectoryServiceCapability in Melodic + - Add MIGRATION.md file +* update include statements to use new pluginlib and class_loader headers (`#827 `_) +* Cleanup source of execute trajectory action capability (`#834 `_) +* Add namespace capabilities to moveit_commander (`#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 +* disable flaky unittest (`#771 `_) + ... introduced in `#756 `_ +* MoveAction capability can drop cancel request if it is sent shortly after goal is sent (`#756 `_) + * add unittests to check for dropped cancelling of move action + * prevent cancelling of move actionstarts to be dropped +* Contributors: Dave Coleman, Ian McMahon, Mikael Arguedas, Robert Haschke, Will Baker, khupilz + 0.9.11 (2017-12-25) ------------------- diff --git a/moveit_ros/moveit_ros/CHANGELOG.rst b/moveit_ros/moveit_ros/CHANGELOG.rst index e3aef5254c..0a00b1b079 100644 --- a/moveit_ros/moveit_ros/CHANGELOG.rst +++ b/moveit_ros/moveit_ros/CHANGELOG.rst @@ -2,6 +2,9 @@ Changelog for package moveit_ros ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +Forthcoming +----------- + 0.9.11 (2017-12-25) ------------------- diff --git a/moveit_ros/perception/CHANGELOG.rst b/moveit_ros/perception/CHANGELOG.rst index 51d57ee6fa..1386f33154 100644 --- a/moveit_ros/perception/CHANGELOG.rst +++ b/moveit_ros/perception/CHANGELOG.rst @@ -2,6 +2,36 @@ Changelog for package moveit_ros_perception ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +Forthcoming +----------- +* Merge pull request `#906 `_ from ubi-agni/compile-fixes + various fixes for melodic build +* boost::shared_ptr to std::shared_ptr +* MoveIt! tf2 migration (`#830 `_) + migration from tf to tf2 API, resolves issue `#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 from the API, + and replaced them with std::shared_ptr'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 `_) +* cleanup typo in perception CMakeLists.txt (`#825 `_) +* moveit_ros_perception: make OpenGL parts optional (`#698 `_) + But build everything by default. + This commit is motivated by the work on the OpenEmbedded layer + for ROS, a cross-compilation tool chain environment for ROS + packages. We would like to allow to use moveit_ros_perception + in embedded systems without OpenGL support. + Signed-off-by: Dmitry Rozhkov + [Ported Dmitry's patch from indigo to current kinetic branch, + renamed build config, elaborated commit message] + Signed-off-by: Lukas Bulwahn +* Contributors: Bence Magyar, Ian McMahon, Lukas Bulwahn, Michael Görner, Mikael Arguedas, Robert Haschke + 0.9.11 (2017-12-25) ------------------- diff --git a/moveit_ros/planning/CHANGELOG.rst b/moveit_ros/planning/CHANGELOG.rst index 0cc6add52d..431d95290e 100644 --- a/moveit_ros/planning/CHANGELOG.rst +++ b/moveit_ros/planning/CHANGELOG.rst @@ -2,6 +2,80 @@ Changelog for package moveit_ros_planning ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +Forthcoming +----------- +* Fix multi dof validate trajectory (`#905 `_) + bugfix: correctly check names of multidof trajectory +* MoveIt! tf2 migration (`#830 `_) + migration from tf to tf2 API, resolves issue `#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 from the API, + and replaced them with std::shared_ptr'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 `_) +* explicitly enforce updateSceneWithCurrentState() in waitForCurrentRobotState() (`#824 `_) +* execution manager: use variable for named logging (`#838 `_) +* Support static TFs for multi-DOF joints in CurrentStateMonitor (`#799 `_) +* Merge pull request `#796 `_ from ubi-agni/msa-xacro-args + msa: added support for xacro args +* rdf_loader: remove --inorder xacro argument + this should be provided in xacro_args +* CSM: wait for *active* joint states only (`#792 `_) + We don't expect that drivers publish the transforms for fixed joints + Fixup for 739a85a4820ec68fecd31f51519ecc92a50f8c7e + It wasn't a problem before because the checks used variable names + and fixed joints do not have variables. So nothing was checked. +* Merge pull request `#769 `_ from ubi-agni/improve-eef-mapping + improve association of IK solvers to groups +* add warning about undefined kinematics plugins +* cherry-pick `#753 `_: skip non-actuated joints for execution (`#754 `_) +* clang-format fix +* Allow wait time to be specified for getCurrentState() (`#685 `_) + Expose wait_time argument to MoveGroupInterface::getCurrentState() +* fix newly introduced error (`#758 `_) +* Iterative cubic spline (`#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 +* Floating Joint Support in CurrentStateMonitor (`#748 `_) + * allow CSM to update any multi-dof joint via TF + Previously this was limited to the root link of the robot. + * change key of time map from string to JointModel* + * remove obsolete private method `isPassiveOrMimicDOF` +* validate multi-dof trajectories before execution (`#713 `_) + * validate multi-dof trajectories before execution + * addressed Dave's comments +* Contributors: Bruno Brito, Dave Coleman, Ian McMahon, Ken Anderson, Michael Görner, Mikael Arguedas, Phil, Robert Haschke + 0.9.11 (2017-12-25) ------------------- diff --git a/moveit_ros/planning_interface/CHANGELOG.rst b/moveit_ros/planning_interface/CHANGELOG.rst index d9db158035..255963b2bb 100644 --- a/moveit_ros/planning_interface/CHANGELOG.rst +++ b/moveit_ros/planning_interface/CHANGELOG.rst @@ -2,6 +2,21 @@ Changelog for package moveit_ros_planning_interface ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +Forthcoming +----------- +* [maintenance] Remove deprecated ExecuteTrajectoryServiceCapability in Melodic `#833 `_ +* [maintenance] MoveIt! tf2 migration (`#830 `_) +* [maintenance] switch to ROS_LOGGER from CONSOLE_BRIDGE (`#874 `_) +* [capability] namespace to moveit_commander (`#835 `_) +* Constrained Cartesian planning using moveit commander (`#805 `_) +* Simplify adding CollisionObjects with colors (`#810 `_) + +* support TrajectoryConstraints in MoveGroupInterface + MoveitCommander (`#793 `_) +* Add API to get planner_id (`#788 `_) + +* Allow wait time to be specified for getCurrentState() (`#685 `_) +* Contributors: 2scholz, Akiyoshi Ochiai, Bence Magyar, Dave Coleman, Ian McMahon, Robert Haschke, Will Baker, Xiaojian Ma, srsidd + 0.9.11 (2017-12-25) ------------------- diff --git a/moveit_ros/robot_interaction/CHANGELOG.rst b/moveit_ros/robot_interaction/CHANGELOG.rst index 48e0b1161f..20d1f5412c 100644 --- a/moveit_ros/robot_interaction/CHANGELOG.rst +++ b/moveit_ros/robot_interaction/CHANGELOG.rst @@ -2,6 +2,14 @@ Changelog for package moveit_ros_robot_interaction ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +Forthcoming +----------- +* [fix] interaction with planar joints (`#767 `_) +* [maintenance] boost::shared_ptr to std::shared_ptr +* [maintenance] MoveIt! tf2 migration (`#830 `_) +* [enhance] association of IK solvers to groups `#769 `_ +* Contributors: Bence Magyar, Ian McMahon, Michael Görner, Robert Haschke + 0.9.11 (2017-12-25) ------------------- diff --git a/moveit_ros/visualization/CHANGELOG.rst b/moveit_ros/visualization/CHANGELOG.rst index 889c2335f3..7c4df87853 100644 --- a/moveit_ros/visualization/CHANGELOG.rst +++ b/moveit_ros/visualization/CHANGELOG.rst @@ -2,6 +2,50 @@ Changelog for package moveit_ros_visualization ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +Forthcoming +----------- +* Merge pull request `#906 `_ from ubi-agni/compile-fixes + various fixes for melodic build +* moveit_ros_visualization: build_depend on qt-dev + ogre-dev +* MoveIt! tf2 migration (`#830 `_) + migration from tf to tf2 API, resolves issue `#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 from the API, + and replaced them with std::shared_ptr'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 `_) +* rviz plugin: set start/goal RobotState from external (`#823 `_) + - /rviz/moveit/update_custom_start_state + - /rviz/moveit/update_custom_goal_state + stopping from external: + - /rviz/moveit/stop +* Save and resume approximate_IK UI setting for easier usage (`#841 `_) +* Remove trailing whitespace from py, xml, launch files (`#837 `_) +* Add namespace capabilities to moveit_commander (`#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 +* consider shape transform for OcTree +* MotionPlanningDisplay: check for parent widget (`#801 `_) +* show/hide panel if display is enabled/disabled (`#760 `_) +* fix realtime trajectory display (`#761 `_) + Don't reset current_state_time\_ to zero, but continously increment it based on wall_dt. + This ensures that waypoints are displayed in realtime. +* Contributors: Alexander Rössler, Dave Coleman, Ian McMahon, Mikael Arguedas, Pan Hy, Phy, Robert Haschke, Will Baker + 0.9.11 (2017-12-25) ------------------- diff --git a/moveit_ros/warehouse/CHANGELOG.rst b/moveit_ros/warehouse/CHANGELOG.rst index ef7c144a47..171441d3c6 100644 --- a/moveit_ros/warehouse/CHANGELOG.rst +++ b/moveit_ros/warehouse/CHANGELOG.rst @@ -2,6 +2,11 @@ Changelog for package moveit_ros_warehouse ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +Forthcoming +----------- +* [maintenance][warehouse] MoveIt! tf2 migration (`#830 `_) +* Contributors: Ian McMahon + 0.9.11 (2017-12-25) ------------------- diff --git a/moveit_runtime/CHANGELOG.rst b/moveit_runtime/CHANGELOG.rst index 4413a73bef..ff4c29d54d 100644 --- a/moveit_runtime/CHANGELOG.rst +++ b/moveit_runtime/CHANGELOG.rst @@ -2,6 +2,9 @@ Changelog for package moveit_runtime ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +Forthcoming +----------- + 0.9.11 (2017-12-25) ------------------- diff --git a/moveit_setup_assistant/CHANGELOG.rst b/moveit_setup_assistant/CHANGELOG.rst index 116cfac665..5409e896d4 100644 --- a/moveit_setup_assistant/CHANGELOG.rst +++ b/moveit_setup_assistant/CHANGELOG.rst @@ -2,6 +2,63 @@ Changelog for package moveit_setup_assistant ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +Forthcoming +----------- +* MoveIt! tf2 migration (`#830 `_) + migration from tf to tf2 API, resolves issue `#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 from the API, + and replaced them with std::shared_ptr'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 `_) +* Remove trailing whitespace from py, xml, launch files (`#837 `_) +* Add namespace capabilities to moveit_commander (`#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 +* Merge pull request `#795 `_ from ubi-agni/msa-yaml-parsing + msa: cleanup yaml parsing +* simplify YAML parsing + - using utility function parse() + - removing yaml-cpp 0.3 support +* cleanup yaml parsing + - limit findValue to std::string key + using templates for char[N] is ineffient, as every literal of new + length N requires a new template instance + - use boost::optional constructor to return value +* actually use found yaml-cpp +* Merge pull request `#796 `_ from ubi-agni/msa-xacro-args + msa: added support for xacro args +* allow to edit xacro args +* cleanup LoadPathWidget API + - use QString were suitable + - pass parent before bool options +* report about xacro errors +* Merge pull request `#769 `_ from ubi-agni/improve-eef-mapping + improve association of IK solvers to groups +* jmg is also considered for collision checking +* clarify that joints and links always go in pairs +* 'or' to indicate config methods are alternative options +* MSA: extended explanation of planning group + end effector +* MSA: fix setting of group states (`#762 `_) + * allow same pose name in different groups + * only consider active joints when defining named poses +* cherry-pick `#753 `_: skip non-actuated joints for execution (`#754 `_) +* Contributors: Dave Coleman, Ian McMahon, Michael Görner, Mikael Arguedas, Robert Haschke, Will Baker + 0.9.11 (2017-12-25) -------------------