Changelog for package moveit_ros_planning_interface
1.1.16 (2024-10-07)
1.1.15 (2024-09-09)
- PSI: allow persistent connections for [get|apply]_planning_scene services (#3628)
- New implementation for computeCartesianPath (#3618)
- Contributors: Cesare Tonola, Robert Haschke
1.1.14 (2024-05-27)
- MoveGroupInterface: allow RobotState diffs as start state (#3592)
- Augment Python PlanningSceneInterface API (#3534)
- Add PlanningSceneInterface::clear() (#3512)
- PSI::getKnownObjectNamesInROI: consider collision object's pose (#3477)
- Contributors: Aaryan Murgunde, Jorge Santos Simón, Robert Haschke, Tom Noble
1.1.13 (2023-07-28)
- Add unittest for #3467 (#3470)
- Contributors: Robert Haschke
1.1.11 (2022-12-21)
1.1.10 (2022-09-13)
- Limit Cartesian speed for link(s) (#2856)
- Generalize computeCartesianPath() to consider a link_offset (#3197)
- Validate JointState argument to moveit_commander.set_joint_value_target (#3187)
- Add dual arm test (#3119)
- Replace bind() with lambdas (#3106)
- Replace obsolete distutils.core with setuptools (#3103)
- Contributors: Filip Sund, Michael Görner, Robert Haschke, Stephanie Eng, cambel, v4hn
1.1.9 (2022-03-06)
1.1.8 (2022-01-30)
1.1.7 (2021-12-31)
- Move MoveItErrorCode class to moveit_core (#3009)
- Fix uninitialized RobotState in MoveGroupInterface (#3008)
- Switch to std::bind (#2967)
- Contributors: Captain Yoshi, Jafar Abdi, Jochen Sprickerhof
1.1.6 (2021-11-06)
- Use test_environment.launch in unittests (#2949)
- Use newly introduced cmake macro moveit_build_options() from moveit_core
- Add missing replan/look options to interface (#2892)
- PSI: get object.pose from new msg field (#2877)
- Introduce a reference frame for collision objects (#2037)
- Fix trajectory constraints for moveit_commander (#2429)
- MGI::setStartState: Only fetch current state when new state is diff (#2775)
- clang-tidy: modernize-make-shared, modernize-make-unique (#2762)
- Contributors: Felix von Drigalski, Gauthier Hentz, Kevin Chang, Michael Görner, Robert Haschke, pvanlaar
1.1.5 (2021-05-23)
- Allow selecting planning pipeline in MotionSequenceAction (#2657)
- Contributors: Felix von Drigalski
1.1.4 (2021-05-12)
- planning_interface: synchronize async interfaces in unit tests (#2640)
- Contributors: Michael Görner
1.1.3 (2021-04-29)
- Add planning_pipeline_id setting to Python MGI (#2622)
- Fix docstring in MGI API (#2626)
- Contributors: Felix von Drigalski, Michael Görner
1.1.2 (2021-04-08)
- Fix formatting errors
- Support multiple planning pipelines with MoveGroup via MoveItCpp (#2127)
- Move moveit_cpp to moveit_ros_planning
- Add get_active_joint_names (#2533)
- Add debugging log statement for a common error (#2509)
- Replaced eigen+kdl conversions with tf2_eigen + tf2_kdl (#2472)
- Improve robustness of subframes test (#2488)
- Improve robustness of move group interface test (#2484)
- Fix scaling factor parameter names (#2452)
- Python interface improvements. Fix #1966, add enforceBounds (#2356)
- Unit Test for ByteString-based ROS msg conversion (#2362)
- Contributors: Bjar Ne, Boston Cleek, Henning Kayser, Peter Mitrano, Shota Aoki, Tyler Weaver, petkovich
1.1.1 (2020-10-13)
- [feature] moveit_cpp: more informative error message, cover another potential failure condition. (#2336)
- [fix] Make GILReleaser exception-safe (#2363)
- [maint] Add comment to MOVEIT_CLASS_FORWARD (#2315)
- [maint] Replace panda_moveit_config -> moveit_resources_panda_moveit_config (#2300)
- Contributors: AndyZe, Bjar Ne, Felix von Drigalski, Robert Haschke
1.1.0 (2020-09-04)
- [feature] Use Eigen::Transform::linear() instead of rotation() (#1964)
- [feature] move_group pick place test (#2031)
- [feature] Check for grasp service - general cleanup MGI (#2077)
- [feature] Integration test to defend subframe tutorial (#1757)
- [feature] Release Python GIL for C++ calls (#1947)
- [feature] Add default velocity/acceleration scaling factors (#1890)
- [feature] Improve move_group_interface's const correctness (#1715)
- [feature] Add get_jacobian_matrix to moveit_commander (#1501)
- [feature] Add named frames to CollisionObjects (#1439)
- [feature] Added GILRelease to pick and place (#2272)
- [feature] Add missing variants of place from list of PlaceLocations and Poses in the python interface (#2231)
- [fix] Various fixes for upcoming Noetic release (#2180)
- [fix] Resolve PSI lock-up in RViz display (#1951)
- [fix] Fix flaky moveit_cpp test (#1781)
- [fix] Fix compiler warnings (#1773)
- [maint] Fix a parameter mix-up in moveit_cpp loading (#2187)
- [maint] Optional cpp version setting (#2166)
- [maint] update dependencies for python3 in noetic (#2131)
- [maint] clang-tidy fixes (#2050, #1586, #1419)
- [maint] Fix some clang tidy issues (#2004)
- [maint] export moveit_py_bindings_tools library (#1970)
- [maint] Fix usage of panda_moveit_config (#1904)
- [maint] Replace namespaces robot_state and robot_model with moveit::core (#1924)
- [maint] Fix typo in cmake file (#1857)
- [maint] Reduce console output warnings (#1845)
- [maint] Switch from include guards to pragma once (#1615)
- [maint] Remove ! from MoveIt name (#1590)
- [maint] improve [get|set]JointValueTarget in python wrapper (#858)
- [maint] moveit_commander.MoveGroupInterface.plan() to better align with C++ MoveGroup::plan() (#790)
- Contributors: AndyZe, Ayush Garg, Bence Magyar, Bjar Ne, Dave Coleman, Felix von Drigalski, Gerard Canal, Guilhem Saurel, Henning Kayser, Jafar Abdi, JafarAbdi, Jere Liukkonen, Jonathan Binney, Kunal Tyagi, Luca Rinelli, Mahmoud Ahmed Selim, Markus Vieth, Martin Pecka, Masaki Murooka, Michael Ferguson, Michael Görner, Niklas Fiedler, Robert Haschke, Ryosuke Tajima, Sean Yen, Tyler Weaver, Yeshwanth, Yu, Yan, mvieth, v4hn
1.0.6 (2020-08-19)
- [maint] Adapt repository for splitted moveit_resources layout (#2199)
- [maint] Migrate to clang-format-10, Fix warnings
- [maint] Optimize includes (#2229)
- [feature] Exposed parameter wait_for_servers and getPlannerId() API in MoveGroup's Python API (#2201)
- Contributors: Gerard Canal, Markus Vieth, Robert Haschke, Michael Görner
1.0.5 (2020-07-08)
- [maint] Remove dependency on panda_moveit_config (#2194 <https://github.com/ros-planning/moveit/issues/2194>`_, #2197 <https://github.com/ros-planning/moveit/issues/2197>`_)
- [maint] Adapt linking to eigenpy (#2118)
- [maint] Replace robot_model and robot_state namespaces with moveit::core (#2135)
- [feature] PlanningComponent: Load plan_request_params (#2033)
- [feature] MoveItCpp: a high-level C++ planning API (#1656)
- [fix] Validate action client pointer before access
- [fix] Wait and check for the grasp service
- [maint] Add tests for move_group interface (#1995)
- Contributors: AndyZe, Henning Kayser, Jafar Abdi, Michael Görner, Robert Haschke, Tyler Weaver, Yeshwanth
1.0.4 (2020-05-30)
1.0.3 (2020-04-26)
- [feature] MoveGroupInterface: Add execution methods for moveit_msgs::RobotTrajectory (#1955)
- [feature] Allow to instantiate a PlanningSceneInterface w/ and w/o a running move_group node
- [fix] Release Python GIL for C++ calls (#1947)
- [feature] Expose reference_point_position parameter in getJacobian() (#1595)
- [feature] MoveGroupInterface: Expose constructPickGoal and constructPlaceGoal (#1498)
- [feature] python MoveGroupInterface: Added custom time limit for wait_for_servers() (#1444)
- [maint] Apply clang-tidy fix to entire code base (#1394)
- [maint] Fix errors: catkin_lint 1.6.7 (#1987)
- [maint] Improve Python 3 compatibility (#1870)
* Replaced StringIO with BytesIO for python msg serialization
* Use py_bindings_tools::ByteString as byte-based serialization buffer on C++ side
- [feature] Export moveit_py_bindings_tools library
- [maint] Fix various build issues on Windows
* Use .pyd as the output suffix for Python module on Windows. (#1637)
* Favor ros::Duration.sleep over sleep. (#1634)
* Fix binary artifact install locations. (#1575)
- [maint] Use CMAKE_CXX_STANDARD to enforce c++14 (#1607)
- [maint] Updated deprecation method: MOVEIT_DEPRECATED -> [[deprecated]] (#1748)
- [maint] eigenpy: switched to system package (#1737)
- [featue] PlanningSceneInterface: wait for its two services
- [feature] Select time parametrization algorithm in retime_trajectory (#1508)
- Contributors: Bjar Ne, Felix von Drigalski, Kunal Tyagi, Luca Rinelli, Masaki Murooka, Michael Görner, Niklas Fiedler, Robert Haschke, Sean Yen, Yu, Yan, mvieth, v4hn
1.0.2 (2019-06-28)
- [maintenance] Removed unnecessary null pointer checks on deletion (#1410)
- Contributors: Mahmoud Ahmed Selim
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)
- [improve] Remove (redundant) random seeding and #attempts from RobotState::setFromIK() as the IK solver perform random seeding themselves. #1288
- Contributors: Dave Coleman, Robert Haschke
0.10.8 (2018-12-24)
0.10.7 (2018-12-13)
- [fix] Fixed destruction order of shared tf2::Buffer / tf2::TransformListener (#1261)
- Contributors: Robert Haschke
0.10.6 (2018-12-09)
- [fix] Fixed various memory leaks (#1104)
* SharedStorage: Use weak_ptrs for caching
- [enhancement] Add getMoveGroupClient() to move_group_interface (#1215)
- [maintenance] Replaced Eigen::Affine3d -> Eigen::Isometry3d (#1096)
- [maintenance] Remove deprecated MoveGroup class (#1211)
- [maintenance] Use C++14 (#1146)
- [maintenance] Code Cleanup
* #1179
* #1196
- Contributors: Alex Moriarty, Dave Coleman, Martin Günther, Michael Görner, Robert Haschke
0.10.5 (2018-11-01)
0.10.4 (2018-10-29)
0.10.3 (2018-10-29)
- [capability] Get available planning group names from MoveGroup C++ (#1159)
- Contributors: Dave Coleman
0.10.2 (2018-10-24)
- [capability] Added plan_only flags to pick and place (#862)
- [maintenance] Python3 support (#1103, #1054)
- [fix] optional namespace args (#929)
- Contributors: David Watkins, Michael Görner, Mohmmad Ayman, Robert Haschke, mike lautman
0.10.1 (2018-05-25)
- [maintenance] Remove deprecated ExecuteTrajectoryServiceCapability (#833)
- [maintenance] migration from tf to tf2 API (#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)
0.9.10 (2017-12-09)
- [fix] MoveGroupInterface: Fixed computeCartesianPath to use selected end-effector. (#580)
- [capability][kinetic onward] Adapt pick pipeline to function without object (#599)
- [improve] Disabled copy constructors and added a move constructor to MoveGroupInterface (#664)
- Contributors: 2scholz, Dennis Hartmann, Jonathan Meyer, Simon Schmeisser
0.9.9 (2017-08-06)
0.9.8 (2017-06-21)
0.9.7 (2017-06-05)
0.9.6 (2017-04-12)
- [improve] MoveGroupInterface: add public interface to construct the MotionPlanRequest (#461)
- Contributors: Michael Goerner
0.9.5 (2017-03-08)
- [fix][moveit_ros_warehouse] gcc6 build error #423
- [enhancement] Remove "catch (...)" instances, catch std::exception instead of std::runtime_error (#445)
- [enhancement][MoveGroup] Add getLinkNames function (#440)
- Contributors: Bence Magyar, Dave Coleman
0.9.4 (2017-02-06)
- [fix] move_group.cpp: seg fault bug (#426)
- [fix] mgi: show correct include path in doxygen (#419)
- [fix] fix race conditions when updating PlanningScene (#350)
- [fix] issue #373 for Kinetic (#377) (#385)
- [capability] PSI: add apply* functions that use ApplyPlanningScene.srv (#381)
- [maintenance] Fix test file issues (#415, #412)
- [maintenance] clang-format upgraded to 3.8 (#367)
- Contributors: Bastian Gaspers, Dave Coleman, Isaac I.Y. Saito, Jorge Santos Simon, Michael Goerner, Robert Haschke
0.9.3 (2016-11-16)
0.6.6 (2016-06-08)
- replaced cmake_modules dependency with eigen
- [jade] eigen3 adjustment
- merge indigo-devel changes (PR #633 trailing whitespace) into jade-devel
- Removed trailing whitespace from entire repository
- planning_interface::MoveGroup::get/setPlannerParams
- new method MoveGroup::getDefaultPlannerId(const std::string &group)
... to retrieve default planner config from param server
moved corresponding code from rviz plugin to MoveGroup interface
to facilitate re-use
- fixing conflicts, renaming variable
- Merge pull request #589 from MichaelStevens/set_num_planning_attempts
adding set_num_planning_attempts to python interface
- comments addressed
- Added python wrapper for setMaxVelocityScalingFactor
- saves robot name to db from moveit. also robot name accessible through robot interface python wrapper
- adding set_num_planning_attempts to python interface
- Merge pull request #571 from ymollard/indigo-devel
Added python wrapper for MoveGroup.asyncExecute()
- Added python wrapper for MoveGroup.asyncExecute()
- Add retime_trajectory to moveit python wrapper
- add getHandle to move_group_interface
- Updated documentation on move() to inform the user that an asynchronus spinner is required. Commonly new users don't do this and move() blocks permanently
- Contributors: Dave Coleman, Dave Hershberger, Isaac I.Y. Saito, Kei Okada, Michael Stevens, Robert Haschke, Sachin Chitta, Scott, Yoan Mollard, dg, ferherranz
0.6.5 (2015-01-24)
- update maintainers
- Add time factor support for iterative_time_parametrization
- Contributors: Michael Ferguson, kohlbrecher
0.6.4 (2014-12-20)
0.6.3 (2014-12-03)
- include correct boost::*_ptr class for boost 1.57.
- Contributors: v4hn
0.6.2 (2014-10-31)
0.6.1 (2014-10-31)
0.6.0 (2014-10-27)
- Add missing variants of place (PlaceLocation, place anywhere) for python interface
- Python wrapper for getEndEffectorTips()
- Contributors: Dave Coleman, Sachin Chitta, corot
0.5.19 (2014-06-23)
- Add check for planning scene monitor connection, with 5 sec delay
- Contributors: Dave Coleman
0.5.18 (2014-03-23)
0.5.17 (2014-03-22)
- update build system for ROS indigo
- added move_group python interface bindings to move group interface
function:
void setPathConstraints(const moveit_msgs::Constraint &constraint)
in order to be able to set path constraints from python scripts
directly and no need to use the DB.
- Use member NodeHandle in action clients.
Currently services and topics are already using the member NodeHandle instance,
but not the action clients.
This is relevant for two reasons:
- Consistency in the resulting ROS API namespace (everything in the same namespace).
- Consistency in the spinning policy. All services, topics and actions will be spinned
by the same NodeHandle, and whatever custom (or not) spinners and callback queues it
has associated.
- adding error code returns to relevant functions
- Contributors: Adolfo Rodriguez Tsouroukdissian, Emili Boronat, Ioan A Sucan, Sachin Chitta
0.5.16 (2014-02-27)
- adding node handle to options in move_group_interface
- adding get for active joints
- Contributors: Sachin Chitta
0.5.14 (2014-02-06)
0.5.13 (2014-02-06)
- add API for setting the number of motion plans to be evaluated via the MoveGroupInterface
- move_group_interface: improve documentation
- Contributors: Acorn Pooley, Ioan Sucan
0.5.12 (2014-01-03)
0.5.11 (2014-01-03)
- Fixed bug in computeCartesianPathPython.
- Adding collision object interface to planning_scene interface.
- Contributors: Acorn Pooley, Sachin Chitta
0.5.10 (2013-12-08)
0.5.9 (2013-12-03)
- Fixed doxygen function-grouping.
- Added planning feedback to gui, refactored states tab
0.5.8 (2013-10-11)
- add function to start state monitor in move_group_interface::MoveGroup
0.5.7 (2013-10-01)
0.5.5 (2013-09-23)
- add support for setting joint targets from approximate IK
- specifies python version 2.7 for linking (fixes #302)
- use new messages for pick & place
- expand functionality of MoveGroupInterface
- porting to new RobotState API
0.5.4 (2013-08-14)
- make pick more general
- use message serialization for python bindings
- 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
0.5.1 (2013-07-14)
0.5.0 (2013-07-12)
- white space fixes (tabs are now spaces)
0.4.5 (2013-07-03)