CHANGELOG

Changelog for package moveit_planners_ompl

2.9.0 (2024-01-09)

  • Handle unsupported position constraints in OMPL (#2417) * Handle unsupported position constraints in OMPL OMPL constrained planning assumes that all position constraints have three dimensions, meaning that they are represented by a BOX bounding volume. If another shape is used (like a SPHERE from moveit_core/kinematic_constraints/utils.hpp), the constraint adapter implementation will produce a segfault because of the lack of dimensions. This fix prevents this by checking for the required BOX type. * Add warning if more than one position primitive is used ——— Co-authored-by: Sebastian Jahr <sebastian.jahr@picknik.ai>

  • Invoke OMPL debug print only when debug logging is enabled (#2608)

  • Node logging for the rest of MoveIt (#2599)

  • [Planning Pipeline Refactoring] #1 Simplify Adapter - Planner chain (#2429)

  • Add new clang-tidy style rules (#2177)

  • Do not pass and return simple types by const ref (#2453) Co-authored-by: Nils <nilsmailiseke@gmail.com>

  • Update pre-commit and add to .codespell_words (#2465)

  • Map ompl’s APPROXIMATE_SOLUTION -> TIMED_OUT / PLANNING_FAILED (#2455) ompl’s APPROXIMATE_SOLUTION is not suitable for actual execution. It just states that we got closer to the goal… The most prominent reason for an approximate solution is a timeout. Thus, return TIMED_OUT and print the used timeouts for convenience.

  • Merge branch ‘main’ into dependabot/github_actions/SonarSource/sonarcloud-github-c-cpp-2

  • Update clang-format-14 with QualifierAlignment (#2362) * Set qualifier order in .clang-format * Ran pre-commit to update according to new style guide

  • Converts float to double (#2343) * Limiting the scope of variables #874 Limited the scope of variables in moveit_core/collision_detection * Update moveit_core/collision_detection/src/collision_octomap_filter.cpp Co-authored-by: AndyZe <andyz@utexas.edu> * Update moveit_core/collision_detection/src/collision_octomap_filter.cpp Co-authored-by: AndyZe <andyz@utexas.edu> * Update moveit_core/collision_detection/src/collision_octomap_filter.cpp Co-authored-by: AndyZe <andyz@utexas.edu> * convert float to double * change double to float * Feedback fixes * Introduced variables removed from previous merge commit * Updated GL_Renderer function definitions with double instead of float * Changed update() function arguments to float since it is a derived virtual function and needs to be overriden * Fixed all override errors in visualization * Fixed override errors in perception *Changed reinterpret_cast to double from float* * change variable types to fit function definition * Fixed clang-tidy warnings * Fixed scope of reusable variables ——— Co-authored-by: Salah Soliman <salahsoliman96@gmail.com> Co-authored-by: AndyZe <andyz@utexas.edu> Co-authored-by: Henning Kayser <henningkayser@picknik.ai>

  • Merge branch ‘main’ into dependabot/github_actions/SonarSource/sonarcloud-github-c-cpp-2

  • Contributors: Henning Kayser, Igor Medvedev, Marq Rasmussen, Robert Haschke, Sebastian Jahr, Shobuj Paul, Tyler Weaver

2.8.0 (2023-09-10)

  • Fix typo in model_based_planning_context.h (#2243)

  • Warn if optimization objective does not match expected values (#2213) * Warn if optimization objective does not match expected values * Update moveit_planners/ompl/ompl_interface/src/model_based_planning_context.cpp Co-authored-by: Sebastian Jahr <sebastian.jahr@tuta.io> * Format ———

  • Contributors: Stephanie Eng

2.7.4 (2023-05-18)

  • Fix Constraint Planning Segfault (#2130) * Fix Constraint Planning Segfault * Reuse planner data * apply clang formatting * apply clang formatting round 2 * add FIXME note and verbose output of planning graph size ——— Co-authored-by: Sebastian Jahr <sebastian.jahr@picknik.ai>

  • Contributors: Marq Rasmussen

2.7.3 (2023-04-24)

  • Replace Variable PROJECT_NAME in CMakeLists.txt with the actual name (#2020)

  • Contributors: Shobuj Paul

2.7.2 (2023-04-18)

  • Update pre-commit (#2094)

  • Contributors: Shobuj Paul

2.7.1 (2023-03-23)

  • Fix include install destination (#2008) Co-authored-by: Henning Kayser <henningkayser@picknik.ai> Co-authored-by: Tyler Weaver <maybe@tylerjw.dev>

  • Temporarily disable TestPathConstraints with the Panda robot (#2016) This test has become flaky since it was modified to use the OMPL constrained state space (https://github.com/ros-planning/moveit2/issues/2015).

  • Increase priority for constrained planning state space (#1300) * Change priority for the constrained planning state space * Fix constrained planning tests * Use PRM instead of RRTConnect ——— Co-authored-by: Sebastian Jahr <sebastian.jahr@picknik.ai>

  • remove underscore from public member in MotionPlanResponse (#1939) * remove underscore from private members * fix more uses of the suffix notation

  • Contributors: Abhijeet Dasgupta, AlexWebb, Stephanie Eng

2.7.0 (2023-01-29)

  • converted characters from string format to character format (#1881)

  • Cleanup msg includes: Use C++ instead of C header (#1844)

  • Remove ancient OMPL version directives (#1825)

  • Fix BSD license in package.xml (#1796) * fix BSD license in package.xml * this must also be spdx compliant

  • Minimize use of this-> (#1784) It’s often unnecessary. MoveIt already avoids this in most cases so this PR better cements that existing pattern.

  • Enable -Wold-style-cast (#1770)

  • Remove MOVEIT_LIB_NAME (#1751) It’s more readable and searchable if we just spell out the target name.

  • Add braces around blocks. (#999)

  • Use <> for non-local headers (#1734) Unless a header lives in the same or a child directory of the file including it, it’s recommended to use <> for the #include statement. For more information, see the C++ Core Guidelines item SF.12 https://isocpp.github.io/CppCoreGuidelines/CppCoreGuidelines#sf12-prefer-the-quoted-form-of-include-for-files-relative-to-the-including-file-and-the-angle-bracket-form-everywhere-else

  • Used C++ style cast instead of C style cast (#1628) Co-authored-by: Henning Kayser <henningkayser@picknik.ai>

  • Fix clang-tidy issues (#1706) * Blindly apply automatic clang-tidy fixes * Exemplarily cleanup a few automatic clang-tidy fixes * Clang-tidy fixups * Missed const-ref fixups * Fix unsupported non-const -> const * More fixes Co-authored-by: Henning Kayser <henningkayser@picknik.ai>

  • Contributors: Abhijeet Das Gupta, Chris Thrasher, Christian Henkel, Cory Crean, Henning Kayser, Robert Haschke, Sameer Gupta

2.6.0 (2022-11-10)

  • Fix logic with enforcing constrained planning state space in OMPL (#1589)

  • Convert OMPL status to MoveItErrorCode in the OMPL interface (#1606)

  • Factor of 2 in OMPL orientation constraints, to match kinematic_constraints (#1592)

  • Merge PR #1553: Improve cmake files

  • Use standard exported targets: export_${PROJECT_NAME} -> ${PROJECT_NAME}Targets

  • Improve CMake usage (#1550)

  • size_t bijection index type (#1544)

  • Fixes for using generate_state_database (#1412)

  • simplify_solution per planning context (#1437) * Allowing to dynamically change the parameter simplify_solutions * Delete this configuration because it overrides the configuration loaded The parameters simplify_solutions is passed to the context trough the configuration of each planner but this function overrides it and seems to be contradictory to rest of the implementation. simplify_solutions shouldn’t be considered as the rest of the other parameters, like interpolate or hybridize ? * Remove simplify_solutions_ from OMPL interface and all its setter/getter * Clean-up code without ConfigureContext and unneeded code related to simplify_solution

  • correctly initialize rmw_serialized_message_t

  • automatically declare parameters from overrides

  • Remove __has_include statements (#1481)

  • Merge https://github.com/ros-planning/moveit/commit/a63580edd05b01d9480c333645036e5b2b222da9

  • Remove ConstraintSampler::project() (#3170) * Remove unused ompl_interface::ValidConstrainedSampler Last usage was removed in f2f6097ab7e272568d6ab258a53be3c7ca67cf3b. * Remove ConstraintSampler::project() sample() and project() only differ in whether they perform random sampling of the reference joint pose or not. Both of them are sampling. This was highly confusing, as from project() one wouldn’t expect sampling.

  • Contributors: Alaa, AndyZe, Antoine Duplex, Henning Kayser, Robert Haschke, Sebastian Jahr, Stephanie Eng, Tyler Weaver, Vatan Aksoy Tezer, abishalini

2.5.3 (2022-07-28)

2.5.2 (2022-07-18)

  • Merge remote-tracking branch ‘origin/main’ into feature/msa

  • Removing more boost usage (#1372)

  • Merge remote-tracking branch ‘upstream/main’ into feature/msa

  • Removing some boost usage (#1331) Co-authored-by: Vatan Aksoy Tezer <vatan@picknik.ai>

  • Add support for mixed constraints with constrained planner (#1319) Co-authored-by: AndyZe <zelenak@picknik.ai>

  • Remove unnecessary rclcpp.hpp includes (#1333)

  • Print OMPL setup info at the DEBUG level (#1330)

  • Port OMPL orientation constraints to MoveIt2 (#1273) Co-authored-by: AndyZe <andyz@utexas.edu> Co-authored-by: JeroenDM <jeroendemaeyer@live.be>

  • Merge pull request #3106 from v4hn/pr-master-bind-them-all / banish bind()

  • Cleanup OMPL’s PlanningContextManager’s protected API

  • banish bind()

  • planning_context_manager: rename protected methods

  • Contributors: AndyZe, David V. Lu, Henry Moore, Jafar, Jeroen De Maeyer, Michael Görner, Robert Haschke, Stephanie Eng, Vatan Aksoy Tezer

2.5.1 (2022-05-31)

2.5.0 (2022-05-26)

2.4.0 (2022-01-20)

  • moveit_build_options() Declare common build options like CMAKE_CXX_STANDARD, CMAKE_BUILD_TYPE, and compiler options (namely warning flags) once. Each package depending on moveit_core can use these via moveit_build_options().

  • Contributors: Robert Haschke

2.3.2 (2021-12-29)

2.3.1 (2021-12-23)

  • Add codespell to precommit, fix A LOT of spelling mistakes (#934)

  • Get rid of “std::endl” (#918)

  • changed post-increments in loops to preincrements (#888)

  • Enforce package.xml format 3 Schema (#779)

  • Update Maintainers of MoveIt package (#697)

  • Reduce log verbosity, improved info message (#714)

  • Fix #2811 (#2872) This is a PR for #2811

  • Add missing dependencies to generated dynamic_reconfigure headers

  • clang-tidy: modernize-make-shared, modernize-make-unique (#2762)

  • Contributors: Dave Coleman, David V. Lu!!, Henning Kayser, Mathias Lüdtke, Parthasarathy Bana, Robert Haschke, Sencer Yazıcı, pvanlaar, v4hn, werner291

2.3.0 (2021-10-08)

  • Fix cmake warnings (#690) * Fix -Wformat-security * Fix -Wunused-variable * Fix -Wunused-lambda-capture * Fix -Wdeprecated-declarations * Fix clang-tidy, readability-identifier-naming in moveit_kinematics

  • Fix warnings in Galactic and Rolling (#598) * Use __has_includes preprocessor directive for deprecated headers * Fix parameter template types * Proper initialization of smart pointers, rclcpp::Duration

  • Fix linking issues for ODE on macOS (#549)

  • Contributors: Henning Kayser, Nisala Kalupahana, Vatan Aksoy Tezer, David V. Lu, Jafar Abdi

2.2.1 (2021-07-12)

  • Fix test dependencies (#539)

  • Add persistent planner support back (#537)

  • Contributors: Jochen Sprickerhof, Michael Görner

2.2.0 (2021-06-30)

2.1.4 (2021-05-31)

2.1.3 (2021-05-22)

  • Fix incomplete start states in OMPL ThreadSafeStateStorage (#455)

  • ompl_interface: Fix loading group’s specific parameters (#461)

  • Contributors: Jafar Abdi, Pradeep Rajendran

2.1.2 (2021-04-20)

2.1.1 (2021-04-12)

  • Add differential drive joint model (#390)

  • Fix EXPORT install in CMake (#372)

  • OMPL constrained planning (#347) Co-authored-by: JeroenDM <jeroendemaeyer@live.be>

  • [fix] export cmake library install (#339)

  • Fix repo URLs in package.xml files

  • Contributors: Boston Cleek, David V. Lu!!, Henning Kayser, Tyler Weaver

2.1.0 (2020-11-23)

  • [fix] Rosdep dependencies for ros_testing, OpenMP (#309)

  • [fix] OMPL parameter loading (#178)

  • [maint] Wrap common cmake code in ‘moveit_package()’ macro (#285) * New moveit_package() macro for compile flags, Windows support etc * Add package ‘moveit_common’ as build dependency for moveit_package() * Added -Wno-overloaded-virtual compiler flag for moveit_ros_planners_ompl

  • [maint] Update to new moveit_resources layout (#247)

  • [maint] Enable clang-tidy-fix and ament_lint_cmake (#210)

  • [ros2-migration] Port move_group to ROS2 (#217) * switch OMPL to use pluginlib

  • Contributors: Edwin Fan, Henning Kayser, Jonathan Chapple, Lior Lustgarten

2.0.0 (2020-02-17)

  • [fix] Fix OMPL logging macros

  • [fix] Fix OMPL planner plugin install

  • [improve] Load planner parameters from subnamespace

  • [port] Port moveit_planners_ompl to ROS 2 (#142)

  • [improve] Load OMPL planner config parameters

  • [sys] replace rosunit -> ament_cmake_gtest

  • Contributors: Henning Kayser

1.1.1 (2020-10-13)

  • [maint] Add comment to MOVEIT_CLASS_FORWARD (#2315)

  • Contributors: Felix von Drigalski

1.1.0 (2020-09-04)

1.0.6 (2020-08-19)

  • [maint] Adapt repository for splitted moveit_resources layout (#2199)

  • [maint] Migrate to clang-format-10

  • [maint] Optimize includes (#2229)

  • [fix] Fix memcpy bug in copyJointToOMPLState in ompl interface (#2239)

  • Contributors: Jeroen, Markus Vieth, Robert Haschke, Michael Görner

1.0.5 (2020-07-08)

  • [feature] Added support for hybridize/interpolate flags in ModelBasedPlanningContext via ompl_planning.yaml (#2171, #2172)

  • Contributors: Constantinos, Mark Moll

1.0.4 (2020-05-30)

1.0.3 (2020-04-26)

  • [maint] Cleanup OMPL dynamic reconfigure config (#1649) * Reduce minimum number of waypoints in solution to 2

  • [maint] Apply clang-tidy fix to entire code base (#1394)

  • [maint] Fix errors: catkin_lint 1.6.7 (#1987)

  • [maint] Windows build: Fix binary artifact install locations. (#1575)

  • [maint] Use CMAKE_CXX_STANDARD to enforce c++14 (#1607)

  • Contributors: Michael Görner, Robert Haschke, Sean Yen, Yu, Yan

1.0.2 (2019-06-28)

1.0.1 (2019-03-08)

  • [improve] Apply clang tidy fix to entire code base (Part 1) (#1366)

  • Contributors: Robert Haschke, Yu, Yan

1.0.0 (2019-02-24)

  • [fix] catkin_lint issues (#1341)

  • Contributors: Dave Coleman, Robert Haschke

0.10.8 (2018-12-24)

0.10.7 (2018-12-13)

0.10.6 (2018-12-09)

  • [fix] Fixed memory leak in OMPL planner (#1104) * Resolve circular reference to ompl::geometric::SimpleSetupPtr

  • [maintenance] Use C++14 (#1146)

  • [maintenance] Code Cleanup * #1179 * #1196

  • Contributors: Alex Moriarty, Dave Coleman, Robert Haschke

0.10.5 (2018-11-01)

  • [fix] Build regression (#1174)

  • Contributors: Chris Lalancette

0.10.4 (2018-10-29)

0.10.3 (2018-10-29)

  • [maintenance] Use locale independent conversion from double to string (#1099)

  • Contributors: Simon Schmeisser

0.10.2 (2018-10-24)

  • [capability] adaptions for OMPL 1.4 (#903)

  • Contributors: Dave Coleman, Michael Görner, Mikael Arguedas, Mohmmad Ayman, Robert Haschke, mike lautman

0.10.1 (2018-05-25)

  • migration from tf to tf2 API (#830)

  • switch to ROS_LOGGER from CONSOLE_BRIDGE (#874)

  • Make trajectory interpolation in MoveIt consistent to OMPL (#869)

  • Contributors: Bryce Willey, Ian McMahon, Mikael Arguedas, Robert Haschke, Xiaojian Ma

0.9.11 (2017-12-25)

0.9.10 (2017-12-09)

  • [maintenance][kinetic onward] Remove OutputHandlerROS from ompl_interface (#609)

  • Contributors: Bence Magyar

0.9.9 (2017-08-06)

  • [improve][moveit_planners_ompl] Optional forced use of JointModelStateSpaceFactory (#541)

  • Contributors: henhenhen

0.9.8 (2017-06-21)

0.9.7 (2017-06-05)

0.9.6 (2017-04-12)

  • Always update initial robot state to prevent dirty robot state error.

  • Contributors: Henning Kayser

0.9.5 (2017-03-08)

  • [fix][moveit_ros_warehouse] gcc6 build error #423

  • Contributors: Dave Coleman

0.9.4 (2017-02-06)

  • [enhancement] ompl_interface: uniform & simplified handling of the default planner (#371)

  • [maintenance] clang-format upgraded to 3.8 (#367)

  • Contributors: Dave Coleman, Michael Goerner

0.9.3 (2016-11-16)

  • [capability] Exposed planners from latest ompl release. (#338)

  • [maintenance] Updated package.xml maintainers and author emails #330

  • Contributors: Dave Coleman, Ian McMahon, Ruben Burger

0.9.2 (2016-11-05)

0.7.0 (2016-01-30)

  • Removed trailing whitespace from entire repository

  • Fixed include directory order to make ros package shadowing work.

  • fixing internal storing of config settings

  • Make sure an overlayed OMPL is used instead of the ROS one.

  • fix simplifySolutions(bool) setter The method simplifySolutions(bool) always set the simplify_solutions member to true and the input variable “flag” was ignored. The method is fixed by setting the simplify_solutions member to the value of the input variable “flag”.

  • changed location of getDefaultPlanner

  • Contributors: Bastian Gaspers, Christian Dornhege, Dave Coleman, Dave Hershberger, Sachin Chitta

0.6.7 (2014-10-28)

  • Changed OMPL SimpleSetup member variable to shared pointer, passed MotionPlanningRequest to child function

  • Simplified number of solve() entry points in moveit_planners_ompl

  • Fixed uninitialized ptc_ pointer causing a crash.

  • renamed newGoal to new_goal for keeping with formatting

  • setting GroupStateValidityCallbackFn member for constraint_sampler member and implementing callbacks for state validity checking

  • added functions to check validit of state, and also to act as callback for constraint sampler

  • Added copy function from MoveIt robot_state joint values to ompl state

  • fix for demo constraints database linking error

  • Namespaced less useful debug output to allow to be easily silenced using ros console

  • Contributors: Dave Coleman, Dave Hershberger, Sachin Chitta, arjungm

0.6.6 (2014-07-06)

  • indigo version of moveit planners

  • fix compile error on Indigo

  • Fix for getMeasure() virtual function OMPL change

  • Move OMPL paths before catkin to avoid compilation against ROS OMPL package when specifying a different OMPL installation

  • Fixed bug which limited the number of plans considered to the number of threads.

  • Contributors: Alexander Stumpf, Chris Lewis, Dave Coleman, Ryan Luna, Sachin Chitta

0.5.5 (2014-03-22)

  • update build system for ROS indigo

  • Removed duplicate call to setPlanningScene(), added various comments

  • Contributors: Dave Coleman, Ioan Sucan

0.5.4 (2014-02-06)

  • fix segfault when multiple goals are passed to move_group

0.5.3 (2013-10-11)

  • update to new API

0.5.2 (2013-09-23)

  • porting to new robot state

0.5.1 (2013-08-13)

  • make headers and author definitions aligned the same way; white space fixes

  • namespace change for profiler

0.5.0 (2013-07-15)

0.4.2 (2013-07-12)

  • white space fixes (tabs are now spaces)

  • port ompl plugin to new base class for planning_interface (using planning contexts)

0.4.1 (2013-07-04)

  • use new location of RRTstar, add PRMstar

  • Added new cost function that takes into account robot joint movements

  • Added ability for parameter sweeping by allowing parameters to be changed in planning contexts

  • Added ability to alter configs in a cache

0.4.0 (2013-05-27)

  • propagating changes from moveit_core

0.3.11 (2013-05-02)

  • remove some debug output and add some fixes

  • some fixes for planning with constraint approximations

  • more refactoring; what used to work (including using constraint approximations) works fine. explicitly storing motions is not yet done

  • refactor constraints storage stuff

  • display random motions in a slightly more robust way

  • remove follow constraints API

  • combine ompl_interface and ompl_interface_ros

  • don’t print status

  • remove option for ordering constraint approximations (and fix #12)

  • add test for jumping configs

  • use project() instead of sample() for producing goals

  • minor fixes and add demo database construction code

  • switch to using the profiler in moveit and add one more debug tool

0.3.10 (2013-04-17)

  • Merge branch ‘groovy-devel’ of github.com:ros-planning/moveit_planners into groovy-devel

  • remove incorrect dep

  • add dynamic reconfigure options for #2

0.3.9 (2013-04-16 13:39)

  • disable old style benchmarking

0.3.8 (2013-04-16 11:23)

  • fix #8

  • use namespace option in ompl plugin

  • remove unused functions

  • add buildtool depends

  • Fixed state deserialization: now update var transform too

  • collapse OMPL plugin to one package

  • robustness fix

  • Fixed github url name

0.3.7 (2013-03-09)

  • Remove configure from PlanningScene

  • add multi-collision to PlanningScene

  • renaming kinematic_model to robot_model

0.3.6 (2013-02-02)

  • complete renaming process

  • rename KinematicState to RobotState, KinematicTrajectory to RobotTrajectory

  • propagating fixes from moveit_core

  • use new robot_trajectory lib

0.3.5 (2013-01-28)

  • fix reporting of goal collisions

  • add some verbose output for failing goals

  • port to new DisplayTrajectory message

  • propagate API changes from planning_interface

  • minor fix

  • use the project() method to improve constraint following algorithm

  • change default build flags

0.3.4 (2012-12-20 23:59)

  • dynamic_reconfigure workaroung

0.3.3 (2012-12-20 21:51)

  • update dyn reconfig call

0.3.2 (2012-12-20 13:45)

  • fix call to obsolete function

0.3.1 (2012-12-19)

  • using the constraint sampler loading library

  • make sure sampled goals are valid

  • fix buildtool tag

0.3.0 (2012-12-10)

  • add a debug msg

  • re-enable heuristic

  • first working version of follow planner

  • most of the follow alg, but not 100% complete yet

  • pass valid state samplers into the follow algorithm

  • add constrained valid state sampler

  • minor fixes

  • fixes some catkin CMakeLists issues

  • add code to allow execution of follow()

  • port test to groovy

  • placeholder for to-be-added algorithm

  • minor touch-ups; no real functional changes other than a bias for state samplers wrt dimension of the space (when sampling in a ball of dimension D, focus the sampling towards the surface of the ball)

  • minor & incomplete fix

0.2.5 (2012-11-26)

  • update to new message API

0.2.4 (2012-11-23)

  • improve error message

  • stricter error checking

  • update include path

0.2.3 (2012-11-21 22:47)

  • use generalized version of getMaximumExtent()

0.2.2 (2012-11-21 22:41)

  • more fixes to planners

  • removed bad include dir

  • fixed some plugin issues

  • fixed include dirs in ompl ros interface

  • added gitignore for ompl/ros

0.2.1 (2012-11-06)

  • update install location of include/

0.2.0 (2012-11-05)

  • udpate install targets

0.1.2 (2012-11-01)

  • bump version

  • install the plugin lib as well

  • add TRRT to the list of options

0.1.1 (2012-10-29)

  • fixes for build against groovy

0.1.0 (2012-10-28)

  • port to groovy

  • added some groovy build system files

  • more moving around of packages