Changelog for package moveit_ros_planning
1.0.11 (2022-09-13)
1.0.10 (2022-03-06)
1.0.9 (2022-01-09)
- Use moveit-resources@master (#2951)
- Simplify launch files to use the test_environment.launch files from moveit_resources@master
- Provide compatibility to the Noetic-style configuration of (multiple) planning pipelines
Only a single pipeline can be used at a time, specified via the ~default_planning_pipeline parameter.
- Contributors: Robert Haschke
1.0.8 (2021-05-23)
- Unify and simplify CSM::haveCompleteState overloads (#2663)
- FixStartStateBounds: Copy attached bodies when adapting the start state (#2398)
- PlanExecution: Correctly handle preempt-requested flag (#2554)
- thread safety in clear octomap & only update geometry (#2500)
- Fix some typos in comments (#2466)
- Simplify logic in PSM (#2632) (#2637)
- Contributors: Jafar Abdi, Michael Görner, Robert Haschke, Simon Schmeisser, Tyler Weaver, Udbhavbisarya23
1.0.7 (2020-11-20)
- [fix] Fix "Clear Octomap" button, disable when no octomap is published (#2320)
- [maint] Add comment to MOVEIT_CLASS_FORWARD (#2315)
- Contributors: Felix von Drigalski
1.0.6 (2020-08-19)
- [fix] Fix segfault in PSM::clearOctomap() (#2193)
- [maint] Migrate to clang-format-10
- [maint] Optimize includes (#2229)
- Contributors: Henning Kayser, Markus Vieth, Robert Haschke
1.0.5 (2020-07-08)
- [feature] Trajectory Execution: fix check for start state position (#2157)
- [feature] Improve responsiveness of PlanningSceneDisplay (#2049)
- PlanningSceneMonitor: increate update frequency from 10Hz to 30Hz
- send RobotState diff if only position changed
- Contributors: Michael Görner, Robert Haschke, Simon Schmeisser
1.0.4 (2020-05-30)
1.0.3 (2020-04-26)
- [fix] CurrentStateMonitor: Initialize velocity/effort with unset dynamics
- [fix] Fix spurious warning message (# IK attempts) (#1876)
- [maint] Move get_planning_scene service into PlanningSceneMonitor for reusability (#1854)
- [feature] Forward controller names to TrajectoryExecutionManager
- [fix] Always copy dynamics if enabled in CurrentStateMonitor (#1676)
- [feature] TrajectoryMonitor: zero sampling frequency disables trajectory recording (#1542)
- [feature] Add user warning when planning fails with multiple constraints (#1443)
- [maint] Apply clang-tidy fix to entire code base (#1394)
- [maint] Fix errors: catkin_lint 1.6.7 (#1987)
- [maint] Windows build fixes
* Fix header inclusion and other MSVC build errors (#1636)
* Fix binary artifact install locations. (#1575)
* Favor ros::Duration.sleep over sleep. (#1634)
* Remove GCC extensions (#1583)
* Fix binary artifact install locations. (#1575)
- [maint] Use CMAKE_CXX_STANDARD to enforce c++14 (#1607)
- [fix] Fix potential memory leak in RDFLoader (#1828)
[maint] Use smart pointers to avoid explicit new/delete
- [fix] TrajectoryExecutionManager: fix race condition (#1709)
- [fix] Correctly propagate error if time parameterization fails (#1562)
- [maint] move occupancy_map_monitor into its own package (#1533)
- [feature] PlanExecution: return executed trajectory (#1538)
- Contributors: Felix von Drigalski, Henning Kayser, Max Krichenbauer, Michael Görner, Robert Haschke, Sean Yen, Yu, Yan, jschleicher, livanov93, Luca Lach
1.0.2 (2019-06-28)
- [fix] Removed MessageFilter for /collision_object messages (#1406)
- Contributors: Robert Haschke
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)
- [maintenance] Travis: enable warnings and catkin_lint checker (#1332)
- [improve] Remove (redundant) random seeding and #attempts from RobotState::setFromIK() as the IK solver perform random seeding themselves. #1288
- Contributors: Robert Haschke
0.10.8 (2018-12-24)
- [maintenance] RDFLoader / RobotModelLoader: remove TinyXML API (#1254)
- [enhancement] Cmdline tool to print planning scene info (#1239)
- Contributors: Dave Coleman, Robert Haschke
0.10.7 (2018-12-13)
0.10.6 (2018-12-09)
- [fix] Fixed various memory leaks (#1104)
* KinematicsPluginLoader: only cache the latest instance
* Use createUniqueInstance()
- [fix] Use correct trajectory_initialization_method parameter (#1237)
- [enhancement] Pass RobotModel to IK, avoiding multiple loading (#1166)
- [maintenance] Replaced Eigen::Affine3d -> Eigen::Isometry3d (#1096)
- [maintenance] Use C++14 (#1146)
- [maintenance] Code Cleanup
* #1179
* #1180
* #1196
- [maintenance] Change dynamic reconfigure limits for allowed_goal_duration_margin to 30s (#993)
- Contributors: Alex Moriarty, Dave Coleman, Hamal Marino, Michael Görner, Robert Haschke, Stephan
0.10.5 (2018-11-01)
0.10.4 (2018-10-29)
- [fix] Build regression (#1170)
- Contributors: Robert Haschke
0.10.3 (2018-10-29)
- [fix] Build regression (#1134)
- Contributors: Robert Haschke
0.10.2 (2018-10-24)
- [fix] Chomp package handling issue #1086 that was introduced in ubi-agni/hotfix-#1012
- [fix] PlanningSceneMonitor lock #1033: Fix #868 (#1057)
- [fix] CurrentStateMonitor update callback for floating joints to handle non-identity joint origins #984
- [fix] Eigen alignment issuses due to missing aligned allocation (#1039)
- [fix] reset moveit_msgs::RobotState.is_diff to false (#968) This fixes a regression introduced in #939.
- [capability][chomp] Addition of CHOMP planning adapter for optimizing result of other planners (#1012)
- [capability] new dynamic-reconfigure parameter wait_for_trajectory_completion to disable waiting for convergence independently from start-state checking. (#883)
- [capability] Option for controller-specific duration parameters (#785)
- [enhancement] do not wait for robot convergence, when trajectory_execution_manager finishes with status != SUCCEEDED (#1011)
- [enhancement] allow execution of empty trajectories (#940)
- [enhancement] avoid warning spam: "Unable to update multi-DOF joint" (#935)
- Contributors: 2scholz, Adrian Zwiener, Kei Okada, Michael Görner, Mohmmad Ayman, Raghavender Sahdev, Robert Haschke, Simon Schmeisser, Xaver Kroischke, mike lautman, srsidd
0.10.1 (2018-05-25)
- [fix] explicitly enforce updateSceneWithCurrentState() in waitForCurrentRobotState() (#824)
- Support static TFs for multi-DOF joints in CurrentStateMonitor (#799)
- support xacro args (#796)
- CSM: wait for active joint states only (#792)
- skip non-actuated joints for execution (#754)
- Iterative cubic spline interpolation (#441)
- Floating Joint Support in CurrentStateMonitor (#748)
- validate multi-dof trajectories before execution (#713)
- Contributors: Bruno Brito, Dave Coleman, Ian McMahon, Ken Anderson, Michael Görner, Mikael Arguedas, Robert Haschke
0.9.11 (2017-12-25)
0.9.10 (2017-12-09)
- [fix] Avoid segfault when validating a multidof-only trajectory (#691). Fixes #539
- [fix] find and link against tinyxml where needed (#569)
- [capability] Multi DOF Trajectory only providing translation not velocity (#555)
- Contributors: Isaac I.Y. Saito, Michael Görner, Mikael Arguedas, Troy Cordie
0.9.9 (2017-08-06)
- [fix] Change getCurrentExpectedTrajectory index so collision detection is still performed even if the path timing is not known (#550)
- [fix] Support for MultiDoF only trajectories #553
- [fix] ros_error macro name (#544)
- [fix] check plan size for plan length=0 #535
- Contributors: Cyrille Morin, Michael Görner, Mikael Arguedas, Notou, Unknown
0.9.8 (2017-06-21)
- [fix] Include callback of execution status if trajectory is invalid. (#524)
- Contributors: dougsm
0.9.7 (2017-06-05)
0.9.6 (2017-04-12)
- [fix] gcc6 build error (#471, #458)
- [fix] undefined symbol in planning_scene_monitor (#463)
- Contributors: Dmitry Rozhkov, Ruben Burger
0.9.5 (2017-03-08)
- [enhancement] Remove "catch (...)" instances, catch std::exception instead of std::runtime_error (#445)
- Contributors: Bence Magyar
0.9.4 (2017-02-06)
- [fix] race conditions when updating PlanningScene (#350)
- [maintenance] Use static_cast to cast to const. (#433)
- [maintenance] clang-format upgraded to 3.8 (#367)
- Contributors: Dave Coleman, Maarten de Vries, Robert Haschke
0.9.3 (2016-11-16)
- [fix] cleanup urdfdom compatibility (#319)
- [maintenance] Updated package.xml maintainers and author emails #330
- Contributors: Dave Coleman, Ian McMahon, Robert Haschke
0.9.2 (2016-11-05)
- [Capability] compatibility to urdfdom < 0.4 (#317)
- [Maintenance] Auto format codebase using clang-format (#284)
- Contributors: Dave Coleman, Robert Haschke
0.6.6 (2016-06-08)
- Add library moveit_collision_plugin_loader as an exported catkin library (#678)
- replaced cmake_modules dependency with eigen
- [jade] eigen3 adjustment
- Fix compilation with C++11.
- Enable optional build against Qt5, use -DUseQt5=On to enable it
- merge indigo-devel changes (PR #633 trailing whitespace) into jade-devel
- Removed trailing whitespace from entire repository
- Optional ability to copy velocity and effort to RobotState
- cherry-picked PR #614
fixed segfault on shutdown
- fixed segfault on shutdown
use of pluginlib's createUnmanagedInstance() is strongly discouraged:
http://wiki.ros.org/class_loader#Understanding_Loading_and_Unloading
here, the kinematics plugin libs were unloaded before destruction of corresponding pointers
- Deprecate shape_tools
- CurrentStateMonitor no longer requires hearing mimic joint state values.
- Fix crash due to robot state not getting updated (moveit_ros #559)
- Contributors: Dave Coleman, Dave Hershberger, Isaac I.Y. Saito, Levi Armstrong, Maarten de Vries, Robert Haschke, Simon Schmeisser (isys vision), kohlbrecher
0.6.5 (2015-01-24)
- update maintainers
- perception: adding RAII-based locking for OccMapTree
- perception: adding locks to planning scene monitor
- Add time factor support for iterative_time_parametrization
- Contributors: Jonathan Bohren, Michael Ferguson, kohlbrecher
0.6.4 (2014-12-20)
- Namespaced "traj_execution" for all trajectory_execution_manager logging
- planning_scene_monitor: add ros parameter for adding a wait-for-transform lookup time
fixes #465
- Contributors: Dave Coleman, Jonathan Bohren
0.6.3 (2014-12-03)
- add plugin interface for collision detectors
- fix missing return value
- trivial fixes for warnings
- Contributors: Michael Ferguson
0.6.2 (2014-10-31)
0.6.1 (2014-10-31)
- re-add libqt4 dependency (previously came from pcl-all)
- Contributors: Michael Ferguson
0.6.0 (2014-10-27)
- Removed leadings slash from rosparam for robot padding
- Added move_group capability for clearing octomap.
- Made loading octomap_monitor optional in planning_scene_monitor when using WorldGeometryMonitor
- Contributors: Dave Coleman, Dave Hershberger, Sachin Chitta, ahb
0.5.19 (2014-06-23)
- Updated doxygen comment in TrajectoryExecutionManager.
- Added more informative error message text when cant' find controllers.
- robot_model_loader.cpp: added call to KinematicsBase::supportsGroup().
- Fix [-Wreorder] warning.
- Fix broken log & output statements.
- Address [cppcheck: coutCerrMisusage] and [-Werror=format-extra-args] errors.
- ROS_ERROR -> ROS_ERROR_NAMED.
- Print size_t values portably.
- Address [-Wreturn-type] warning.
- Address [cppcheck: postfixOperator] warning.
- Address [cppcheck: duplicateIf] error.
The same condition was being checked twice, and the same action was being taken.
- Add check for planning scene monitor connection, with 5 sec delay
- Fix for building srv_kinematics_plugin
- New ROS service call-based IK plugin
- Allow planning groups to have more than one tip
- Contributors: Adolfo Rodriguez Tsouroukdissian, Dave Coleman, Dave Hershberger
0.5.18 (2014-03-23)
0.5.17 (2014-03-22)
- update build system for ROS indigo
- update maintainer e-mail
- Namespace a debug message
- Minor non-functional changes to KDL
- Contributors: Dave Coleman, Ioan Sucan
0.5.16 (2014-02-27)
- Copy paste error fix
- Contributors: fivef
0.5.14 (2014-02-06)
0.5.13 (2014-02-06)
- remove debug printfs
- planning_scene_monitor: add requestPlanningSceneState()
- planning_scene_monitor: fix race condition
- planning_scene_monitor: fix state update bug
The rate of state updates is limited to dt_state_update per second.
When an update arrived it was not processed if another was recently
processed. This meant that if a quick sequence of state updates
arrived and then no updates arrive for a while that the last update(s)
were not seen until another arrives (which may be much later or
never). This fixes the bug by periodically checking for pending
updates and running them if they have been pending longer than
dt_state_update.
- add default_robot_link_padding/scale, set padding/scale value for each robot link, see https://github.com/ros-planning/moveit_ros/issues/402
- fix LockedPlanningSceneRW docs
fix the text that was originally copied from another class
(from LockedPlanningSceneRO)
it mentioned an incorrect return value type of
LockedPlanningSceneRW::operator->()
- Contributors: Acorn Pooley, Filip Jares, Kei Okada
0.5.12 (2014-01-03)
- Fixed trailing underscores in CHANGELOGs.
- Contributors: Dave Hershberger
0.5.11 (2014-01-03)
- planning_scene_monitor: slight code simplification
- planning_scene_monitor: fix scope of local vars
- planning_scene_monitor: fix init bug
scene_const_ not set if scene passed to constructor.
- kdl_kinematics_plugin: fix warning
- Contributors: Acorn Pooley
0.5.10 (2013-12-08)
- fixing how joint names are filled up, fixed joints were getting included earlier, also resizing consistency limits for when random positions near by function is being called
- Contributors: Sachin Chitta
0.5.9 (2013-12-03)
- Doxygen: added warnings and details to planning_scene_monitor.h
- correcting maintainer email
- remove duplicate header
- Fixed exported targets
- Fixed dependency issue
- fixing joint limits setup for mimic joints
- implement feature requests
- clear monitored octomap when needed (see #315)
- fix the adapter for fixing path constraints for initial states
- fixed computation of dimension_.
- bugfixes in indexing added states for path adapters
- fixes for mimic joints and redundant joints
0.5.8 (2013-10-11)
- add executable for publishing scene geometry from text
- Made the goal duration margin and scaling optional rosparameters
- bugfixes
0.5.7 (2013-10-01)
0.5.6 (2013-09-26)
0.5.5 (2013-09-23)
- fix the event triggered on updating attached objects
- make scene monitor trigger updates only when needed
- fix loading of default params
- port to new RobotState API, new messages
- make sure we do not overwrite attached bodies, when updating the current state
- fix #308
- fix #304
- fix issue with sending trajectories for passive/mimic/fixed joints
- pass effort along
0.5.4 (2013-08-14)
- remove CollisionMap, expose topic names in PlanningSceneMonitor, implement detach / attach operations as requested by #280
- make headers and author definitions aligned the same way; white space fixes
- move background_processing lib to core
- add option to disable trajectory monitoring
0.5.2 (2013-07-15)
0.5.1 (2013-07-14)
0.5.0 (2013-07-12)
- minor doc fixes
- add docs for planning pipeline
- cleanup build system
- fixing approximate ik calculation
- white space fixes (tabs are now spaces)
- adding check for approximate solution flag
- adding options struct to kinematics base
- port to new base class for planning_interface (using planning contexts)
0.4.5 (2013-07-03)
- Namespaced ROS_* log messages for better debug fitering - added 'kdl' namespace
- remove dep
- make searchPositionIK actually const, and thread-safe
- Made debug output look better
0.4.4 (2013-06-26)
- fix #210
- added dynamic reconfigure parameters to allow enabling/disabling of trajectory duration monitoring. fixes #256
- add state operations evaluation tool
- warn when time parametrization fails
- moved exceptions headers