CHANGELOG

Changelog for package moveit

2.9.0 (2024-01-09)

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

  • Contributors: Sebastian Jahr

2.8.0 (2023-09-10)

2.7.4 (2023-05-18)

2.7.3 (2023-04-24)

2.7.2 (2023-04-18)

  • moveit_py: Python interface for MoveIt 2

  • Contributors: Jens Vanhooydonck, Peter David Fagan, Robert Haschke, Sebastian Jahr

2.7.1 (2023-03-23)

2.7.0 (2023-01-29)

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

  • Contributors: Christian Henkel

2.6.0 (2022-11-10)

  • Improve CMake usage (#1550)

  • Contributors: Sebastian Jahr

2.5.3 (2022-07-28)

  • Organize package xml of MSA (#1454)

  • Contributors: Vatan Aksoy Tezer

2.5.2 (2022-07-18)

2.5.1 (2022-05-31)

2.5.0 (2022-05-26)

  • Fix copyright notice in README script (#1115)

  • Contributors: Abishalini, Henning Kayser, Robert Haschke

2.4.0 (2022-01-20)

2.3.2 (2021-12-29)

2.3.1 (2021-12-23)

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

  • Update Maintainers of MoveIt package (#697)

  • Contributors: Dave Coleman, Henning Kayser, Robert Haschke

2.3.0 (2021-10-08)

2.2.1 (2021-07-12)

2.2.0 (2021-06-30)

2.1.4 (2021-05-31)

2.1.3 (2021-05-22)

2.1.2 (2021-04-20)

  • Unify PickNik name in copyrights (#419)

  • Contributors: Tyler Weaver

2.1.1 (2021-04-12)

  • Add black formatter (#392)

  • Enable linting of moveit package (#378)

  • Enable ament_lint tests (#340)

  • Compile metapackages

  • Contributors: Henning Kayser, Tyler Weaver

2.1.0 (2020-11-23)

2.0.0 (2020-02-17)

1.1.1 (2020-10-13)

  • [feature][visualization] Clean up Rviz Motion Planning plugin, add tooltips (#2310)

  • [feature][moveit_servo] A library for servoing toward a moving pose (#2203)

  • [feature][moveit_setup_assistant] Allow showing both, visual and collision geometry (#2352)

  • [fix][moveit_setup_assistant] layout (#2349)

  • [fix][moveit_setup_assistant] group editing (#2350)

  • [fix][moveit_setup_assistant] disappearing robot on change of reference frame (#2335)

  • Contributors: Felix von Drigalski, Michael Görner, Robert Haschke, Tyler Weaver, Yoan Mollard

1.1.0 (2020-09-04)

  • [maint] Use standard cmake text for metapackages (#1620)

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

  • [maint] Remove ! from MoveIt name (#1590)

  • Contributors: Dave Coleman, Jonathan Binney, Robert Haschke, Sean Yen

1.0.1 (2019-03-08)

1.0.0 (2019-02-24)

  • [fix] catkin_lint issues (#1341)

  • [fix][moveit_setup_assistant] memory leaks (#1292)

  • [fix][moveit_core] invert waypoint velocities on reverse (#1335)

  • [fix][moveit_core] Added missing robot state update to iterative spline parameterization to prevent warnings. (#1298)

  • [fix][moveit_core] robot_model_test_utils depends on message generation (#1286)

  • [capability][moveit_kinematics] Adapt ikfast plugin to new KinematicsBase API. #1320

  • [improve] computeCartesianPath: limit joint-space jumps with IK consistency limits (#1293)

  • [improve] cleanup LMA kinematics solver #1318

  • [improve] Remove (redundant) random seeding and #attempts from RobotState::setFromIK() as the IK solver perform random seeding themselves. #1288

  • [improve] Kinematics tests, kdl cleanup #1272, #1294

  • [improve][moveit_core] Make FCL shape cache thread-local (#1316)

  • [improve][moveit_kinematics] KDL IK solver improvements (#1321)

  • [improve][moveit_setup_assistant] support dark themes (#1173)

  • [improve][moveit_ros_robot_interaction] cleanup RobotInteraction (#1287)

  • [improve][moveit_ros_robot_interaction] limit IK timeout to 0.1s for a responsive interaction behaviour (#1291)

  • [maintenance] cleanup SimpleControllerManager https://github.com/ros-planning/moveit/pull/1352

  • [maintenance][moveit_core] Add coverage analysis for moveit_core (#1133)

  • Contributors: Alexander Gutenkunst, Dave Coleman, Jonathan Binney, Keerthana Subramanian Manivannan, Martin Oehler, Michael Görner, Mike Lautman, Robert Haschke, Simon Schmeisser

0.10.8 (2018-12-24)

0.10.7 (2018-12-13)

0.10.6 (2018-12-09)

0.10.5 (2018-11-01)

  • [fix] Build regression (#1174)

  • [doc] Update README for ROS Melodic (#1171)

  • Contributors: Chris Lalancette, Ian McMahon

0.10.4 (2018-10-29)

  • [fix] Build regression (#1170)

  • Contributors: Robert Haschke

0.10.3 (2018-10-29)

  • [fix] Build regression (#1134)

  • [fix] compiler warnings (#1089)

  • [capability] Get available planning group names from MoveGroup C++ (#1159)

  • [maintenance] Store more settings of rviz’ PlanningFrame (#1135)

  • [code] cleanup, improvements (#1107, #1099, #1108, #1144, #1099)

  • Contributors: Alexander Gutenkunst, Dave Coleman, Robert Haschke, Simon Schmeisser

0.10.2 (2018-10-24)

  • [fix] Text refrences to MoveIt (#1020)

  • [fix] Eigen alignment issuses due to missing aligned allocation (#1039)

  • [fix][chomp] changelogs: migration from tf -> tf2 only accidentally became part of 0.9.12’s changelog

  • [fix] Chomp package handling issue #1086 that was introduced in ubi-agni/hotfix-#1012

  • [fix] PlanningSceneMonitor lock #1033: Fix #868 (#1057)

  • [fix] optional namespace args (#929)

  • [fix] CurrentStateMonitor update callback for floating joints to handle non-identity joint origins #984

  • [fix] reset moveit_msgs::RobotState.is_diff to false (#968) This fixes a regression introduced in #939.

  • [fix][chomp] needs to depend on cmake_modules. (#976)

  • [fix][moveit_ros_visualization] build issue in boost/thread/mutex.hpp (#1055)

  • [fix][moveit_ros_perception] planning scene lock when octomap updates too quickly (#920)

  • [fix][moveit_fake_controller_manager] latch initial pose published by fake_controller_manager (#1092)

  • [fix][moveit_setup_assistant] Some bugs (#1022, #1013)

  • [fix] continous joint limits are always satisfied (#729)

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

  • [capability][chomp] Failure recovery options for CHOMP by tweaking parameters (#987)

  • [capability] New screen for automatically generating interfaces to low level controllers(#951, #994, #908)

  • [capability][moveit_setup_assistant] Perception screen for using laser scanner point clouds. (#969)

  • [enhancement][GUI][moveit_setup_assistant] Logo for MoveIt 2.0, cleanup appearance (#1059)

  • [enhancement][GUI][moveit_setup_assistant] added a setup assistant window icon (#1028)

  • [capability][chomp] Addition of CHOMP planning adapter for optimizing result of other planners (#1012)

  • [capability][chomp] Failure recovery options for CHOMP by tweaking parameters (#987)

  • [capability][chomp] cleanup of unused parameters and code + addition of trajectory initialization methods (linear, cubic, quintic-spline) (#960)

  • [capability][moveit_ros_planning] new dynamic-reconfigure parameter wait_for_trajectory_completion to disable waiting for convergence independently from start-state checking. (#883)

  • [capability][moveit_ros_planning] Option for controller-specific duration parameters (#785)

  • [capability] Added plan_only flags to pick and place (#862)

  • [capability][moveit_kinematics] add IKP_Translation{X,Y,Z}AxisAngle4D to the cpp template, see https://github.com/ros-planning/moveit/issues/548#issuecomment-316298918

  • [capability] Benchmarking with different Motion Planners (STOMP, CHOMP, OMPL) (#992)

  • [enhancement][warehouse] added params for timeout + #retries (#1008)

  • [enhancement][moveit_ros_planning] do not wait for robot convergence, when trajectory_execution_manager finishes with status != SUCCEEDED (#1011)

  • [enhancement][moveit_ros_planning] allow execution of empty trajectories (#940)

  • [enhancement][moveit_ros_planning] avoid warning spam: “Unable to update multi-DOF joint” (#935)

  • [enhancement] Add info messages to pick and place routine (#1004)

  • [maintenance] Python3 support (#1103, #1054)

  • [maintenance] various compiler warnings (#1038)

  • [maintenance] add minimum required pluginlib version (#927)

2scholz, Adrian Zwiener, Alexander Guten kunst, Andrey Troitskiy, Chris Lalancette, d-walsh, Dave Coleman, David Watkins, dcconner, dg-shadow, Felix von Drigalski, Isaac Saito, Jonathan Binney, Kei Okada, Martin Guenther, Michael Goerner, Mikael Arguedas, Mike Lautman, Mohmmad Ayman, Raghavender Sahdev, Ridhwan Luthra, Robert Haschke, Simon Schmeisser, Sohieb Abdelrahman, srsidd, Timon Engelke, Xaver Kroischke

0.10.1 (2018-05-25)

0.9.11 (2017-12-25)

  • [fix][moveit_core] #723; attached bodies are not shown in trajectory visualization anymore #724

  • [fix][moveit_core] Shortcomings in kinematics plugins #714

  • Contributors: Henning Kayser, Michael Görner, Robert Haschke

0.9.10 (2017-12-09)

  • [fix][moveit_ros_planning] Avoid segfault when validating a multidof-only trajectory (#691). Fixes #539

  • [fix][moveit_ros_planning] find and link against tinyxml where needed (#569)

  • [fix][moveit_ros_visualization] don’t crash on empty robot_description in RobotState plugin #688

  • [fix][moveit_ros_visualization] RobotState rviz previewer: First message from e.g. latching publishers is not applied to robot state correctly (#596)

  • [fix][moveit_ros_planning_interface] MoveGroupInterface: Fixed computeCartesianPath to use selected end-effector. (#580)

  • [fix][moveit_ros_move_group] always return true in MoveGroupPlanService callback #674

  • [fix][moveit_ros_benchmarks] benchmarks: always prefer local header over system installations #630

  • [fix][moveit_setup_assistant][kinetic onward] msa: use qt4-compatible API for default font (#682)

  • [fix][moveit_setup_assistant][kinetic onward] replace explicit use of Arial with default application font (#668)

  • [fix][moveit_setup_assistant] add moveit_fake_controller_manager to run_depend of moveit_config_pkg_template/package.xml.template (#613)

  • [fix][moveit_setup_assistant] find and link against tinyxml where needed (#569)

  • [fix][moveit_kinematics][kinetic onward] Fix create_ikfast_moveit_plugin to comply with format 2 of the package.xml. Remove collada_urdf dependency #666

  • [fix][moveit_kinematics] create_ikfast_moveit_plugin: fixed directory variable for templates that were moved to ikfast_kinematics_plugin #620

  • [fix][moveit_experimental] remove explicit fcl depends #632

  • [fix][moveit_core] Add missing logWarn argument (#707)

  • [fix][moveit_core] IKConstraintSampler: Fixed transform from end-effector to ik chain tip. #582

  • [fix][moveit_core] robotStateMsgToRobotState: is_diff==true => not empty #589

  • [fix][moveit_commander] Bugs in moveit_commander/robot.py (#621)

  • [fix][moveit_commander] pyassimp regression workaround (#581)

  • [capability][moveit_ros_planning] Multi DOF Trajectory only providing translation not velocity (#555)

  • [capability][moveit_ros_planning_interface][kinetic onward] Adapt pick pipeline to function without object (#599)

  • [capability][moveit_simple_controller_manager][kinetic onward] optionally wait for controllers indefinitely (#695)

  • [capability] Multi DOF Trajectory only providing translation not velocity (#555)

  • [capability] Adds parameter lookup function for kinematics plugins (#701)

  • [improve][moveit_ros_planning_interface] Disabled copy constructors and added a move constructor to MoveGroupInterface (#664)

  • [improve][moveit_ros_perception] removed deprecated pluginlib macro (#677)

  • [improve][moveit_ros_move_group] adding swp’s to gitignore and removing redundant capabilites from capability_names.h (#704)

  • [improve][moveit_kinematics] IKFastTemplate: Expand solutions to full joint range in searchPositionIK #598

  • [improve][moveit_kinematics] IKFastTemplate: searchPositionIK now returns collision-free solution which is nearest to seed state. (#585)

  • [improve][moveit_core] Make operator bool() explicit #696

  • [improve][moveit_core] Get msgs from Planning Scene #663

  • [improve][moveit_core] moveit_core: export DEPENDS on LIBFCL #632

  • [improve][moveit_core] RobotState: Changed multi-waypoint version of computeCartesianPath to test joint space jumps after all waypoints are generated. (#576)

  • [improve][moveit_core] Better debug output for IK tip frames (#603)

  • [improve][moveit_core] New debug console colors YELLOW PURPLE (#604)

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

  • [doc][moveit_ros_visualization] Document auto scale in Rviz plugin (#602)

  • Contributors: axelschroth, 2scholz, Bence Magyar, Bruno Brito, Dave Coleman, Dennis Hartmann, fsuarez6, G.A. vd. Hoorn, Henning Kayser, Isaac I.Y. Saito, Jonathan Meyer, Jorge Nicho, Kei Okada, Konstantin Selyunin, Michael Goerner, Mikael Arguedas, Mike Lautman, Phil, Shingo Kitagawa, Simon Schmeisser, Simon Schmeisser, Sarah Elliott, Shingo Kitagawa, Troy Cordie, William Woodall

0.9.9 (2017-08-06)

  • Fixation in the contained packages:

    • [fix][moveit_ros_planning] Change getCurrentExpectedTrajectory index so collision detection is still performed even if the path timing is not known (#550)

    • [fix][moveit_ros_planning] check plan size for plan length=0 #535

    • [fix][moveit_ros_planning] ros_error macro name (#544)

    • [fix][moveit_ros_visualization] RobotStateVisualization: clear before load to avoid segfault #572

    • [fix][setup_assistant] Fix for lunar (#542) (fix #506)

    • [fix][moveit_core] segfault due to missing string format parameter. (#547)

    • [fix][moveit_core] doc-comment for robot_state::computeAABB (#516)

  • Improvement in the contained packages:

    • [improve][moveit_ros_planning] Chomp use PlanningScene (#546) to partially address #305

    • [improve][moveit_ros_control_interface] add backward compatibility patch for indigo (#551)

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

    • [improve][moveit_kinematics] Modify ikfast_template for getPositionIK single solution results (#537)

  • Contributors: Cyrille Morin, henhenhen, Martin Pecka, Simon Schmeisser, Michael Goerner, Mikael Arguedas, nsnitish

0.9.8 (2017-06-21)

  • [fix][moveit_ros_visualization] TrajectoryVisualization crash if no window_context exists (#523, #525)

  • [fix][moveit_ros_visualization] robot display: Don’t reload robot model upon topic change (Fixes #528)

  • [fix][moveit_ros_planning] Include callback of execution status if trajectory is invalid. (#524)

  • [fix][simple_controller_manager] include order (#529)

  • [enhance][moveit_ros_visualization] rviz display: stop trajectory visualization on new plan. Fixes #526 (#531, #510).

  • [enhance][moveit_setup_assistant] setup assistant: add use_gui param to demo.launch (#532)

  • [build][moveit_kinematics] adjust cmake_minimum_required for add_compile_options (#521)

  • [build][moveit_kinematics] ikfast_kinematics_plugin: Add c++11 compile option. This is required for Kinetic.

  • [build][moveit_kinematics] ikfast_kinematics_plugin: Write XML files as UTF-8 (#514)

  • [build][moveit_ros_visualization] add Qt-moc guards for boost 1.64 compatibility (#534)

  • Contributors: dougsm, Martin Guenther, Michael Goerner, Isaac I.Y. Saito, Simon Schmeisser, Yannick Jonetzko, henhenhen

0.9.7 (2017-06-05)

  • [fix][ikfast_kinematics_plugin][Kinetic+] Add c++11 compile option #515

  • [fix][moveit_kinematics][Indigo] Eigen3 dependency (#470)

  • [fix][moveit_ros] Build for Ubuntu YZ by adding BOOST_MATH_DISABLE_FLOAT128 (#505)

  • [fix][moveit_core] checks for empty name arrays messages before parsing the robot state message data (#499)

  • [capability][visualization] New panel with a slider to control the visualized trajectory (#491) (#508)

  • [improve][MSA] Open a directory where setup_assistant.launch was started. (#509)

  • Contributors: Jorge Nicho, Michael Goerner, Martin Guenther, YuehChuan, Dave Coleman, Isaac I.Y. Saito, Mikael Arguedas

0.9.6 (2017-04-12)

  • [fix] warehouse services (#474)

  • [fix][moveit_ros_visualization] RViz plugin some cosmetics and minor refactoring #482

  • [fix][moveit_ros_visualization] rviz panel: Don’t add object marker if the wrong tab is selected #454

  • [fix][moveit_ros_robot_interaction] catkin_make -DCMAKE_ENABLE_TESTING=0 failure (#478)

  • [fix] gcc6 build error (#471, #458)

  • [fix][moveit_ros_manipulation] Set planning frame correctly in evaluation of reachable and valid pose filter (#476)

  • [fix] gcc6 build error (#471, #458)

  • [fix] undefined symbol in planning_scene_monitor (#463)

  • [fix][moveit_planners_ompl] Always update initial robot state to prevent dirty robot state error. #448

  • [fix][moveit_core] PlanarJointModel::getVariableRandomPositionsNearBy (#464)

  • [improve][moveit_ros_visualization] RobotState display [kinetic] (#465)

  • [improve][moveit_ros_planning_interface] MoveGroupInterface: add public interface to construct the MotionPlanRequest (#461)

  • [improve][moveit_ros_benchmarks] Add install rule for examples, statistics script

  • [improve] Add warning if no IK solvers found (#485)

  • Contributors: Ruben Burger, Dave Coleman, Yannick Jonetzko, Henning Kayser, Beatriz Leon, Bence Magyar, Jorge Nicho, Tamaki Nishino, Michael Goerner, Dmitry Rozhkov, Isaac I.Y. Saito

0.9.5 (2017-03-08)

  • [fix] correct “simplify widget handling” #452 This reverts “simplify widget handling (#442)”

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

  • [fix] Regression on Ubuntu Xenial; numpy.ndarray indices bug (from #86) (#450).

  • [enhancement] Remove “catch (…)” instances, catch std::exception instead of std::runtime_error (#445)

  • [enhancement][MoveGroup] Add getLinkNames function (#440)

  • [doc][moveit_commander] added description for set_start_state (#447)

  • Contributors: Adam Allevato, Dave Coleman, Bence Magyar, Dave Coleman, Isaac I.Y. Saito, Yannick Jonetzko, Ravi Prakash Joshi

0.9.4 (2017-02-06)

0.9.3 (2016-11-16)

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

  • Contributors: Dave Coleman, Ian McMahon

0.9.2 (2016-11-05)

0.9.0 (2016-10-19)

  • Initial release into ROS Kinetic