-
 

Package Summary

Tags No category tags.
Version 2.11.0
License BSD-3-Clause
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-planning/moveit2.git
VCS Type git
VCS Version main
Last Updated 2024-11-19
Dev Status DEVELOPED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

Components of MoveIt that offer simpler remote (as from another ROS 2 node) interfaces to planning and execution

Additional Links

Maintainers

  • Henning Kayser
  • Tyler Weaver
  • Michael Görner
  • MoveIt Release Team

Authors

  • Ioan Sucan
README
No README found. See repository README.
CHANGELOG

Changelog for package moveit_ros_planning_interface

2.11.0 (2024-09-16)

2.10.0 (2024-06-13)

  • Apply clang-tidy fixes
  • Migrate ros-planning org to moveit (#2847)
    • Rename github.com/ros-planning -> github.com/moveit
    • Rename ros-planning.github.io -> moveit.github.io
    • Rename ros-planning organization in docker and CI workflow files
    • ghcr.io/ros-planning -> ghcr.io/moveit
    • github.repository == 'moveit/*''
  • Add getNodeHandle impl (#2840) Co-authored-by: Sebastian Jahr <<sebastian.jahr@picknik.ai>>
  • Unify log names (#2720) Co-authored-by: Abishalini Sivaraman <<abi.gpuram@gmail.com>>
  • Add parameter api integration test (#2662)
  • CMake format and lint in pre-commit (#2683)
  • Remove unused python content from planning interface directory (#2665)
    • Remove unused python content from planning interface directory
    • Cleanup test cmake
  • Contributors: Robert Haschke, Sebastian Jahr, Tyler Weaver, methylDragon

2.9.0 (2024-01-09)

  • Update ros2_control usage (#2620)
    • Update ros2_control usage
    • Update xacro file
  • Node logging in moveit_core (#2503)
  • Use node logging in moveit_ros (#2482)
  • Add new clang-tidy style rules (#2177)
  • Merge branch 'main' into dependabot/github_actions/SonarSource/sonarcloud-github-c-cpp-2
  • Remove old deprecated functions (#2384)
  • Update clang-format-14 with QualifierAlignment (#2362)
    • Set qualifier order in .clang-format
    • Ran pre-commit to update according to new style guide
  • Merge branch 'main' into dependabot/github_actions/SonarSource/sonarcloud-github-c-cpp-2
  • Contributors: Marq Rasmussen, Rayene Messaoud, Sebastian Jahr, Shobuj Paul, Tyler Weaver

2.8.0 (2023-09-10)

  • Specify controller name in MGI execution (#2257)
    • Specify controller name in MGI execute

    * Finish comment ---------Co-authored-by: Sebastian Jahr <<sebastian.jahr@picknik.ai>>

  • Remove deprecated move_group pick& place functionality + demo (#2239) Co-authored-by: Jafar Uruç <<cafer.abdi@gmail.com>>
  • Contributors: Sebastian Jahr, Stephanie Eng

2.7.4 (2023-05-18)

  • Scale acceleration and velocity of cartesian interpolations (#1968)
  • Contributors: Yadu

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)
  • Merge pull request #1900 from Abishalini/pr-sync-1245f15 Sync with MoveIt1
  • Readd comment and assign error code
  • Merge https://github.com/ros-planning/moveit/commit/1245f151393fe09023efec3e1faead2d26737227
  • Update description of moveit_ros_planning_interface (#2045)
    • Update description of moveit_ros_planning_interface

    * Update moveit_ros/planning_interface/package.xml Co-authored-by: Henning Kayser <<henningkayser@picknik.ai>> ---------Co-authored-by: Henning Kayser <<henningkayser@picknik.ai>>

  • Merge PR #3197: Improve computeCartesianPath()
  • Simplify MGI::computeCartesianPath()
  • Contributors: Abishalini, Abishalini Sivaraman, Robert Haschke, Sebastian Jahr, Shobuj Paul

2.7.1 (2023-03-23)

  • Fix member naming (#1949) * Update clang-tidy rules for readability-identifier-naming 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: AlexWebb, Robert Haschke

2.7.0 (2023-01-29)

  • Merge https://github.com/ros-planning/moveit/commit/9225971216885490e933ece25390c63ca14f8a58
  • converted characters from string format to character format (#1881)
  • 400% speed up to move group interface (#1865)
  • GHA: Build moveit_msgs from source (#1853) * Revert #1739: moveit_msgs no longer needs to be built from source This reverts commit 6e0fce31cfe94ef8c6d5ebccb4d865f0c144b6e1.
    • Remove obsolete include: moveit_msgs/srv/execute_known_trajectory.hpp
    • Cleanup moveit2.repos
  • Cleanup msg includes: Use C++ instead of C header (#1844)
  • Fix BSD license in package.xml (#1796)
    • fix BSD license in package.xml
    • this must also be spdx compliant
  • Minimize use of [this->]{.title-ref} (#1784) It's often unnecessary. MoveIt already avoids this in most cases so this PR better cements that existing pattern.
  • Remove [MOVEIT_LIB_NAME]{.title-ref} (#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>>

  • Test [moveit_commander.set_joint_value_target]{.title-ref} with JointState argument (#3187)
    • Test with JointState argument

    * Check size of name and position fields Co-authored-by: Robert Haschke <<rhaschke@techfak.uni-bielefeld.de>>

  • Contributors: Abhijeet Das Gupta, Abishalini, Chris Thrasher, Christian Henkel, Cory Crean, Filip Sund, Robert Haschke, Sameer Gupta, azalutsky

2.6.0 (2022-11-10)

  • Log error when named joint state target does not exist (#1580)
  • Express Humble/Rolling differences in #if (#1620)
  • Fix deprecated declaration usage (#1598)
    • Fix type
    • Suppress warning
    • Add TODO
  • Merge PR #1553: Improve cmake files
  • Remove callback_executor_.is_spinning()
  • Use standard exported targets: export_${PROJECT_NAME} -> ${PROJECT_NAME}Targets
  • Improve CMake usage (#1550)
  • Remove __has_include statements (#1481)
  • Merge https://github.com/ros-planning/moveit/commit/a63580edd05b01d9480c333645036e5b2b222da9
  • Fix callback execution in MGI (#1305) The initial implementation with the private node allowed for concurrent spinning of the same node, producing runtime exceptions. This change removes the need for a private node by letting MGI manage its own CallbackGroup and Executor thread.
  • Changed 'return false' in plan, move and execute such that MoveItErrorCode is returned (#1266)
  • Add and fix dual arm test (#3119)
    • Add dual arm test

    * Fix and simplify UnionConstraintSampler: update joint transforms Co-authored-by: Cristian Beltran <<cristianbehe@gmail.com>> Co-authored-by: Robert Haschke <<rhaschke@techfak.uni-bielefeld.de>>

  • Contributors: Abishalini Sivaraman, Henning Kayser, Robert Haschke, Rufus Wong, Sebastian Jahr, Tyler Weaver, Vatan Aksoy Tezer, abishalini, cambel, tbastiaens-riwo

2.5.3 (2022-07-28)

2.5.2 (2022-07-18)

2.5.1 (2022-05-31)

2.5.0 (2022-05-26)

2.4.0 (2022-01-20)

  • Fix boost linking errors for Windows (#957)
  • Replace NULL with nullptr (#961)
  • Merge https://github.com/ros-planning/moveit/commit/a0ee2020c4a40d03a48044d71753ed23853a665d
  • 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().
  • MGI: add missing replan/look options to interface (#2892)
    • reordered methods because looking requires replanning

    - there's no sense in wrapping methods in methods. just use pimpl-friend paradigm instead. Someone could rework all the other methods in the future.

  • PSI: get object.pose from new msg field (#2877)
  • Contributors: Abishalini, Akash, Gauthier Hentz, Michael Görner, Robert Haschke, Stephanie Eng

2.3.2 (2021-12-29)

2.3.1 (2021-12-23)

  • Add codespell to precommit, fix A LOT of spelling mistakes (#934)
  • Consider simulated time (#883)
  • Enforce package.xml format 3 Schema (#779)
  • Update Maintainers of MoveIt package (#697)
  • Find/replace deprecated spawner.py (#737)
  • common_objects: getSharedRobotModelLoader fix deadlock (#734)
  • 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: AndyZe, Dave Coleman, David V. Lu!!, Felix von Drigalski, Gaël Écorchard, Henning Kayser, Jafar Abdi, Kevin Chang, Robert Haschke, pvanlaar

2.3.0 (2021-10-08)

  • Support passing MoveGroup's namespace to MoveGroupInterface (#533)
  • Add getSharedRobotModelLoader to fix race condition when having multiple displays for the same node (#525)
  • Make TF buffer & listener in PSM private (#654)
    • Add private buffer & tf listener to PSM
    • Remove coupled deleter
    • Decouple PSM from CSM
    • Deprecate old constructors
  • getInterfaceDescription: Fix rclcpp API breakage (#686)
  • [main] Migrate to joint_state_broadcaster (#657)
  • 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
  • Create a transform subscribers to enable virtual joints (#310)
  • Fix loading joint_limits.yaml in demo and test launch files (#544)
  • Fixes for Windows (#530)
  • Contributors: Akash, Jafar Abdi, Nisala Kalupahana, Jorge Nicho, Henning Kayser, Vatan Aksoy Tezer, Tyler Weaver, Lior Lustgarten

2.2.1 (2021-07-12)

  • Fix test dependencies (#539)
  • Contributors: Jochen Sprickerhof

2.2.0 (2021-06-30)

  • Enable Rolling and Galactic CI (#494)
  • [sync] with MoveIt's master branch up-to https://github.com/ros-planning/moveit/commit/0d0a6a171b3fbea97a0c4f284e13433ba66a4ea4
    • Allow selecting planning pipeline in MotionSequenceAction (#2657)
    • planning_interface: synchronize async interfaces in test (#2640)
    • Add planning_pipeline_id setting to Python MGI (#2622)
    • fix docstring in MGI API (#2626)
    • Support multiple planning pipelines with MoveGroup via MoveItCpp (#2127)
      • Deprecate namespace moveit::planning_interface in favor of moveit_cpp
    • 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)
  • Contributors: Felix von Drigalski, Henning Kayser, JafarAbdi, Michael Görner, Peter Mitrano, Robert Haschke, Tyler Weaver, Vatan Aksoy Tezer, petkovich

2.1.4 (2021-05-31)

  • Disable flaky test (#482)
  • Delete MoveIt fake_controller_manager (#471)
  • Contributors: AndyZe, Vatan Aksoy Tezer

2.1.3 (2021-05-22)

  • Configure OMPL projection_evaluator in move_group_launch_test_common.py (#470)
  • Contributors: Jafar Abdi

2.1.2 (2021-04-20)

  • Re-enable test_servo_pose_tracking integration test (#423) Co-authored-by: AndyZe <<zelenak@picknik.ai>>
  • Re-enable moveit_ros_warehouse for moveit_ros_planning_interface (#424)
    • Remove warehouse_ros_mongo from moveit_ros_planning_interface test depends
  • Unify PickNik name in copyrights (#419)
  • Contributors: Jafar Abdi, Tyler Weaver, Vatan Aksoy Tezer

2.1.1 (2021-04-12)

  • Update launch files to use ros2 control spawner (#405)
  • Use fake_components::GenericSystem from ros2_control (#361)
  • Solved small issue with a message not being logged due to an early return statement (#368)
  • OMPL constrained planning (#347)
  • Sync main branch with MoveIt 1 from previous head https://github.com/ros-planning/moveit/commit/0247ed0027ca9d7f1a7f066e62c80c9ce5dbbb5e up to https://github.com/ros-planning/moveit/commit/74b3e30db2e8683ac17b339cc124675ae52a5114
  • [fix] MGI server timeout, infinite duration by default (#349) By setting the default server timeout duration to -1, the MoveGroupInterface is ensured to be ready to use after construction.
  • [fix] export cmake library install (#339)
  • Fix scaling factor parameter names (#2452)
  • MTC compatibility fixes (#323)
  • Fix node remapping
  • Make sure planning scene interface have a unique name for the internal node
  • planning_scene_interface: Fix node name being empty
  • Fix repo URLs in package.xml files
  • Contributors: Boston Cleek, FlorisE, Henning Kayser, Jafar Abdi, Shota Aoki, Tyler Weaver

2.1.0 (2020-11-23)

  • [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] Compilation fixes for macOS (#271)
  • [ros2-migration] Port MoveGroupInterface and MotionPlanning display (#272)
  • Contributors: Henning Kayser, Jafar Abdi, Lior Lustgarten, Mark Moll, Yu Yan

2.0.0 (2020-02-17)

  • [fix] Install moveit_cpp as SHARED library
  • [fix] Fix parameter lookup and runtime in MoveItCpp
  • [fix] Fix moveit_ros_visualization (#167)
  • [fix] moveit_ros_planning_interface: Fix libraries export
  • [port] Port moveit_cpp to ROS 2 (#163)
  • [port] Port common_planning_interface_objects to ROS 2 (#159)
  • [port] Port rdf_loader to ROS2 (#104)
  • Contributors: Henning Kayser, Jafar Abdi

1.1.1 (2020-10-13)

1.1.0 (2020-09-04)

1.0.6 (2020-08-19)

  • [maint] Adapt repository for splitted moveit_resources layout (ros-planning:moveit#2199)
  • [maint] Migrate to clang-format-10, Fix warnings
  • [maint] Optimize includes (ros-planning:moveit#2229)
  • [feature] Exposed parameter wait_for_servers and getPlannerId() API in MoveGroup's Python API (ros-planning:moveit#2201)
  • Contributors: Gerard Canal, Markus Vieth, Robert Haschke, Michael Görner

1.0.5 (2020-07-08)

  • [maint] Remove dependency on panda_moveit_config (ros-planning:moveit#2194 <<https://github.com/ros-planning/moveit/issues/2194>>_, ros-planning:moveit#2197)
  • [maint] Adapt linking to eigenpy (ros-planning:moveit#2118)
  • [maint] Replace robot_model and robot_state namespaces with moveit::core (ros-planning:moveit#2135)
  • [feature] PlanningComponent: Load plan_request_params (ros-planning:moveit#2033)
  • [feature] MoveItCpp: a high-level C++ planning API (ros-planning:moveit#1656)
  • [fix] Validate action client pointer before access
  • [fix] Wait and check for the grasp service
  • [maint] Add tests for move_group interface (ros-planning:moveit#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 (ros-planning:moveit#1955)
  • [feature] Allow to instantiate a [PlanningSceneInterface]{.title-ref} w/ and w/o a running [move_group]{.title-ref} node
  • [fix] Release Python [GIL]{.title-ref} for C++ calls (ros-planning:moveit#1947)
  • [feature] Expose reference_point_position parameter in getJacobian() (ros-planning:moveit#1595)
  • [feature] `MoveGroupInterface`: Expose [constructPickGoal]{.title-ref} and [constructPlaceGoal]{.title-ref} (ros-planning:moveit#1498)
  • [feature] `python MoveGroupInterface`: Added custom time limit for [wait_for_servers()]{.title-ref} (ros-planning:moveit#1444)
  • [maint] Apply clang-tidy fix to entire code base (ros-planning:moveit#1394)
  • [maint] Fix errors: catkin_lint 1.6.7 (ros-planning:moveit#1987)
  • [maint] Improve Python 3 compatibility (ros-planning:moveit#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
  • [maint] Use CMAKE_CXX_STANDARD to enforce c++14 (ros-planning:moveit#1607)
  • [maint] Updated deprecation method: MOVEIT_DEPRECATED -> [[deprecated]] (ros-planning:moveit#1748)
  • [maint] `eigenpy`: switched to system package (ros-planning:moveit#1737)
  • [featue] `PlanningSceneInterface`: wait for its two services
  • [feature] Select time parametrization algorithm in retime_trajectory (ros-planning:moveit#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 (ros-planning:moveit#1410)
  • Contributors: Mahmoud Ahmed Selim

1.0.1 (2019-03-08)

  • [improve] Apply clang tidy fix to entire code base (Part 1) (ros-planning:moveit#1366)
  • Contributors: Robert Haschke, Yu, Yan

1.0.0 (2019-02-24)

  • [fix] catkin_lint issues (ros-planning:moveit#1341)
  • [improve] Remove (redundant) random seeding and ros-planning:moveit#attempts from RobotState::setFromIK() as the IK solver perform random seeding themselves. ros-planning:moveit#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 (ros-planning:moveit#1261)
  • Contributors: Robert Haschke

0.10.6 (2018-12-09)

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++ (ros-planning:moveit#1159)
  • Contributors: Dave Coleman

0.10.2 (2018-10-24)

0.10.1 (2018-05-25)

0.9.11 (2017-12-25)

0.9.10 (2017-12-09)

  • [fix] MoveGroupInterface: Fixed computeCartesianPath to use selected end-effector. (ros-planning:moveit#580)
  • [capability][kinetic onward] Adapt pick pipeline to function without object (ros-planning:moveit#599)
  • [improve] Disabled copy constructors and added a move constructor to MoveGroupInterface (ros-planning:moveit#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 (ros-planning:moveit#461)
  • Contributors: Michael Goerner

0.9.5 (2017-03-08)

0.9.4 (2017-02-06)

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 ros-planning:moveit-ros#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 ros-planning:moveit-ros#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 ros-planning:moveit-ros#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.6 (2013-09-26)

  • update planning options

0.5.5 (2013-09-23)

  • add support for setting joint targets from approximate IK
  • specifies python version 2.7 for linking (fixes ros-planning:moveit-ros#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 ros-planning:moveit-ros#280
  • make headers and author definitions aligned the same way; white space fixes

0.5.2 (2013-07-15)

  • move msgs to common_msgs

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)

0.4.4 (2013-06-26)

  • some refactoring

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged moveit_ros_planning_interface at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 2.11.0
License BSD-3-Clause
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-planning/moveit2.git
VCS Type git
VCS Version main
Last Updated 2024-11-19
Dev Status DEVELOPED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

Components of MoveIt that offer simpler remote (as from another ROS 2 node) interfaces to planning and execution

Additional Links

Maintainers

  • Henning Kayser
  • Tyler Weaver
  • Michael Görner
  • MoveIt Release Team

Authors

  • Ioan Sucan
README
No README found. See repository README.
CHANGELOG

Changelog for package moveit_ros_planning_interface

2.11.0 (2024-09-16)

2.10.0 (2024-06-13)

  • Apply clang-tidy fixes
  • Migrate ros-planning org to moveit (#2847)
    • Rename github.com/ros-planning -> github.com/moveit
    • Rename ros-planning.github.io -> moveit.github.io
    • Rename ros-planning organization in docker and CI workflow files
    • ghcr.io/ros-planning -> ghcr.io/moveit
    • github.repository == 'moveit/*''
  • Add getNodeHandle impl (#2840) Co-authored-by: Sebastian Jahr <<sebastian.jahr@picknik.ai>>
  • Unify log names (#2720) Co-authored-by: Abishalini Sivaraman <<abi.gpuram@gmail.com>>
  • Add parameter api integration test (#2662)
  • CMake format and lint in pre-commit (#2683)
  • Remove unused python content from planning interface directory (#2665)
    • Remove unused python content from planning interface directory
    • Cleanup test cmake
  • Contributors: Robert Haschke, Sebastian Jahr, Tyler Weaver, methylDragon

2.9.0 (2024-01-09)

  • Update ros2_control usage (#2620)
    • Update ros2_control usage
    • Update xacro file
  • Node logging in moveit_core (#2503)
  • Use node logging in moveit_ros (#2482)
  • Add new clang-tidy style rules (#2177)
  • Merge branch 'main' into dependabot/github_actions/SonarSource/sonarcloud-github-c-cpp-2
  • Remove old deprecated functions (#2384)
  • Update clang-format-14 with QualifierAlignment (#2362)
    • Set qualifier order in .clang-format
    • Ran pre-commit to update according to new style guide
  • Merge branch 'main' into dependabot/github_actions/SonarSource/sonarcloud-github-c-cpp-2
  • Contributors: Marq Rasmussen, Rayene Messaoud, Sebastian Jahr, Shobuj Paul, Tyler Weaver

2.8.0 (2023-09-10)

  • Specify controller name in MGI execution (#2257)
    • Specify controller name in MGI execute

    * Finish comment ---------Co-authored-by: Sebastian Jahr <<sebastian.jahr@picknik.ai>>

  • Remove deprecated move_group pick& place functionality + demo (#2239) Co-authored-by: Jafar Uruç <<cafer.abdi@gmail.com>>
  • Contributors: Sebastian Jahr, Stephanie Eng

2.7.4 (2023-05-18)

  • Scale acceleration and velocity of cartesian interpolations (#1968)
  • Contributors: Yadu

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)
  • Merge pull request #1900 from Abishalini/pr-sync-1245f15 Sync with MoveIt1
  • Readd comment and assign error code
  • Merge https://github.com/ros-planning/moveit/commit/1245f151393fe09023efec3e1faead2d26737227
  • Update description of moveit_ros_planning_interface (#2045)
    • Update description of moveit_ros_planning_interface

    * Update moveit_ros/planning_interface/package.xml Co-authored-by: Henning Kayser <<henningkayser@picknik.ai>> ---------Co-authored-by: Henning Kayser <<henningkayser@picknik.ai>>

  • Merge PR #3197: Improve computeCartesianPath()
  • Simplify MGI::computeCartesianPath()
  • Contributors: Abishalini, Abishalini Sivaraman, Robert Haschke, Sebastian Jahr, Shobuj Paul

2.7.1 (2023-03-23)

  • Fix member naming (#1949) * Update clang-tidy rules for readability-identifier-naming 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: AlexWebb, Robert Haschke

2.7.0 (2023-01-29)

  • Merge https://github.com/ros-planning/moveit/commit/9225971216885490e933ece25390c63ca14f8a58
  • converted characters from string format to character format (#1881)
  • 400% speed up to move group interface (#1865)
  • GHA: Build moveit_msgs from source (#1853) * Revert #1739: moveit_msgs no longer needs to be built from source This reverts commit 6e0fce31cfe94ef8c6d5ebccb4d865f0c144b6e1.
    • Remove obsolete include: moveit_msgs/srv/execute_known_trajectory.hpp
    • Cleanup moveit2.repos
  • Cleanup msg includes: Use C++ instead of C header (#1844)
  • Fix BSD license in package.xml (#1796)
    • fix BSD license in package.xml
    • this must also be spdx compliant
  • Minimize use of [this->]{.title-ref} (#1784) It's often unnecessary. MoveIt already avoids this in most cases so this PR better cements that existing pattern.
  • Remove [MOVEIT_LIB_NAME]{.title-ref} (#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>>

  • Test [moveit_commander.set_joint_value_target]{.title-ref} with JointState argument (#3187)
    • Test with JointState argument

    * Check size of name and position fields Co-authored-by: Robert Haschke <<rhaschke@techfak.uni-bielefeld.de>>

  • Contributors: Abhijeet Das Gupta, Abishalini, Chris Thrasher, Christian Henkel, Cory Crean, Filip Sund, Robert Haschke, Sameer Gupta, azalutsky

2.6.0 (2022-11-10)

  • Log error when named joint state target does not exist (#1580)
  • Express Humble/Rolling differences in #if (#1620)
  • Fix deprecated declaration usage (#1598)
    • Fix type
    • Suppress warning
    • Add TODO
  • Merge PR #1553: Improve cmake files
  • Remove callback_executor_.is_spinning()
  • Use standard exported targets: export_${PROJECT_NAME} -> ${PROJECT_NAME}Targets
  • Improve CMake usage (#1550)
  • Remove __has_include statements (#1481)
  • Merge https://github.com/ros-planning/moveit/commit/a63580edd05b01d9480c333645036e5b2b222da9
  • Fix callback execution in MGI (#1305) The initial implementation with the private node allowed for concurrent spinning of the same node, producing runtime exceptions. This change removes the need for a private node by letting MGI manage its own CallbackGroup and Executor thread.
  • Changed 'return false' in plan, move and execute such that MoveItErrorCode is returned (#1266)
  • Add and fix dual arm test (#3119)
    • Add dual arm test

    * Fix and simplify UnionConstraintSampler: update joint transforms Co-authored-by: Cristian Beltran <<cristianbehe@gmail.com>> Co-authored-by: Robert Haschke <<rhaschke@techfak.uni-bielefeld.de>>

  • Contributors: Abishalini Sivaraman, Henning Kayser, Robert Haschke, Rufus Wong, Sebastian Jahr, Tyler Weaver, Vatan Aksoy Tezer, abishalini, cambel, tbastiaens-riwo

2.5.3 (2022-07-28)

2.5.2 (2022-07-18)

2.5.1 (2022-05-31)

2.5.0 (2022-05-26)

2.4.0 (2022-01-20)

  • Fix boost linking errors for Windows (#957)
  • Replace NULL with nullptr (#961)
  • Merge https://github.com/ros-planning/moveit/commit/a0ee2020c4a40d03a48044d71753ed23853a665d
  • 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().
  • MGI: add missing replan/look options to interface (#2892)
    • reordered methods because looking requires replanning

    - there's no sense in wrapping methods in methods. just use pimpl-friend paradigm instead. Someone could rework all the other methods in the future.

  • PSI: get object.pose from new msg field (#2877)
  • Contributors: Abishalini, Akash, Gauthier Hentz, Michael Görner, Robert Haschke, Stephanie Eng

2.3.2 (2021-12-29)

2.3.1 (2021-12-23)

  • Add codespell to precommit, fix A LOT of spelling mistakes (#934)
  • Consider simulated time (#883)
  • Enforce package.xml format 3 Schema (#779)
  • Update Maintainers of MoveIt package (#697)
  • Find/replace deprecated spawner.py (#737)
  • common_objects: getSharedRobotModelLoader fix deadlock (#734)
  • 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: AndyZe, Dave Coleman, David V. Lu!!, Felix von Drigalski, Gaël Écorchard, Henning Kayser, Jafar Abdi, Kevin Chang, Robert Haschke, pvanlaar

2.3.0 (2021-10-08)

  • Support passing MoveGroup's namespace to MoveGroupInterface (#533)
  • Add getSharedRobotModelLoader to fix race condition when having multiple displays for the same node (#525)
  • Make TF buffer & listener in PSM private (#654)
    • Add private buffer & tf listener to PSM
    • Remove coupled deleter
    • Decouple PSM from CSM
    • Deprecate old constructors
  • getInterfaceDescription: Fix rclcpp API breakage (#686)
  • [main] Migrate to joint_state_broadcaster (#657)
  • 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
  • Create a transform subscribers to enable virtual joints (#310)
  • Fix loading joint_limits.yaml in demo and test launch files (#544)
  • Fixes for Windows (#530)
  • Contributors: Akash, Jafar Abdi, Nisala Kalupahana, Jorge Nicho, Henning Kayser, Vatan Aksoy Tezer, Tyler Weaver, Lior Lustgarten

2.2.1 (2021-07-12)

  • Fix test dependencies (#539)
  • Contributors: Jochen Sprickerhof

2.2.0 (2021-06-30)

  • Enable Rolling and Galactic CI (#494)
  • [sync] with MoveIt's master branch up-to https://github.com/ros-planning/moveit/commit/0d0a6a171b3fbea97a0c4f284e13433ba66a4ea4
    • Allow selecting planning pipeline in MotionSequenceAction (#2657)
    • planning_interface: synchronize async interfaces in test (#2640)
    • Add planning_pipeline_id setting to Python MGI (#2622)
    • fix docstring in MGI API (#2626)
    • Support multiple planning pipelines with MoveGroup via MoveItCpp (#2127)
      • Deprecate namespace moveit::planning_interface in favor of moveit_cpp
    • 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)
  • Contributors: Felix von Drigalski, Henning Kayser, JafarAbdi, Michael Görner, Peter Mitrano, Robert Haschke, Tyler Weaver, Vatan Aksoy Tezer, petkovich

2.1.4 (2021-05-31)

  • Disable flaky test (#482)
  • Delete MoveIt fake_controller_manager (#471)
  • Contributors: AndyZe, Vatan Aksoy Tezer

2.1.3 (2021-05-22)

  • Configure OMPL projection_evaluator in move_group_launch_test_common.py (#470)
  • Contributors: Jafar Abdi

2.1.2 (2021-04-20)

  • Re-enable test_servo_pose_tracking integration test (#423) Co-authored-by: AndyZe <<zelenak@picknik.ai>>
  • Re-enable moveit_ros_warehouse for moveit_ros_planning_interface (#424)
    • Remove warehouse_ros_mongo from moveit_ros_planning_interface test depends
  • Unify PickNik name in copyrights (#419)
  • Contributors: Jafar Abdi, Tyler Weaver, Vatan Aksoy Tezer

2.1.1 (2021-04-12)

  • Update launch files to use ros2 control spawner (#405)
  • Use fake_components::GenericSystem from ros2_control (#361)
  • Solved small issue with a message not being logged due to an early return statement (#368)
  • OMPL constrained planning (#347)
  • Sync main branch with MoveIt 1 from previous head https://github.com/ros-planning/moveit/commit/0247ed0027ca9d7f1a7f066e62c80c9ce5dbbb5e up to https://github.com/ros-planning/moveit/commit/74b3e30db2e8683ac17b339cc124675ae52a5114
  • [fix] MGI server timeout, infinite duration by default (#349) By setting the default server timeout duration to -1, the MoveGroupInterface is ensured to be ready to use after construction.
  • [fix] export cmake library install (#339)
  • Fix scaling factor parameter names (#2452)
  • MTC compatibility fixes (#323)
  • Fix node remapping
  • Make sure planning scene interface have a unique name for the internal node
  • planning_scene_interface: Fix node name being empty
  • Fix repo URLs in package.xml files
  • Contributors: Boston Cleek, FlorisE, Henning Kayser, Jafar Abdi, Shota Aoki, Tyler Weaver

2.1.0 (2020-11-23)

  • [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] Compilation fixes for macOS (#271)
  • [ros2-migration] Port MoveGroupInterface and MotionPlanning display (#272)
  • Contributors: Henning Kayser, Jafar Abdi, Lior Lustgarten, Mark Moll, Yu Yan

2.0.0 (2020-02-17)

  • [fix] Install moveit_cpp as SHARED library
  • [fix] Fix parameter lookup and runtime in MoveItCpp
  • [fix] Fix moveit_ros_visualization (#167)
  • [fix] moveit_ros_planning_interface: Fix libraries export
  • [port] Port moveit_cpp to ROS 2 (#163)
  • [port] Port common_planning_interface_objects to ROS 2 (#159)
  • [port] Port rdf_loader to ROS2 (#104)
  • Contributors: Henning Kayser, Jafar Abdi

1.1.1 (2020-10-13)

1.1.0 (2020-09-04)

1.0.6 (2020-08-19)

  • [maint] Adapt repository for splitted moveit_resources layout (ros-planning:moveit#2199)
  • [maint] Migrate to clang-format-10, Fix warnings
  • [maint] Optimize includes (ros-planning:moveit#2229)
  • [feature] Exposed parameter wait_for_servers and getPlannerId() API in MoveGroup's Python API (ros-planning:moveit#2201)
  • Contributors: Gerard Canal, Markus Vieth, Robert Haschke, Michael Görner

1.0.5 (2020-07-08)

  • [maint] Remove dependency on panda_moveit_config (ros-planning:moveit#2194 <<https://github.com/ros-planning/moveit/issues/2194>>_, ros-planning:moveit#2197)
  • [maint] Adapt linking to eigenpy (ros-planning:moveit#2118)
  • [maint] Replace robot_model and robot_state namespaces with moveit::core (ros-planning:moveit#2135)
  • [feature] PlanningComponent: Load plan_request_params (ros-planning:moveit#2033)
  • [feature] MoveItCpp: a high-level C++ planning API (ros-planning:moveit#1656)
  • [fix] Validate action client pointer before access
  • [fix] Wait and check for the grasp service
  • [maint] Add tests for move_group interface (ros-planning:moveit#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 (ros-planning:moveit#1955)
  • [feature] Allow to instantiate a [PlanningSceneInterface]{.title-ref} w/ and w/o a running [move_group]{.title-ref} node
  • [fix] Release Python [GIL]{.title-ref} for C++ calls (ros-planning:moveit#1947)
  • [feature] Expose reference_point_position parameter in getJacobian() (ros-planning:moveit#1595)
  • [feature] `MoveGroupInterface`: Expose [constructPickGoal]{.title-ref} and [constructPlaceGoal]{.title-ref} (ros-planning:moveit#1498)
  • [feature] `python MoveGroupInterface`: Added custom time limit for [wait_for_servers()]{.title-ref} (ros-planning:moveit#1444)
  • [maint] Apply clang-tidy fix to entire code base (ros-planning:moveit#1394)
  • [maint] Fix errors: catkin_lint 1.6.7 (ros-planning:moveit#1987)
  • [maint] Improve Python 3 compatibility (ros-planning:moveit#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
  • [maint] Use CMAKE_CXX_STANDARD to enforce c++14 (ros-planning:moveit#1607)
  • [maint] Updated deprecation method: MOVEIT_DEPRECATED -> [[deprecated]] (ros-planning:moveit#1748)
  • [maint] `eigenpy`: switched to system package (ros-planning:moveit#1737)
  • [featue] `PlanningSceneInterface`: wait for its two services
  • [feature] Select time parametrization algorithm in retime_trajectory (ros-planning:moveit#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 (ros-planning:moveit#1410)
  • Contributors: Mahmoud Ahmed Selim

1.0.1 (2019-03-08)

  • [improve] Apply clang tidy fix to entire code base (Part 1) (ros-planning:moveit#1366)
  • Contributors: Robert Haschke, Yu, Yan

1.0.0 (2019-02-24)

  • [fix] catkin_lint issues (ros-planning:moveit#1341)
  • [improve] Remove (redundant) random seeding and ros-planning:moveit#attempts from RobotState::setFromIK() as the IK solver perform random seeding themselves. ros-planning:moveit#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 (ros-planning:moveit#1261)
  • Contributors: Robert Haschke

0.10.6 (2018-12-09)

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++ (ros-planning:moveit#1159)
  • Contributors: Dave Coleman

0.10.2 (2018-10-24)

0.10.1 (2018-05-25)

0.9.11 (2017-12-25)

0.9.10 (2017-12-09)

  • [fix] MoveGroupInterface: Fixed computeCartesianPath to use selected end-effector. (ros-planning:moveit#580)
  • [capability][kinetic onward] Adapt pick pipeline to function without object (ros-planning:moveit#599)
  • [improve] Disabled copy constructors and added a move constructor to MoveGroupInterface (ros-planning:moveit#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 (ros-planning:moveit#461)
  • Contributors: Michael Goerner

0.9.5 (2017-03-08)

0.9.4 (2017-02-06)

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 ros-planning:moveit-ros#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 ros-planning:moveit-ros#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 ros-planning:moveit-ros#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.6 (2013-09-26)

  • update planning options

0.5.5 (2013-09-23)

  • add support for setting joint targets from approximate IK
  • specifies python version 2.7 for linking (fixes ros-planning:moveit-ros#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 ros-planning:moveit-ros#280
  • make headers and author definitions aligned the same way; white space fixes

0.5.2 (2013-07-15)

  • move msgs to common_msgs

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)

0.4.4 (2013-06-26)

  • some refactoring

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged moveit_ros_planning_interface at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 2.11.0
License BSD-3-Clause
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-planning/moveit2.git
VCS Type git
VCS Version main
Last Updated 2024-11-19
Dev Status DEVELOPED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

Components of MoveIt that offer simpler remote (as from another ROS 2 node) interfaces to planning and execution

Additional Links

Maintainers

  • Henning Kayser
  • Tyler Weaver
  • Michael Görner
  • MoveIt Release Team

Authors

  • Ioan Sucan
README
No README found. See repository README.
CHANGELOG

Changelog for package moveit_ros_planning_interface

2.11.0 (2024-09-16)

2.10.0 (2024-06-13)

  • Apply clang-tidy fixes
  • Migrate ros-planning org to moveit (#2847)
    • Rename github.com/ros-planning -> github.com/moveit
    • Rename ros-planning.github.io -> moveit.github.io
    • Rename ros-planning organization in docker and CI workflow files
    • ghcr.io/ros-planning -> ghcr.io/moveit
    • github.repository == 'moveit/*''
  • Add getNodeHandle impl (#2840) Co-authored-by: Sebastian Jahr <<sebastian.jahr@picknik.ai>>
  • Unify log names (#2720) Co-authored-by: Abishalini Sivaraman <<abi.gpuram@gmail.com>>
  • Add parameter api integration test (#2662)
  • CMake format and lint in pre-commit (#2683)
  • Remove unused python content from planning interface directory (#2665)
    • Remove unused python content from planning interface directory
    • Cleanup test cmake
  • Contributors: Robert Haschke, Sebastian Jahr, Tyler Weaver, methylDragon

2.9.0 (2024-01-09)

  • Update ros2_control usage (#2620)
    • Update ros2_control usage
    • Update xacro file
  • Node logging in moveit_core (#2503)
  • Use node logging in moveit_ros (#2482)
  • Add new clang-tidy style rules (#2177)
  • Merge branch 'main' into dependabot/github_actions/SonarSource/sonarcloud-github-c-cpp-2
  • Remove old deprecated functions (#2384)
  • Update clang-format-14 with QualifierAlignment (#2362)
    • Set qualifier order in .clang-format
    • Ran pre-commit to update according to new style guide
  • Merge branch 'main' into dependabot/github_actions/SonarSource/sonarcloud-github-c-cpp-2
  • Contributors: Marq Rasmussen, Rayene Messaoud, Sebastian Jahr, Shobuj Paul, Tyler Weaver

2.8.0 (2023-09-10)

  • Specify controller name in MGI execution (#2257)
    • Specify controller name in MGI execute

    * Finish comment ---------Co-authored-by: Sebastian Jahr <<sebastian.jahr@picknik.ai>>

  • Remove deprecated move_group pick& place functionality + demo (#2239) Co-authored-by: Jafar Uruç <<cafer.abdi@gmail.com>>
  • Contributors: Sebastian Jahr, Stephanie Eng

2.7.4 (2023-05-18)

  • Scale acceleration and velocity of cartesian interpolations (#1968)
  • Contributors: Yadu

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)
  • Merge pull request #1900 from Abishalini/pr-sync-1245f15 Sync with MoveIt1
  • Readd comment and assign error code
  • Merge https://github.com/ros-planning/moveit/commit/1245f151393fe09023efec3e1faead2d26737227
  • Update description of moveit_ros_planning_interface (#2045)
    • Update description of moveit_ros_planning_interface

    * Update moveit_ros/planning_interface/package.xml Co-authored-by: Henning Kayser <<henningkayser@picknik.ai>> ---------Co-authored-by: Henning Kayser <<henningkayser@picknik.ai>>

  • Merge PR #3197: Improve computeCartesianPath()
  • Simplify MGI::computeCartesianPath()
  • Contributors: Abishalini, Abishalini Sivaraman, Robert Haschke, Sebastian Jahr, Shobuj Paul

2.7.1 (2023-03-23)

  • Fix member naming (#1949) * Update clang-tidy rules for readability-identifier-naming 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: AlexWebb, Robert Haschke

2.7.0 (2023-01-29)

  • Merge https://github.com/ros-planning/moveit/commit/9225971216885490e933ece25390c63ca14f8a58
  • converted characters from string format to character format (#1881)
  • 400% speed up to move group interface (#1865)
  • GHA: Build moveit_msgs from source (#1853) * Revert #1739: moveit_msgs no longer needs to be built from source This reverts commit 6e0fce31cfe94ef8c6d5ebccb4d865f0c144b6e1.
    • Remove obsolete include: moveit_msgs/srv/execute_known_trajectory.hpp
    • Cleanup moveit2.repos
  • Cleanup msg includes: Use C++ instead of C header (#1844)
  • Fix BSD license in package.xml (#1796)
    • fix BSD license in package.xml
    • this must also be spdx compliant
  • Minimize use of [this->]{.title-ref} (#1784) It's often unnecessary. MoveIt already avoids this in most cases so this PR better cements that existing pattern.
  • Remove [MOVEIT_LIB_NAME]{.title-ref} (#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>>

  • Test [moveit_commander.set_joint_value_target]{.title-ref} with JointState argument (#3187)
    • Test with JointState argument

    * Check size of name and position fields Co-authored-by: Robert Haschke <<rhaschke@techfak.uni-bielefeld.de>>

  • Contributors: Abhijeet Das Gupta, Abishalini, Chris Thrasher, Christian Henkel, Cory Crean, Filip Sund, Robert Haschke, Sameer Gupta, azalutsky

2.6.0 (2022-11-10)

  • Log error when named joint state target does not exist (#1580)
  • Express Humble/Rolling differences in #if (#1620)
  • Fix deprecated declaration usage (#1598)
    • Fix type
    • Suppress warning
    • Add TODO
  • Merge PR #1553: Improve cmake files
  • Remove callback_executor_.is_spinning()
  • Use standard exported targets: export_${PROJECT_NAME} -> ${PROJECT_NAME}Targets
  • Improve CMake usage (#1550)
  • Remove __has_include statements (#1481)
  • Merge https://github.com/ros-planning/moveit/commit/a63580edd05b01d9480c333645036e5b2b222da9
  • Fix callback execution in MGI (#1305) The initial implementation with the private node allowed for concurrent spinning of the same node, producing runtime exceptions. This change removes the need for a private node by letting MGI manage its own CallbackGroup and Executor thread.
  • Changed 'return false' in plan, move and execute such that MoveItErrorCode is returned (#1266)
  • Add and fix dual arm test (#3119)
    • Add dual arm test

    * Fix and simplify UnionConstraintSampler: update joint transforms Co-authored-by: Cristian Beltran <<cristianbehe@gmail.com>> Co-authored-by: Robert Haschke <<rhaschke@techfak.uni-bielefeld.de>>

  • Contributors: Abishalini Sivaraman, Henning Kayser, Robert Haschke, Rufus Wong, Sebastian Jahr, Tyler Weaver, Vatan Aksoy Tezer, abishalini, cambel, tbastiaens-riwo

2.5.3 (2022-07-28)

2.5.2 (2022-07-18)

2.5.1 (2022-05-31)

2.5.0 (2022-05-26)

2.4.0 (2022-01-20)

  • Fix boost linking errors for Windows (#957)
  • Replace NULL with nullptr (#961)
  • Merge https://github.com/ros-planning/moveit/commit/a0ee2020c4a40d03a48044d71753ed23853a665d
  • 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().
  • MGI: add missing replan/look options to interface (#2892)
    • reordered methods because looking requires replanning

    - there's no sense in wrapping methods in methods. just use pimpl-friend paradigm instead. Someone could rework all the other methods in the future.

  • PSI: get object.pose from new msg field (#2877)
  • Contributors: Abishalini, Akash, Gauthier Hentz, Michael Görner, Robert Haschke, Stephanie Eng

2.3.2 (2021-12-29)

2.3.1 (2021-12-23)

  • Add codespell to precommit, fix A LOT of spelling mistakes (#934)
  • Consider simulated time (#883)
  • Enforce package.xml format 3 Schema (#779)
  • Update Maintainers of MoveIt package (#697)
  • Find/replace deprecated spawner.py (#737)
  • common_objects: getSharedRobotModelLoader fix deadlock (#734)
  • 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: AndyZe, Dave Coleman, David V. Lu!!, Felix von Drigalski, Gaël Écorchard, Henning Kayser, Jafar Abdi, Kevin Chang, Robert Haschke, pvanlaar

2.3.0 (2021-10-08)

  • Support passing MoveGroup's namespace to MoveGroupInterface (#533)
  • Add getSharedRobotModelLoader to fix race condition when having multiple displays for the same node (#525)
  • Make TF buffer & listener in PSM private (#654)
    • Add private buffer & tf listener to PSM
    • Remove coupled deleter
    • Decouple PSM from CSM
    • Deprecate old constructors
  • getInterfaceDescription: Fix rclcpp API breakage (#686)
  • [main] Migrate to joint_state_broadcaster (#657)
  • 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
  • Create a transform subscribers to enable virtual joints (#310)
  • Fix loading joint_limits.yaml in demo and test launch files (#544)
  • Fixes for Windows (#530)
  • Contributors: Akash, Jafar Abdi, Nisala Kalupahana, Jorge Nicho, Henning Kayser, Vatan Aksoy Tezer, Tyler Weaver, Lior Lustgarten

2.2.1 (2021-07-12)

  • Fix test dependencies (#539)
  • Contributors: Jochen Sprickerhof

2.2.0 (2021-06-30)

  • Enable Rolling and Galactic CI (#494)
  • [sync] with MoveIt's master branch up-to https://github.com/ros-planning/moveit/commit/0d0a6a171b3fbea97a0c4f284e13433ba66a4ea4
    • Allow selecting planning pipeline in MotionSequenceAction (#2657)
    • planning_interface: synchronize async interfaces in test (#2640)
    • Add planning_pipeline_id setting to Python MGI (#2622)
    • fix docstring in MGI API (#2626)
    • Support multiple planning pipelines with MoveGroup via MoveItCpp (#2127)
      • Deprecate namespace moveit::planning_interface in favor of moveit_cpp
    • 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)
  • Contributors: Felix von Drigalski, Henning Kayser, JafarAbdi, Michael Görner, Peter Mitrano, Robert Haschke, Tyler Weaver, Vatan Aksoy Tezer, petkovich

2.1.4 (2021-05-31)

  • Disable flaky test (#482)
  • Delete MoveIt fake_controller_manager (#471)
  • Contributors: AndyZe, Vatan Aksoy Tezer

2.1.3 (2021-05-22)

  • Configure OMPL projection_evaluator in move_group_launch_test_common.py (#470)
  • Contributors: Jafar Abdi

2.1.2 (2021-04-20)

  • Re-enable test_servo_pose_tracking integration test (#423) Co-authored-by: AndyZe <<zelenak@picknik.ai>>
  • Re-enable moveit_ros_warehouse for moveit_ros_planning_interface (#424)
    • Remove warehouse_ros_mongo from moveit_ros_planning_interface test depends
  • Unify PickNik name in copyrights (#419)
  • Contributors: Jafar Abdi, Tyler Weaver, Vatan Aksoy Tezer

2.1.1 (2021-04-12)

  • Update launch files to use ros2 control spawner (#405)
  • Use fake_components::GenericSystem from ros2_control (#361)
  • Solved small issue with a message not being logged due to an early return statement (#368)
  • OMPL constrained planning (#347)
  • Sync main branch with MoveIt 1 from previous head https://github.com/ros-planning/moveit/commit/0247ed0027ca9d7f1a7f066e62c80c9ce5dbbb5e up to https://github.com/ros-planning/moveit/commit/74b3e30db2e8683ac17b339cc124675ae52a5114
  • [fix] MGI server timeout, infinite duration by default (#349) By setting the default server timeout duration to -1, the MoveGroupInterface is ensured to be ready to use after construction.
  • [fix] export cmake library install (#339)
  • Fix scaling factor parameter names (#2452)
  • MTC compatibility fixes (#323)
  • Fix node remapping
  • Make sure planning scene interface have a unique name for the internal node
  • planning_scene_interface: Fix node name being empty
  • Fix repo URLs in package.xml files
  • Contributors: Boston Cleek, FlorisE, Henning Kayser, Jafar Abdi, Shota Aoki, Tyler Weaver

2.1.0 (2020-11-23)

  • [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] Compilation fixes for macOS (#271)
  • [ros2-migration] Port MoveGroupInterface and MotionPlanning display (#272)
  • Contributors: Henning Kayser, Jafar Abdi, Lior Lustgarten, Mark Moll, Yu Yan

2.0.0 (2020-02-17)

  • [fix] Install moveit_cpp as SHARED library
  • [fix] Fix parameter lookup and runtime in MoveItCpp
  • [fix] Fix moveit_ros_visualization (#167)
  • [fix] moveit_ros_planning_interface: Fix libraries export
  • [port] Port moveit_cpp to ROS 2 (#163)
  • [port] Port common_planning_interface_objects to ROS 2 (#159)
  • [port] Port rdf_loader to ROS2 (#104)
  • Contributors: Henning Kayser, Jafar Abdi

1.1.1 (2020-10-13)

1.1.0 (2020-09-04)

1.0.6 (2020-08-19)

  • [maint] Adapt repository for splitted moveit_resources layout (ros-planning:moveit#2199)
  • [maint] Migrate to clang-format-10, Fix warnings
  • [maint] Optimize includes (ros-planning:moveit#2229)
  • [feature] Exposed parameter wait_for_servers and getPlannerId() API in MoveGroup's Python API (ros-planning:moveit#2201)
  • Contributors: Gerard Canal, Markus Vieth, Robert Haschke, Michael Görner

1.0.5 (2020-07-08)

  • [maint] Remove dependency on panda_moveit_config (ros-planning:moveit#2194 <<https://github.com/ros-planning/moveit/issues/2194>>_, ros-planning:moveit#2197)
  • [maint] Adapt linking to eigenpy (ros-planning:moveit#2118)
  • [maint] Replace robot_model and robot_state namespaces with moveit::core (ros-planning:moveit#2135)
  • [feature] PlanningComponent: Load plan_request_params (ros-planning:moveit#2033)
  • [feature] MoveItCpp: a high-level C++ planning API (ros-planning:moveit#1656)
  • [fix] Validate action client pointer before access
  • [fix] Wait and check for the grasp service
  • [maint] Add tests for move_group interface (ros-planning:moveit#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 (ros-planning:moveit#1955)
  • [feature] Allow to instantiate a [PlanningSceneInterface]{.title-ref} w/ and w/o a running [move_group]{.title-ref} node
  • [fix] Release Python [GIL]{.title-ref} for C++ calls (ros-planning:moveit#1947)
  • [feature] Expose reference_point_position parameter in getJacobian() (ros-planning:moveit#1595)
  • [feature] `MoveGroupInterface`: Expose [constructPickGoal]{.title-ref} and [constructPlaceGoal]{.title-ref} (ros-planning:moveit#1498)
  • [feature] `python MoveGroupInterface`: Added custom time limit for [wait_for_servers()]{.title-ref} (ros-planning:moveit#1444)
  • [maint] Apply clang-tidy fix to entire code base (ros-planning:moveit#1394)
  • [maint] Fix errors: catkin_lint 1.6.7 (ros-planning:moveit#1987)
  • [maint] Improve Python 3 compatibility (ros-planning:moveit#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
  • [maint] Use CMAKE_CXX_STANDARD to enforce c++14 (ros-planning:moveit#1607)
  • [maint] Updated deprecation method: MOVEIT_DEPRECATED -> [[deprecated]] (ros-planning:moveit#1748)
  • [maint] `eigenpy`: switched to system package (ros-planning:moveit#1737)
  • [featue] `PlanningSceneInterface`: wait for its two services
  • [feature] Select time parametrization algorithm in retime_trajectory (ros-planning:moveit#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 (ros-planning:moveit#1410)
  • Contributors: Mahmoud Ahmed Selim

1.0.1 (2019-03-08)

  • [improve] Apply clang tidy fix to entire code base (Part 1) (ros-planning:moveit#1366)
  • Contributors: Robert Haschke, Yu, Yan

1.0.0 (2019-02-24)

  • [fix] catkin_lint issues (ros-planning:moveit#1341)
  • [improve] Remove (redundant) random seeding and ros-planning:moveit#attempts from RobotState::setFromIK() as the IK solver perform random seeding themselves. ros-planning:moveit#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 (ros-planning:moveit#1261)
  • Contributors: Robert Haschke

0.10.6 (2018-12-09)

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++ (ros-planning:moveit#1159)
  • Contributors: Dave Coleman

0.10.2 (2018-10-24)

0.10.1 (2018-05-25)

0.9.11 (2017-12-25)

0.9.10 (2017-12-09)

  • [fix] MoveGroupInterface: Fixed computeCartesianPath to use selected end-effector. (ros-planning:moveit#580)
  • [capability][kinetic onward] Adapt pick pipeline to function without object (ros-planning:moveit#599)
  • [improve] Disabled copy constructors and added a move constructor to MoveGroupInterface (ros-planning:moveit#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 (ros-planning:moveit#461)
  • Contributors: Michael Goerner

0.9.5 (2017-03-08)

0.9.4 (2017-02-06)

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 ros-planning:moveit-ros#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 ros-planning:moveit-ros#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 ros-planning:moveit-ros#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.6 (2013-09-26)

  • update planning options

0.5.5 (2013-09-23)

  • add support for setting joint targets from approximate IK
  • specifies python version 2.7 for linking (fixes ros-planning:moveit-ros#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 ros-planning:moveit-ros#280
  • make headers and author definitions aligned the same way; white space fixes

0.5.2 (2013-07-15)

  • move msgs to common_msgs

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)

0.4.4 (2013-06-26)

  • some refactoring

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged moveit_ros_planning_interface at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 2.11.0
License BSD-3-Clause
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-planning/moveit2.git
VCS Type git
VCS Version main
Last Updated 2024-11-19
Dev Status DEVELOPED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

Components of MoveIt that offer simpler remote (as from another ROS 2 node) interfaces to planning and execution

Additional Links

Maintainers

  • Henning Kayser
  • Tyler Weaver
  • Michael Görner
  • MoveIt Release Team

Authors

  • Ioan Sucan
README
No README found. See repository README.
CHANGELOG

Changelog for package moveit_ros_planning_interface

2.11.0 (2024-09-16)

2.10.0 (2024-06-13)

  • Apply clang-tidy fixes
  • Migrate ros-planning org to moveit (#2847)
    • Rename github.com/ros-planning -> github.com/moveit
    • Rename ros-planning.github.io -> moveit.github.io
    • Rename ros-planning organization in docker and CI workflow files
    • ghcr.io/ros-planning -> ghcr.io/moveit
    • github.repository == 'moveit/*''
  • Add getNodeHandle impl (#2840) Co-authored-by: Sebastian Jahr <<sebastian.jahr@picknik.ai>>
  • Unify log names (#2720) Co-authored-by: Abishalini Sivaraman <<abi.gpuram@gmail.com>>
  • Add parameter api integration test (#2662)
  • CMake format and lint in pre-commit (#2683)
  • Remove unused python content from planning interface directory (#2665)
    • Remove unused python content from planning interface directory
    • Cleanup test cmake
  • Contributors: Robert Haschke, Sebastian Jahr, Tyler Weaver, methylDragon

2.9.0 (2024-01-09)

  • Update ros2_control usage (#2620)
    • Update ros2_control usage
    • Update xacro file
  • Node logging in moveit_core (#2503)
  • Use node logging in moveit_ros (#2482)
  • Add new clang-tidy style rules (#2177)
  • Merge branch 'main' into dependabot/github_actions/SonarSource/sonarcloud-github-c-cpp-2
  • Remove old deprecated functions (#2384)
  • Update clang-format-14 with QualifierAlignment (#2362)
    • Set qualifier order in .clang-format
    • Ran pre-commit to update according to new style guide
  • Merge branch 'main' into dependabot/github_actions/SonarSource/sonarcloud-github-c-cpp-2
  • Contributors: Marq Rasmussen, Rayene Messaoud, Sebastian Jahr, Shobuj Paul, Tyler Weaver

2.8.0 (2023-09-10)

  • Specify controller name in MGI execution (#2257)
    • Specify controller name in MGI execute

    * Finish comment ---------Co-authored-by: Sebastian Jahr <<sebastian.jahr@picknik.ai>>

  • Remove deprecated move_group pick& place functionality + demo (#2239) Co-authored-by: Jafar Uruç <<cafer.abdi@gmail.com>>
  • Contributors: Sebastian Jahr, Stephanie Eng

2.7.4 (2023-05-18)

  • Scale acceleration and velocity of cartesian interpolations (#1968)
  • Contributors: Yadu

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)
  • Merge pull request #1900 from Abishalini/pr-sync-1245f15 Sync with MoveIt1
  • Readd comment and assign error code
  • Merge https://github.com/ros-planning/moveit/commit/1245f151393fe09023efec3e1faead2d26737227
  • Update description of moveit_ros_planning_interface (#2045)
    • Update description of moveit_ros_planning_interface

    * Update moveit_ros/planning_interface/package.xml Co-authored-by: Henning Kayser <<henningkayser@picknik.ai>> ---------Co-authored-by: Henning Kayser <<henningkayser@picknik.ai>>

  • Merge PR #3197: Improve computeCartesianPath()
  • Simplify MGI::computeCartesianPath()
  • Contributors: Abishalini, Abishalini Sivaraman, Robert Haschke, Sebastian Jahr, Shobuj Paul

2.7.1 (2023-03-23)

  • Fix member naming (#1949) * Update clang-tidy rules for readability-identifier-naming 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: AlexWebb, Robert Haschke

2.7.0 (2023-01-29)

  • Merge https://github.com/ros-planning/moveit/commit/9225971216885490e933ece25390c63ca14f8a58
  • converted characters from string format to character format (#1881)
  • 400% speed up to move group interface (#1865)
  • GHA: Build moveit_msgs from source (#1853) * Revert #1739: moveit_msgs no longer needs to be built from source This reverts commit 6e0fce31cfe94ef8c6d5ebccb4d865f0c144b6e1.
    • Remove obsolete include: moveit_msgs/srv/execute_known_trajectory.hpp
    • Cleanup moveit2.repos
  • Cleanup msg includes: Use C++ instead of C header (#1844)
  • Fix BSD license in package.xml (#1796)
    • fix BSD license in package.xml
    • this must also be spdx compliant
  • Minimize use of [this->]{.title-ref} (#1784) It's often unnecessary. MoveIt already avoids this in most cases so this PR better cements that existing pattern.
  • Remove [MOVEIT_LIB_NAME]{.title-ref} (#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>>

  • Test [moveit_commander.set_joint_value_target]{.title-ref} with JointState argument (#3187)
    • Test with JointState argument

    * Check size of name and position fields Co-authored-by: Robert Haschke <<rhaschke@techfak.uni-bielefeld.de>>

  • Contributors: Abhijeet Das Gupta, Abishalini, Chris Thrasher, Christian Henkel, Cory Crean, Filip Sund, Robert Haschke, Sameer Gupta, azalutsky

2.6.0 (2022-11-10)

  • Log error when named joint state target does not exist (#1580)
  • Express Humble/Rolling differences in #if (#1620)
  • Fix deprecated declaration usage (#1598)
    • Fix type
    • Suppress warning
    • Add TODO
  • Merge PR #1553: Improve cmake files
  • Remove callback_executor_.is_spinning()
  • Use standard exported targets: export_${PROJECT_NAME} -> ${PROJECT_NAME}Targets
  • Improve CMake usage (#1550)
  • Remove __has_include statements (#1481)
  • Merge https://github.com/ros-planning/moveit/commit/a63580edd05b01d9480c333645036e5b2b222da9
  • Fix callback execution in MGI (#1305) The initial implementation with the private node allowed for concurrent spinning of the same node, producing runtime exceptions. This change removes the need for a private node by letting MGI manage its own CallbackGroup and Executor thread.
  • Changed 'return false' in plan, move and execute such that MoveItErrorCode is returned (#1266)
  • Add and fix dual arm test (#3119)
    • Add dual arm test

    * Fix and simplify UnionConstraintSampler: update joint transforms Co-authored-by: Cristian Beltran <<cristianbehe@gmail.com>> Co-authored-by: Robert Haschke <<rhaschke@techfak.uni-bielefeld.de>>

  • Contributors: Abishalini Sivaraman, Henning Kayser, Robert Haschke, Rufus Wong, Sebastian Jahr, Tyler Weaver, Vatan Aksoy Tezer, abishalini, cambel, tbastiaens-riwo

2.5.3 (2022-07-28)

2.5.2 (2022-07-18)

2.5.1 (2022-05-31)

2.5.0 (2022-05-26)

2.4.0 (2022-01-20)

  • Fix boost linking errors for Windows (#957)
  • Replace NULL with nullptr (#961)
  • Merge https://github.com/ros-planning/moveit/commit/a0ee2020c4a40d03a48044d71753ed23853a665d
  • 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().
  • MGI: add missing replan/look options to interface (#2892)
    • reordered methods because looking requires replanning

    - there's no sense in wrapping methods in methods. just use pimpl-friend paradigm instead. Someone could rework all the other methods in the future.

  • PSI: get object.pose from new msg field (#2877)
  • Contributors: Abishalini, Akash, Gauthier Hentz, Michael Görner, Robert Haschke, Stephanie Eng

2.3.2 (2021-12-29)

2.3.1 (2021-12-23)

  • Add codespell to precommit, fix A LOT of spelling mistakes (#934)
  • Consider simulated time (#883)
  • Enforce package.xml format 3 Schema (#779)
  • Update Maintainers of MoveIt package (#697)
  • Find/replace deprecated spawner.py (#737)
  • common_objects: getSharedRobotModelLoader fix deadlock (#734)
  • 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: AndyZe, Dave Coleman, David V. Lu!!, Felix von Drigalski, Gaël Écorchard, Henning Kayser, Jafar Abdi, Kevin Chang, Robert Haschke, pvanlaar

2.3.0 (2021-10-08)

  • Support passing MoveGroup's namespace to MoveGroupInterface (#533)
  • Add getSharedRobotModelLoader to fix race condition when having multiple displays for the same node (#525)
  • Make TF buffer & listener in PSM private (#654)
    • Add private buffer & tf listener to PSM
    • Remove coupled deleter
    • Decouple PSM from CSM
    • Deprecate old constructors
  • getInterfaceDescription: Fix rclcpp API breakage (#686)
  • [main] Migrate to joint_state_broadcaster (#657)
  • 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
  • Create a transform subscribers to enable virtual joints (#310)
  • Fix loading joint_limits.yaml in demo and test launch files (#544)
  • Fixes for Windows (#530)
  • Contributors: Akash, Jafar Abdi, Nisala Kalupahana, Jorge Nicho, Henning Kayser, Vatan Aksoy Tezer, Tyler Weaver, Lior Lustgarten

2.2.1 (2021-07-12)

  • Fix test dependencies (#539)
  • Contributors: Jochen Sprickerhof

2.2.0 (2021-06-30)

  • Enable Rolling and Galactic CI (#494)
  • [sync] with MoveIt's master branch up-to https://github.com/ros-planning/moveit/commit/0d0a6a171b3fbea97a0c4f284e13433ba66a4ea4
    • Allow selecting planning pipeline in MotionSequenceAction (#2657)
    • planning_interface: synchronize async interfaces in test (#2640)
    • Add planning_pipeline_id setting to Python MGI (#2622)
    • fix docstring in MGI API (#2626)
    • Support multiple planning pipelines with MoveGroup via MoveItCpp (#2127)
      • Deprecate namespace moveit::planning_interface in favor of moveit_cpp
    • 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)
  • Contributors: Felix von Drigalski, Henning Kayser, JafarAbdi, Michael Görner, Peter Mitrano, Robert Haschke, Tyler Weaver, Vatan Aksoy Tezer, petkovich

2.1.4 (2021-05-31)

  • Disable flaky test (#482)
  • Delete MoveIt fake_controller_manager (#471)
  • Contributors: AndyZe, Vatan Aksoy Tezer

2.1.3 (2021-05-22)

  • Configure OMPL projection_evaluator in move_group_launch_test_common.py (#470)
  • Contributors: Jafar Abdi

2.1.2 (2021-04-20)

  • Re-enable test_servo_pose_tracking integration test (#423) Co-authored-by: AndyZe <<zelenak@picknik.ai>>
  • Re-enable moveit_ros_warehouse for moveit_ros_planning_interface (#424)
    • Remove warehouse_ros_mongo from moveit_ros_planning_interface test depends
  • Unify PickNik name in copyrights (#419)
  • Contributors: Jafar Abdi, Tyler Weaver, Vatan Aksoy Tezer

2.1.1 (2021-04-12)

  • Update launch files to use ros2 control spawner (#405)
  • Use fake_components::GenericSystem from ros2_control (#361)
  • Solved small issue with a message not being logged due to an early return statement (#368)
  • OMPL constrained planning (#347)
  • Sync main branch with MoveIt 1 from previous head https://github.com/ros-planning/moveit/commit/0247ed0027ca9d7f1a7f066e62c80c9ce5dbbb5e up to https://github.com/ros-planning/moveit/commit/74b3e30db2e8683ac17b339cc124675ae52a5114
  • [fix] MGI server timeout, infinite duration by default (#349) By setting the default server timeout duration to -1, the MoveGroupInterface is ensured to be ready to use after construction.
  • [fix] export cmake library install (#339)
  • Fix scaling factor parameter names (#2452)
  • MTC compatibility fixes (#323)
  • Fix node remapping
  • Make sure planning scene interface have a unique name for the internal node
  • planning_scene_interface: Fix node name being empty
  • Fix repo URLs in package.xml files
  • Contributors: Boston Cleek, FlorisE, Henning Kayser, Jafar Abdi, Shota Aoki, Tyler Weaver

2.1.0 (2020-11-23)

  • [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] Compilation fixes for macOS (#271)
  • [ros2-migration] Port MoveGroupInterface and MotionPlanning display (#272)
  • Contributors: Henning Kayser, Jafar Abdi, Lior Lustgarten, Mark Moll, Yu Yan

2.0.0 (2020-02-17)

  • [fix] Install moveit_cpp as SHARED library
  • [fix] Fix parameter lookup and runtime in MoveItCpp
  • [fix] Fix moveit_ros_visualization (#167)
  • [fix] moveit_ros_planning_interface: Fix libraries export
  • [port] Port moveit_cpp to ROS 2 (#163)
  • [port] Port common_planning_interface_objects to ROS 2 (#159)
  • [port] Port rdf_loader to ROS2 (#104)
  • Contributors: Henning Kayser, Jafar Abdi

1.1.1 (2020-10-13)

1.1.0 (2020-09-04)

1.0.6 (2020-08-19)

  • [maint] Adapt repository for splitted moveit_resources layout (ros-planning:moveit#2199)
  • [maint] Migrate to clang-format-10, Fix warnings
  • [maint] Optimize includes (ros-planning:moveit#2229)
  • [feature] Exposed parameter wait_for_servers and getPlannerId() API in MoveGroup's Python API (ros-planning:moveit#2201)
  • Contributors: Gerard Canal, Markus Vieth, Robert Haschke, Michael Görner

1.0.5 (2020-07-08)

  • [maint] Remove dependency on panda_moveit_config (ros-planning:moveit#2194 <<https://github.com/ros-planning/moveit/issues/2194>>_, ros-planning:moveit#2197)
  • [maint] Adapt linking to eigenpy (ros-planning:moveit#2118)
  • [maint] Replace robot_model and robot_state namespaces with moveit::core (ros-planning:moveit#2135)
  • [feature] PlanningComponent: Load plan_request_params (ros-planning:moveit#2033)
  • [feature] MoveItCpp: a high-level C++ planning API (ros-planning:moveit#1656)
  • [fix] Validate action client pointer before access
  • [fix] Wait and check for the grasp service
  • [maint] Add tests for move_group interface (ros-planning:moveit#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 (ros-planning:moveit#1955)
  • [feature] Allow to instantiate a [PlanningSceneInterface]{.title-ref} w/ and w/o a running [move_group]{.title-ref} node
  • [fix] Release Python [GIL]{.title-ref} for C++ calls (ros-planning:moveit#1947)
  • [feature] Expose reference_point_position parameter in getJacobian() (ros-planning:moveit#1595)
  • [feature] `MoveGroupInterface`: Expose [constructPickGoal]{.title-ref} and [constructPlaceGoal]{.title-ref} (ros-planning:moveit#1498)
  • [feature] `python MoveGroupInterface`: Added custom time limit for [wait_for_servers()]{.title-ref} (ros-planning:moveit#1444)
  • [maint] Apply clang-tidy fix to entire code base (ros-planning:moveit#1394)
  • [maint] Fix errors: catkin_lint 1.6.7 (ros-planning:moveit#1987)
  • [maint] Improve Python 3 compatibility (ros-planning:moveit#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
  • [maint] Use CMAKE_CXX_STANDARD to enforce c++14 (ros-planning:moveit#1607)
  • [maint] Updated deprecation method: MOVEIT_DEPRECATED -> [[deprecated]] (ros-planning:moveit#1748)
  • [maint] `eigenpy`: switched to system package (ros-planning:moveit#1737)
  • [featue] `PlanningSceneInterface`: wait for its two services
  • [feature] Select time parametrization algorithm in retime_trajectory (ros-planning:moveit#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 (ros-planning:moveit#1410)
  • Contributors: Mahmoud Ahmed Selim

1.0.1 (2019-03-08)

  • [improve] Apply clang tidy fix to entire code base (Part 1) (ros-planning:moveit#1366)
  • Contributors: Robert Haschke, Yu, Yan

1.0.0 (2019-02-24)

  • [fix] catkin_lint issues (ros-planning:moveit#1341)
  • [improve] Remove (redundant) random seeding and ros-planning:moveit#attempts from RobotState::setFromIK() as the IK solver perform random seeding themselves. ros-planning:moveit#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 (ros-planning:moveit#1261)
  • Contributors: Robert Haschke

0.10.6 (2018-12-09)

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++ (ros-planning:moveit#1159)
  • Contributors: Dave Coleman

0.10.2 (2018-10-24)

0.10.1 (2018-05-25)

0.9.11 (2017-12-25)

0.9.10 (2017-12-09)

  • [fix] MoveGroupInterface: Fixed computeCartesianPath to use selected end-effector. (ros-planning:moveit#580)
  • [capability][kinetic onward] Adapt pick pipeline to function without object (ros-planning:moveit#599)
  • [improve] Disabled copy constructors and added a move constructor to MoveGroupInterface (ros-planning:moveit#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 (ros-planning:moveit#461)
  • Contributors: Michael Goerner

0.9.5 (2017-03-08)

0.9.4 (2017-02-06)

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 ros-planning:moveit-ros#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 ros-planning:moveit-ros#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 ros-planning:moveit-ros#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.6 (2013-09-26)

  • update planning options

0.5.5 (2013-09-23)

  • add support for setting joint targets from approximate IK
  • specifies python version 2.7 for linking (fixes ros-planning:moveit-ros#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 ros-planning:moveit-ros#280
  • make headers and author definitions aligned the same way; white space fixes

0.5.2 (2013-07-15)

  • move msgs to common_msgs

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)

0.4.4 (2013-06-26)

  • some refactoring

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged moveit_ros_planning_interface at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 1.1.16
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-planning/moveit.git
VCS Type git
VCS Version master
Last Updated 2024-11-19
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

Components of MoveIt that offer simpler interfaces to planning and execution

Additional Links

Maintainers

  • Michael Ferguson
  • Michael Görner
  • MoveIt Release Team

Authors

  • Ioan Sucan
README
No README found. See repository README.
CHANGELOG

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.12 (2023-05-13)

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]{.title-ref} (#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)
  • [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]{.title-ref} w/ and w/o a running [move_group]{.title-ref} node
  • [fix] Release Python [GIL]{.title-ref} for C++ calls (#1947)
  • [feature] Expose reference_point_position parameter in getJacobian() (#1595)
  • [feature] `MoveGroupInterface`: Expose [constructPickGoal]{.title-ref} and [constructPlaceGoal]{.title-ref} (#1498)
  • [feature] `python MoveGroupInterface`: Added custom time limit for [wait_for_servers()]{.title-ref} (#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]{.title-ref} 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
  • 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.6 (2013-09-26)

  • update planning options

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.2 (2013-07-15)

  • move msgs to common_msgs

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)

0.4.4 (2013-06-26)

  • some refactoring

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged moveit_ros_planning_interface at Robotics Stack Exchange

No version for distro ardent. Known supported distros are highlighted in the buttons above.
No version for distro bouncy. Known supported distros are highlighted in the buttons above.
No version for distro crystal. Known supported distros are highlighted in the buttons above.
No version for distro eloquent. Known supported distros are highlighted in the buttons above.
No version for distro dashing. Known supported distros are highlighted in the buttons above.

Package Summary

Tags No category tags.
Version 2.11.0
License BSD-3-Clause
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-planning/moveit2.git
VCS Type git
VCS Version main
Last Updated 2024-11-19
Dev Status DEVELOPED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

Components of MoveIt that offer simpler remote (as from another ROS 2 node) interfaces to planning and execution

Additional Links

Maintainers

  • Henning Kayser
  • Tyler Weaver
  • Michael Görner
  • MoveIt Release Team

Authors

  • Ioan Sucan
README
No README found. See repository README.
CHANGELOG

Changelog for package moveit_ros_planning_interface

2.11.0 (2024-09-16)

2.10.0 (2024-06-13)

  • Apply clang-tidy fixes
  • Migrate ros-planning org to moveit (#2847)
    • Rename github.com/ros-planning -> github.com/moveit
    • Rename ros-planning.github.io -> moveit.github.io
    • Rename ros-planning organization in docker and CI workflow files
    • ghcr.io/ros-planning -> ghcr.io/moveit
    • github.repository == 'moveit/*''
  • Add getNodeHandle impl (#2840) Co-authored-by: Sebastian Jahr <<sebastian.jahr@picknik.ai>>
  • Unify log names (#2720) Co-authored-by: Abishalini Sivaraman <<abi.gpuram@gmail.com>>
  • Add parameter api integration test (#2662)
  • CMake format and lint in pre-commit (#2683)
  • Remove unused python content from planning interface directory (#2665)
    • Remove unused python content from planning interface directory
    • Cleanup test cmake
  • Contributors: Robert Haschke, Sebastian Jahr, Tyler Weaver, methylDragon

2.9.0 (2024-01-09)

  • Update ros2_control usage (#2620)
    • Update ros2_control usage
    • Update xacro file
  • Node logging in moveit_core (#2503)
  • Use node logging in moveit_ros (#2482)
  • Add new clang-tidy style rules (#2177)
  • Merge branch 'main' into dependabot/github_actions/SonarSource/sonarcloud-github-c-cpp-2
  • Remove old deprecated functions (#2384)
  • Update clang-format-14 with QualifierAlignment (#2362)
    • Set qualifier order in .clang-format
    • Ran pre-commit to update according to new style guide
  • Merge branch 'main' into dependabot/github_actions/SonarSource/sonarcloud-github-c-cpp-2
  • Contributors: Marq Rasmussen, Rayene Messaoud, Sebastian Jahr, Shobuj Paul, Tyler Weaver

2.8.0 (2023-09-10)

  • Specify controller name in MGI execution (#2257)
    • Specify controller name in MGI execute

    * Finish comment ---------Co-authored-by: Sebastian Jahr <<sebastian.jahr@picknik.ai>>

  • Remove deprecated move_group pick& place functionality + demo (#2239) Co-authored-by: Jafar Uruç <<cafer.abdi@gmail.com>>
  • Contributors: Sebastian Jahr, Stephanie Eng

2.7.4 (2023-05-18)

  • Scale acceleration and velocity of cartesian interpolations (#1968)
  • Contributors: Yadu

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)
  • Merge pull request #1900 from Abishalini/pr-sync-1245f15 Sync with MoveIt1
  • Readd comment and assign error code
  • Merge https://github.com/ros-planning/moveit/commit/1245f151393fe09023efec3e1faead2d26737227
  • Update description of moveit_ros_planning_interface (#2045)
    • Update description of moveit_ros_planning_interface

    * Update moveit_ros/planning_interface/package.xml Co-authored-by: Henning Kayser <<henningkayser@picknik.ai>> ---------Co-authored-by: Henning Kayser <<henningkayser@picknik.ai>>

  • Merge PR #3197: Improve computeCartesianPath()
  • Simplify MGI::computeCartesianPath()
  • Contributors: Abishalini, Abishalini Sivaraman, Robert Haschke, Sebastian Jahr, Shobuj Paul

2.7.1 (2023-03-23)

  • Fix member naming (#1949) * Update clang-tidy rules for readability-identifier-naming 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: AlexWebb, Robert Haschke

2.7.0 (2023-01-29)

  • Merge https://github.com/ros-planning/moveit/commit/9225971216885490e933ece25390c63ca14f8a58
  • converted characters from string format to character format (#1881)
  • 400% speed up to move group interface (#1865)
  • GHA: Build moveit_msgs from source (#1853) * Revert #1739: moveit_msgs no longer needs to be built from source This reverts commit 6e0fce31cfe94ef8c6d5ebccb4d865f0c144b6e1.
    • Remove obsolete include: moveit_msgs/srv/execute_known_trajectory.hpp
    • Cleanup moveit2.repos
  • Cleanup msg includes: Use C++ instead of C header (#1844)
  • Fix BSD license in package.xml (#1796)
    • fix BSD license in package.xml
    • this must also be spdx compliant
  • Minimize use of [this->]{.title-ref} (#1784) It's often unnecessary. MoveIt already avoids this in most cases so this PR better cements that existing pattern.
  • Remove [MOVEIT_LIB_NAME]{.title-ref} (#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>>

  • Test [moveit_commander.set_joint_value_target]{.title-ref} with JointState argument (#3187)
    • Test with JointState argument

    * Check size of name and position fields Co-authored-by: Robert Haschke <<rhaschke@techfak.uni-bielefeld.de>>

  • Contributors: Abhijeet Das Gupta, Abishalini, Chris Thrasher, Christian Henkel, Cory Crean, Filip Sund, Robert Haschke, Sameer Gupta, azalutsky

2.6.0 (2022-11-10)

  • Log error when named joint state target does not exist (#1580)
  • Express Humble/Rolling differences in #if (#1620)
  • Fix deprecated declaration usage (#1598)
    • Fix type
    • Suppress warning
    • Add TODO
  • Merge PR #1553: Improve cmake files
  • Remove callback_executor_.is_spinning()
  • Use standard exported targets: export_${PROJECT_NAME} -> ${PROJECT_NAME}Targets
  • Improve CMake usage (#1550)
  • Remove __has_include statements (#1481)
  • Merge https://github.com/ros-planning/moveit/commit/a63580edd05b01d9480c333645036e5b2b222da9
  • Fix callback execution in MGI (#1305) The initial implementation with the private node allowed for concurrent spinning of the same node, producing runtime exceptions. This change removes the need for a private node by letting MGI manage its own CallbackGroup and Executor thread.
  • Changed 'return false' in plan, move and execute such that MoveItErrorCode is returned (#1266)
  • Add and fix dual arm test (#3119)
    • Add dual arm test

    * Fix and simplify UnionConstraintSampler: update joint transforms Co-authored-by: Cristian Beltran <<cristianbehe@gmail.com>> Co-authored-by: Robert Haschke <<rhaschke@techfak.uni-bielefeld.de>>

  • Contributors: Abishalini Sivaraman, Henning Kayser, Robert Haschke, Rufus Wong, Sebastian Jahr, Tyler Weaver, Vatan Aksoy Tezer, abishalini, cambel, tbastiaens-riwo

2.5.3 (2022-07-28)

2.5.2 (2022-07-18)

2.5.1 (2022-05-31)

2.5.0 (2022-05-26)

2.4.0 (2022-01-20)

  • Fix boost linking errors for Windows (#957)
  • Replace NULL with nullptr (#961)
  • Merge https://github.com/ros-planning/moveit/commit/a0ee2020c4a40d03a48044d71753ed23853a665d
  • 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().
  • MGI: add missing replan/look options to interface (#2892)
    • reordered methods because looking requires replanning

    - there's no sense in wrapping methods in methods. just use pimpl-friend paradigm instead. Someone could rework all the other methods in the future.

  • PSI: get object.pose from new msg field (#2877)
  • Contributors: Abishalini, Akash, Gauthier Hentz, Michael Görner, Robert Haschke, Stephanie Eng

2.3.2 (2021-12-29)

2.3.1 (2021-12-23)

  • Add codespell to precommit, fix A LOT of spelling mistakes (#934)
  • Consider simulated time (#883)
  • Enforce package.xml format 3 Schema (#779)
  • Update Maintainers of MoveIt package (#697)
  • Find/replace deprecated spawner.py (#737)
  • common_objects: getSharedRobotModelLoader fix deadlock (#734)
  • 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: AndyZe, Dave Coleman, David V. Lu!!, Felix von Drigalski, Gaël Écorchard, Henning Kayser, Jafar Abdi, Kevin Chang, Robert Haschke, pvanlaar

2.3.0 (2021-10-08)

  • Support passing MoveGroup's namespace to MoveGroupInterface (#533)
  • Add getSharedRobotModelLoader to fix race condition when having multiple displays for the same node (#525)
  • Make TF buffer & listener in PSM private (#654)
    • Add private buffer & tf listener to PSM
    • Remove coupled deleter
    • Decouple PSM from CSM
    • Deprecate old constructors
  • getInterfaceDescription: Fix rclcpp API breakage (#686)
  • [main] Migrate to joint_state_broadcaster (#657)
  • 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
  • Create a transform subscribers to enable virtual joints (#310)
  • Fix loading joint_limits.yaml in demo and test launch files (#544)
  • Fixes for Windows (#530)
  • Contributors: Akash, Jafar Abdi, Nisala Kalupahana, Jorge Nicho, Henning Kayser, Vatan Aksoy Tezer, Tyler Weaver, Lior Lustgarten

2.2.1 (2021-07-12)

  • Fix test dependencies (#539)
  • Contributors: Jochen Sprickerhof

2.2.0 (2021-06-30)

  • Enable Rolling and Galactic CI (#494)
  • [sync] with MoveIt's master branch up-to https://github.com/ros-planning/moveit/commit/0d0a6a171b3fbea97a0c4f284e13433ba66a4ea4
    • Allow selecting planning pipeline in MotionSequenceAction (#2657)
    • planning_interface: synchronize async interfaces in test (#2640)
    • Add planning_pipeline_id setting to Python MGI (#2622)
    • fix docstring in MGI API (#2626)
    • Support multiple planning pipelines with MoveGroup via MoveItCpp (#2127)
      • Deprecate namespace moveit::planning_interface in favor of moveit_cpp
    • 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)
  • Contributors: Felix von Drigalski, Henning Kayser, JafarAbdi, Michael Görner, Peter Mitrano, Robert Haschke, Tyler Weaver, Vatan Aksoy Tezer, petkovich

2.1.4 (2021-05-31)

  • Disable flaky test (#482)
  • Delete MoveIt fake_controller_manager (#471)
  • Contributors: AndyZe, Vatan Aksoy Tezer

2.1.3 (2021-05-22)

  • Configure OMPL projection_evaluator in move_group_launch_test_common.py (#470)
  • Contributors: Jafar Abdi

2.1.2 (2021-04-20)

  • Re-enable test_servo_pose_tracking integration test (#423) Co-authored-by: AndyZe <<zelenak@picknik.ai>>
  • Re-enable moveit_ros_warehouse for moveit_ros_planning_interface (#424)
    • Remove warehouse_ros_mongo from moveit_ros_planning_interface test depends
  • Unify PickNik name in copyrights (#419)
  • Contributors: Jafar Abdi, Tyler Weaver, Vatan Aksoy Tezer

2.1.1 (2021-04-12)

  • Update launch files to use ros2 control spawner (#405)
  • Use fake_components::GenericSystem from ros2_control (#361)
  • Solved small issue with a message not being logged due to an early return statement (#368)
  • OMPL constrained planning (#347)
  • Sync main branch with MoveIt 1 from previous head https://github.com/ros-planning/moveit/commit/0247ed0027ca9d7f1a7f066e62c80c9ce5dbbb5e up to https://github.com/ros-planning/moveit/commit/74b3e30db2e8683ac17b339cc124675ae52a5114
  • [fix] MGI server timeout, infinite duration by default (#349) By setting the default server timeout duration to -1, the MoveGroupInterface is ensured to be ready to use after construction.
  • [fix] export cmake library install (#339)
  • Fix scaling factor parameter names (#2452)
  • MTC compatibility fixes (#323)
  • Fix node remapping
  • Make sure planning scene interface have a unique name for the internal node
  • planning_scene_interface: Fix node name being empty
  • Fix repo URLs in package.xml files
  • Contributors: Boston Cleek, FlorisE, Henning Kayser, Jafar Abdi, Shota Aoki, Tyler Weaver

2.1.0 (2020-11-23)

  • [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] Compilation fixes for macOS (#271)
  • [ros2-migration] Port MoveGroupInterface and MotionPlanning display (#272)
  • Contributors: Henning Kayser, Jafar Abdi, Lior Lustgarten, Mark Moll, Yu Yan

2.0.0 (2020-02-17)

  • [fix] Install moveit_cpp as SHARED library
  • [fix] Fix parameter lookup and runtime in MoveItCpp
  • [fix] Fix moveit_ros_visualization (#167)
  • [fix] moveit_ros_planning_interface: Fix libraries export
  • [port] Port moveit_cpp to ROS 2 (#163)
  • [port] Port common_planning_interface_objects to ROS 2 (#159)
  • [port] Port rdf_loader to ROS2 (#104)
  • Contributors: Henning Kayser, Jafar Abdi

1.1.1 (2020-10-13)

1.1.0 (2020-09-04)

1.0.6 (2020-08-19)

  • [maint] Adapt repository for splitted moveit_resources layout (ros-planning:moveit#2199)
  • [maint] Migrate to clang-format-10, Fix warnings
  • [maint] Optimize includes (ros-planning:moveit#2229)
  • [feature] Exposed parameter wait_for_servers and getPlannerId() API in MoveGroup's Python API (ros-planning:moveit#2201)
  • Contributors: Gerard Canal, Markus Vieth, Robert Haschke, Michael Görner

1.0.5 (2020-07-08)

  • [maint] Remove dependency on panda_moveit_config (ros-planning:moveit#2194 <<https://github.com/ros-planning/moveit/issues/2194>>_, ros-planning:moveit#2197)
  • [maint] Adapt linking to eigenpy (ros-planning:moveit#2118)
  • [maint] Replace robot_model and robot_state namespaces with moveit::core (ros-planning:moveit#2135)
  • [feature] PlanningComponent: Load plan_request_params (ros-planning:moveit#2033)
  • [feature] MoveItCpp: a high-level C++ planning API (ros-planning:moveit#1656)
  • [fix] Validate action client pointer before access
  • [fix] Wait and check for the grasp service
  • [maint] Add tests for move_group interface (ros-planning:moveit#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 (ros-planning:moveit#1955)
  • [feature] Allow to instantiate a [PlanningSceneInterface]{.title-ref} w/ and w/o a running [move_group]{.title-ref} node
  • [fix] Release Python [GIL]{.title-ref} for C++ calls (ros-planning:moveit#1947)
  • [feature] Expose reference_point_position parameter in getJacobian() (ros-planning:moveit#1595)
  • [feature] `MoveGroupInterface`: Expose [constructPickGoal]{.title-ref} and [constructPlaceGoal]{.title-ref} (ros-planning:moveit#1498)
  • [feature] `python MoveGroupInterface`: Added custom time limit for [wait_for_servers()]{.title-ref} (ros-planning:moveit#1444)
  • [maint] Apply clang-tidy fix to entire code base (ros-planning:moveit#1394)
  • [maint] Fix errors: catkin_lint 1.6.7 (ros-planning:moveit#1987)
  • [maint] Improve Python 3 compatibility (ros-planning:moveit#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
  • [maint] Use CMAKE_CXX_STANDARD to enforce c++14 (ros-planning:moveit#1607)
  • [maint] Updated deprecation method: MOVEIT_DEPRECATED -> [[deprecated]] (ros-planning:moveit#1748)
  • [maint] `eigenpy`: switched to system package (ros-planning:moveit#1737)
  • [featue] `PlanningSceneInterface`: wait for its two services
  • [feature] Select time parametrization algorithm in retime_trajectory (ros-planning:moveit#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 (ros-planning:moveit#1410)
  • Contributors: Mahmoud Ahmed Selim

1.0.1 (2019-03-08)

  • [improve] Apply clang tidy fix to entire code base (Part 1) (ros-planning:moveit#1366)
  • Contributors: Robert Haschke, Yu, Yan

1.0.0 (2019-02-24)

  • [fix] catkin_lint issues (ros-planning:moveit#1341)
  • [improve] Remove (redundant) random seeding and ros-planning:moveit#attempts from RobotState::setFromIK() as the IK solver perform random seeding themselves. ros-planning:moveit#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 (ros-planning:moveit#1261)
  • Contributors: Robert Haschke

0.10.6 (2018-12-09)

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++ (ros-planning:moveit#1159)
  • Contributors: Dave Coleman

0.10.2 (2018-10-24)

0.10.1 (2018-05-25)

0.9.11 (2017-12-25)

0.9.10 (2017-12-09)

  • [fix] MoveGroupInterface: Fixed computeCartesianPath to use selected end-effector. (ros-planning:moveit#580)
  • [capability][kinetic onward] Adapt pick pipeline to function without object (ros-planning:moveit#599)
  • [improve] Disabled copy constructors and added a move constructor to MoveGroupInterface (ros-planning:moveit#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 (ros-planning:moveit#461)
  • Contributors: Michael Goerner

0.9.5 (2017-03-08)

0.9.4 (2017-02-06)

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 ros-planning:moveit-ros#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 ros-planning:moveit-ros#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 ros-planning:moveit-ros#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.6 (2013-09-26)

  • update planning options

0.5.5 (2013-09-23)

  • add support for setting joint targets from approximate IK
  • specifies python version 2.7 for linking (fixes ros-planning:moveit-ros#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 ros-planning:moveit-ros#280
  • make headers and author definitions aligned the same way; white space fixes

0.5.2 (2013-07-15)

  • move msgs to common_msgs

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)

0.4.4 (2013-06-26)

  • some refactoring

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged moveit_ros_planning_interface at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 2.11.0
License BSD-3-Clause
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-planning/moveit2.git
VCS Type git
VCS Version main
Last Updated 2024-11-19
Dev Status DEVELOPED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

Components of MoveIt that offer simpler remote (as from another ROS 2 node) interfaces to planning and execution

Additional Links

Maintainers

  • Henning Kayser
  • Tyler Weaver
  • Michael Görner
  • MoveIt Release Team

Authors

  • Ioan Sucan
README
No README found. See repository README.
CHANGELOG

Changelog for package moveit_ros_planning_interface

2.11.0 (2024-09-16)

2.10.0 (2024-06-13)

  • Apply clang-tidy fixes
  • Migrate ros-planning org to moveit (#2847)
    • Rename github.com/ros-planning -> github.com/moveit
    • Rename ros-planning.github.io -> moveit.github.io
    • Rename ros-planning organization in docker and CI workflow files
    • ghcr.io/ros-planning -> ghcr.io/moveit
    • github.repository == 'moveit/*''
  • Add getNodeHandle impl (#2840) Co-authored-by: Sebastian Jahr <<sebastian.jahr@picknik.ai>>
  • Unify log names (#2720) Co-authored-by: Abishalini Sivaraman <<abi.gpuram@gmail.com>>
  • Add parameter api integration test (#2662)
  • CMake format and lint in pre-commit (#2683)
  • Remove unused python content from planning interface directory (#2665)
    • Remove unused python content from planning interface directory
    • Cleanup test cmake
  • Contributors: Robert Haschke, Sebastian Jahr, Tyler Weaver, methylDragon

2.9.0 (2024-01-09)

  • Update ros2_control usage (#2620)
    • Update ros2_control usage
    • Update xacro file
  • Node logging in moveit_core (#2503)
  • Use node logging in moveit_ros (#2482)
  • Add new clang-tidy style rules (#2177)
  • Merge branch 'main' into dependabot/github_actions/SonarSource/sonarcloud-github-c-cpp-2
  • Remove old deprecated functions (#2384)
  • Update clang-format-14 with QualifierAlignment (#2362)
    • Set qualifier order in .clang-format
    • Ran pre-commit to update according to new style guide
  • Merge branch 'main' into dependabot/github_actions/SonarSource/sonarcloud-github-c-cpp-2
  • Contributors: Marq Rasmussen, Rayene Messaoud, Sebastian Jahr, Shobuj Paul, Tyler Weaver

2.8.0 (2023-09-10)

  • Specify controller name in MGI execution (#2257)
    • Specify controller name in MGI execute

    * Finish comment ---------Co-authored-by: Sebastian Jahr <<sebastian.jahr@picknik.ai>>

  • Remove deprecated move_group pick& place functionality + demo (#2239) Co-authored-by: Jafar Uruç <<cafer.abdi@gmail.com>>
  • Contributors: Sebastian Jahr, Stephanie Eng

2.7.4 (2023-05-18)

  • Scale acceleration and velocity of cartesian interpolations (#1968)
  • Contributors: Yadu

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)
  • Merge pull request #1900 from Abishalini/pr-sync-1245f15 Sync with MoveIt1
  • Readd comment and assign error code
  • Merge https://github.com/ros-planning/moveit/commit/1245f151393fe09023efec3e1faead2d26737227
  • Update description of moveit_ros_planning_interface (#2045)
    • Update description of moveit_ros_planning_interface

    * Update moveit_ros/planning_interface/package.xml Co-authored-by: Henning Kayser <<henningkayser@picknik.ai>> ---------Co-authored-by: Henning Kayser <<henningkayser@picknik.ai>>

  • Merge PR #3197: Improve computeCartesianPath()
  • Simplify MGI::computeCartesianPath()
  • Contributors: Abishalini, Abishalini Sivaraman, Robert Haschke, Sebastian Jahr, Shobuj Paul

2.7.1 (2023-03-23)

  • Fix member naming (#1949) * Update clang-tidy rules for readability-identifier-naming 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: AlexWebb, Robert Haschke

2.7.0 (2023-01-29)

  • Merge https://github.com/ros-planning/moveit/commit/9225971216885490e933ece25390c63ca14f8a58
  • converted characters from string format to character format (#1881)
  • 400% speed up to move group interface (#1865)
  • GHA: Build moveit_msgs from source (#1853) * Revert #1739: moveit_msgs no longer needs to be built from source This reverts commit 6e0fce31cfe94ef8c6d5ebccb4d865f0c144b6e1.
    • Remove obsolete include: moveit_msgs/srv/execute_known_trajectory.hpp
    • Cleanup moveit2.repos
  • Cleanup msg includes: Use C++ instead of C header (#1844)
  • Fix BSD license in package.xml (#1796)
    • fix BSD license in package.xml
    • this must also be spdx compliant
  • Minimize use of [this->]{.title-ref} (#1784) It's often unnecessary. MoveIt already avoids this in most cases so this PR better cements that existing pattern.
  • Remove [MOVEIT_LIB_NAME]{.title-ref} (#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>>

  • Test [moveit_commander.set_joint_value_target]{.title-ref} with JointState argument (#3187)
    • Test with JointState argument

    * Check size of name and position fields Co-authored-by: Robert Haschke <<rhaschke@techfak.uni-bielefeld.de>>

  • Contributors: Abhijeet Das Gupta, Abishalini, Chris Thrasher, Christian Henkel, Cory Crean, Filip Sund, Robert Haschke, Sameer Gupta, azalutsky

2.6.0 (2022-11-10)

  • Log error when named joint state target does not exist (#1580)
  • Express Humble/Rolling differences in #if (#1620)
  • Fix deprecated declaration usage (#1598)
    • Fix type
    • Suppress warning
    • Add TODO
  • Merge PR #1553: Improve cmake files
  • Remove callback_executor_.is_spinning()
  • Use standard exported targets: export_${PROJECT_NAME} -> ${PROJECT_NAME}Targets
  • Improve CMake usage (#1550)
  • Remove __has_include statements (#1481)
  • Merge https://github.com/ros-planning/moveit/commit/a63580edd05b01d9480c333645036e5b2b222da9
  • Fix callback execution in MGI (#1305) The initial implementation with the private node allowed for concurrent spinning of the same node, producing runtime exceptions. This change removes the need for a private node by letting MGI manage its own CallbackGroup and Executor thread.
  • Changed 'return false' in plan, move and execute such that MoveItErrorCode is returned (#1266)
  • Add and fix dual arm test (#3119)
    • Add dual arm test

    * Fix and simplify UnionConstraintSampler: update joint transforms Co-authored-by: Cristian Beltran <<cristianbehe@gmail.com>> Co-authored-by: Robert Haschke <<rhaschke@techfak.uni-bielefeld.de>>

  • Contributors: Abishalini Sivaraman, Henning Kayser, Robert Haschke, Rufus Wong, Sebastian Jahr, Tyler Weaver, Vatan Aksoy Tezer, abishalini, cambel, tbastiaens-riwo

2.5.3 (2022-07-28)

2.5.2 (2022-07-18)

2.5.1 (2022-05-31)

2.5.0 (2022-05-26)

2.4.0 (2022-01-20)

  • Fix boost linking errors for Windows (#957)
  • Replace NULL with nullptr (#961)
  • Merge https://github.com/ros-planning/moveit/commit/a0ee2020c4a40d03a48044d71753ed23853a665d
  • 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().
  • MGI: add missing replan/look options to interface (#2892)
    • reordered methods because looking requires replanning

    - there's no sense in wrapping methods in methods. just use pimpl-friend paradigm instead. Someone could rework all the other methods in the future.

  • PSI: get object.pose from new msg field (#2877)
  • Contributors: Abishalini, Akash, Gauthier Hentz, Michael Görner, Robert Haschke, Stephanie Eng

2.3.2 (2021-12-29)

2.3.1 (2021-12-23)

  • Add codespell to precommit, fix A LOT of spelling mistakes (#934)
  • Consider simulated time (#883)
  • Enforce package.xml format 3 Schema (#779)
  • Update Maintainers of MoveIt package (#697)
  • Find/replace deprecated spawner.py (#737)
  • common_objects: getSharedRobotModelLoader fix deadlock (#734)
  • 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: AndyZe, Dave Coleman, David V. Lu!!, Felix von Drigalski, Gaël Écorchard, Henning Kayser, Jafar Abdi, Kevin Chang, Robert Haschke, pvanlaar

2.3.0 (2021-10-08)

  • Support passing MoveGroup's namespace to MoveGroupInterface (#533)
  • Add getSharedRobotModelLoader to fix race condition when having multiple displays for the same node (#525)
  • Make TF buffer & listener in PSM private (#654)
    • Add private buffer & tf listener to PSM
    • Remove coupled deleter
    • Decouple PSM from CSM
    • Deprecate old constructors
  • getInterfaceDescription: Fix rclcpp API breakage (#686)
  • [main] Migrate to joint_state_broadcaster (#657)
  • 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
  • Create a transform subscribers to enable virtual joints (#310)
  • Fix loading joint_limits.yaml in demo and test launch files (#544)
  • Fixes for Windows (#530)
  • Contributors: Akash, Jafar Abdi, Nisala Kalupahana, Jorge Nicho, Henning Kayser, Vatan Aksoy Tezer, Tyler Weaver, Lior Lustgarten

2.2.1 (2021-07-12)

  • Fix test dependencies (#539)
  • Contributors: Jochen Sprickerhof

2.2.0 (2021-06-30)

  • Enable Rolling and Galactic CI (#494)
  • [sync] with MoveIt's master branch up-to https://github.com/ros-planning/moveit/commit/0d0a6a171b3fbea97a0c4f284e13433ba66a4ea4
    • Allow selecting planning pipeline in MotionSequenceAction (#2657)
    • planning_interface: synchronize async interfaces in test (#2640)
    • Add planning_pipeline_id setting to Python MGI (#2622)
    • fix docstring in MGI API (#2626)
    • Support multiple planning pipelines with MoveGroup via MoveItCpp (#2127)
      • Deprecate namespace moveit::planning_interface in favor of moveit_cpp
    • 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)
  • Contributors: Felix von Drigalski, Henning Kayser, JafarAbdi, Michael Görner, Peter Mitrano, Robert Haschke, Tyler Weaver, Vatan Aksoy Tezer, petkovich

2.1.4 (2021-05-31)

  • Disable flaky test (#482)
  • Delete MoveIt fake_controller_manager (#471)
  • Contributors: AndyZe, Vatan Aksoy Tezer

2.1.3 (2021-05-22)

  • Configure OMPL projection_evaluator in move_group_launch_test_common.py (#470)
  • Contributors: Jafar Abdi

2.1.2 (2021-04-20)

  • Re-enable test_servo_pose_tracking integration test (#423) Co-authored-by: AndyZe <<zelenak@picknik.ai>>
  • Re-enable moveit_ros_warehouse for moveit_ros_planning_interface (#424)
    • Remove warehouse_ros_mongo from moveit_ros_planning_interface test depends
  • Unify PickNik name in copyrights (#419)
  • Contributors: Jafar Abdi, Tyler Weaver, Vatan Aksoy Tezer

2.1.1 (2021-04-12)

  • Update launch files to use ros2 control spawner (#405)
  • Use fake_components::GenericSystem from ros2_control (#361)
  • Solved small issue with a message not being logged due to an early return statement (#368)
  • OMPL constrained planning (#347)
  • Sync main branch with MoveIt 1 from previous head https://github.com/ros-planning/moveit/commit/0247ed0027ca9d7f1a7f066e62c80c9ce5dbbb5e up to https://github.com/ros-planning/moveit/commit/74b3e30db2e8683ac17b339cc124675ae52a5114
  • [fix] MGI server timeout, infinite duration by default (#349) By setting the default server timeout duration to -1, the MoveGroupInterface is ensured to be ready to use after construction.
  • [fix] export cmake library install (#339)
  • Fix scaling factor parameter names (#2452)
  • MTC compatibility fixes (#323)
  • Fix node remapping
  • Make sure planning scene interface have a unique name for the internal node
  • planning_scene_interface: Fix node name being empty
  • Fix repo URLs in package.xml files
  • Contributors: Boston Cleek, FlorisE, Henning Kayser, Jafar Abdi, Shota Aoki, Tyler Weaver

2.1.0 (2020-11-23)

  • [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] Compilation fixes for macOS (#271)
  • [ros2-migration] Port MoveGroupInterface and MotionPlanning display (#272)
  • Contributors: Henning Kayser, Jafar Abdi, Lior Lustgarten, Mark Moll, Yu Yan

2.0.0 (2020-02-17)

  • [fix] Install moveit_cpp as SHARED library
  • [fix] Fix parameter lookup and runtime in MoveItCpp
  • [fix] Fix moveit_ros_visualization (#167)
  • [fix] moveit_ros_planning_interface: Fix libraries export
  • [port] Port moveit_cpp to ROS 2 (#163)
  • [port] Port common_planning_interface_objects to ROS 2 (#159)
  • [port] Port rdf_loader to ROS2 (#104)
  • Contributors: Henning Kayser, Jafar Abdi

1.1.1 (2020-10-13)

1.1.0 (2020-09-04)

1.0.6 (2020-08-19)

  • [maint] Adapt repository for splitted moveit_resources layout (ros-planning:moveit#2199)
  • [maint] Migrate to clang-format-10, Fix warnings
  • [maint] Optimize includes (ros-planning:moveit#2229)
  • [feature] Exposed parameter wait_for_servers and getPlannerId() API in MoveGroup's Python API (ros-planning:moveit#2201)
  • Contributors: Gerard Canal, Markus Vieth, Robert Haschke, Michael Görner

1.0.5 (2020-07-08)

  • [maint] Remove dependency on panda_moveit_config (ros-planning:moveit#2194 <<https://github.com/ros-planning/moveit/issues/2194>>_, ros-planning:moveit#2197)
  • [maint] Adapt linking to eigenpy (ros-planning:moveit#2118)
  • [maint] Replace robot_model and robot_state namespaces with moveit::core (ros-planning:moveit#2135)
  • [feature] PlanningComponent: Load plan_request_params (ros-planning:moveit#2033)
  • [feature] MoveItCpp: a high-level C++ planning API (ros-planning:moveit#1656)
  • [fix] Validate action client pointer before access
  • [fix] Wait and check for the grasp service
  • [maint] Add tests for move_group interface (ros-planning:moveit#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 (ros-planning:moveit#1955)
  • [feature] Allow to instantiate a [PlanningSceneInterface]{.title-ref} w/ and w/o a running [move_group]{.title-ref} node
  • [fix] Release Python [GIL]{.title-ref} for C++ calls (ros-planning:moveit#1947)
  • [feature] Expose reference_point_position parameter in getJacobian() (ros-planning:moveit#1595)
  • [feature] `MoveGroupInterface`: Expose [constructPickGoal]{.title-ref} and [constructPlaceGoal]{.title-ref} (ros-planning:moveit#1498)
  • [feature] `python MoveGroupInterface`: Added custom time limit for [wait_for_servers()]{.title-ref} (ros-planning:moveit#1444)
  • [maint] Apply clang-tidy fix to entire code base (ros-planning:moveit#1394)
  • [maint] Fix errors: catkin_lint 1.6.7 (ros-planning:moveit#1987)
  • [maint] Improve Python 3 compatibility (ros-planning:moveit#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
  • [maint] Use CMAKE_CXX_STANDARD to enforce c++14 (ros-planning:moveit#1607)
  • [maint] Updated deprecation method: MOVEIT_DEPRECATED -> [[deprecated]] (ros-planning:moveit#1748)
  • [maint] `eigenpy`: switched to system package (ros-planning:moveit#1737)
  • [featue] `PlanningSceneInterface`: wait for its two services
  • [feature] Select time parametrization algorithm in retime_trajectory (ros-planning:moveit#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 (ros-planning:moveit#1410)
  • Contributors: Mahmoud Ahmed Selim

1.0.1 (2019-03-08)

  • [improve] Apply clang tidy fix to entire code base (Part 1) (ros-planning:moveit#1366)
  • Contributors: Robert Haschke, Yu, Yan

1.0.0 (2019-02-24)

  • [fix] catkin_lint issues (ros-planning:moveit#1341)
  • [improve] Remove (redundant) random seeding and ros-planning:moveit#attempts from RobotState::setFromIK() as the IK solver perform random seeding themselves. ros-planning:moveit#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 (ros-planning:moveit#1261)
  • Contributors: Robert Haschke

0.10.6 (2018-12-09)

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++ (ros-planning:moveit#1159)
  • Contributors: Dave Coleman

0.10.2 (2018-10-24)

0.10.1 (2018-05-25)

0.9.11 (2017-12-25)

0.9.10 (2017-12-09)

  • [fix] MoveGroupInterface: Fixed computeCartesianPath to use selected end-effector. (ros-planning:moveit#580)
  • [capability][kinetic onward] Adapt pick pipeline to function without object (ros-planning:moveit#599)
  • [improve] Disabled copy constructors and added a move constructor to MoveGroupInterface (ros-planning:moveit#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 (ros-planning:moveit#461)
  • Contributors: Michael Goerner

0.9.5 (2017-03-08)

0.9.4 (2017-02-06)

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 ros-planning:moveit-ros#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 ros-planning:moveit-ros#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 ros-planning:moveit-ros#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.6 (2013-09-26)

  • update planning options

0.5.5 (2013-09-23)

  • add support for setting joint targets from approximate IK
  • specifies python version 2.7 for linking (fixes ros-planning:moveit-ros#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 ros-planning:moveit-ros#280
  • make headers and author definitions aligned the same way; white space fixes

0.5.2 (2013-07-15)

  • move msgs to common_msgs

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)

0.4.4 (2013-06-26)

  • some refactoring

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged moveit_ros_planning_interface at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 0.9.18
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-planning/moveit.git
VCS Type git
VCS Version kinetic-devel
Last Updated 2020-10-12
Dev Status MAINTAINED
CI status Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

Components of MoveIt! that offer simpler interfaces to planning and execution

Additional Links

Maintainers

  • Michael Ferguson
  • Michael Görner
  • MoveIt! Release Team

Authors

  • Ioan Sucan
README
No README found. See repository README.
CHANGELOG

Changelog for package moveit_ros_planning_interface

0.9.18 (2020-01-24)

0.9.17 (2019-07-09)

  • Add missing run dependency to eigenpy
  • Contributors: Robert Haschke

0.9.16 (2019-06-29)

  • [maintanance] Resolve catkin lint issues (#1137)
  • [maintanance] Improve clang-format (#1214)
  • [feature] Add getMoveGroupClient() to move_group_interface (#1215)
  • Contributors: Ludovic Delval, Martin Günther, Robert Haschke, Ryosuke Tajima

0.9.15 (2018-10-29)

  • [improvement] Exploit the fact that our transforms are isometries (instead of general affine transformations). #1091
  • Contributors: Robert Haschke

0.9.14 (2018-10-24)

0.9.13 (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.9.12 (2018-05-29)

  • [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.6 (2013-09-26)

  • update planning options

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.2 (2013-07-15)

  • move msgs to common_msgs

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)

0.4.4 (2013-06-26)

  • some refactoring

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged moveit_ros_planning_interface at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 0.8.7
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-planning/moveit.git
VCS Type git
VCS Version jade-devel
Last Updated 2017-07-23
Dev Status MAINTAINED
CI status Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

Components of MoveIt that offer simpler interfaces to planning and execution

Additional Links

Maintainers

  • Ioan Sucan
  • Michael Ferguson

Authors

  • Ioan Sucan
README
No README found. See repository README.
CHANGELOG

Changelog for package moveit_ros_planning_interface

0.8.7 (2017-04-03)

  • [fix] address gcc6 build error (#458)
  • Contributors: Dave Coleman

0.8.6 (2017-03-08)

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

0.8.4 (2017-02-06)

  • [fix] move_group.cpp: seg fault bug (#426)
  • [capability] PSI: add apply* functions that use ApplyPlanningScene.srv (#381)
  • Contributors: Bastian Gaspers, Dave Coleman, Isaac I.Y. Saito, Jorge Santos Simon, Michael Goerner, Robert Haschke

0.8.3 (2016-08-19)

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.6 (2013-09-26)

  • update planning options

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.2 (2013-07-15)

  • move msgs to common_msgs

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)

0.4.4 (2013-06-26)

  • some refactoring

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged moveit_ros_planning_interface at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 0.7.14
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-planning/moveit.git
VCS Type git
VCS Version indigo-devel
Last Updated 2019-06-17
Dev Status MAINTAINED
CI status Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

Components of MoveIt that offer simpler interfaces to planning and execution

Additional Links

Maintainers

  • Michael Ferguson
  • Michael Görner
  • MoveIt! Release Team

Authors

  • Ioan Sucan
README
No README found. See repository README.
CHANGELOG

Changelog for package moveit_ros_planning_interface

0.7.14 (2018-10-20)

  • [fix] fix race conditions when updating PlanningScene #350
  • Contributors: Michael Görner, Robert Haschke

0.7.13 (2017-12-25)

  • [fix] MoveGroupInterface: Fixed computeCartesianPath to use selected end-effector. (#580)
  • [improve] Disabled copy constructors and added a move constructor to MoveGroupInterface (#664)
  • Contributors: 2scholz, Dennis Hartmann, Jonathan Meyer, Simon Schmeisser

0.7.12 (2017-08-06)

0.7.11 (2017-06-21)

0.7.10 (2017-06-07)

0.7.9 (2017-04-03)

0.7.8 (2017-03-08)

  • [enhancement][MoveGroup] Add getLinkNames function (#440)
  • [doc][moveit_commander] added description for set_start_state (#447)
  • Contributors: Dmitry Rozhkov, Isaac I.Y. Saito, henhenhen

0.7.7 (2017-02-06)

  • move_group.cpp: seg fault bug fix (#426) Fixed a bug with casting CallbackQueueInterface * to ros::CallbackQueue * without a check. https://github.com/ros-planning/moveit/issues/425
  • install planning_interface python test This test is reference in the tutorials and should also work with installed workspaces http://docs.ros.org/kinetic/api/moveit_tutorials/html/doc/tests.html#integration-test
  • [moveit_ros] Missing test_depend. (#412)
  • clang-format
  • PSI: make all logs _NAMED
  • PSI: point out synchronicity behavior of apply* and add/removeObjects interfaces
  • remove obsolete mutable declaration This was only required for the proposal to change the behavior of the add/remove functions. Now that I added the apply* interfaces, this is not relevant anymore.
  • PSI: add apply* functions that use ApplyPlanningScene.srv to update move_group's PlanningScene
  • Use ApplyPlanningSceneService in planning_scene_interface Added helper function to call ApplyPlanningScene service with fallback to asynchronous processing via "planning_scene" topic.
  • clang-format upgraded to 3.8 (#404)
  • Contributors: Andreas Köpf, Bastian Gaspers, Dave Coleman, Isaac I.Y. Saito, v4hn

0.7.6 (2016-12-30)

0.7.5 (2016-12-25)

0.7.4 (2016-12-22)

0.7.3 (2016-12-20)

0.7.2 (2016-06-20)

  • Issue #630: remove color information from addCollisionObjects method
  • attachment to the commit: fab50d487d86aa4011fb05e41e694b837eca92df For more information see the specified commit.
  • planning_interface: Set is_diff true for empty start state Executing a motion without setting the start state of the robot like this: ` group_arm.setNamedTarget("start_grab_pose"); success = group_arm.move();` throws the error: Execution of motions should always start at the robot's current state. Ignoring the state supplied as start state in the motion planning request. The problem is, when considered_start_state_ is null, every data field of the start_state in the submitted MotionPlanRequest is 0 or false. But we need is_diff to be true, because otherwise move_group will not consider its current state as actual start state without complaining.
  • Implement issue #630
  • Contributors: Yannick Jonetzko, corot

0.7.1 (2016-04-11)

  • [feat] Adding acceleration scaling factor
  • [fix] conflict issues
  • [doc] [move_group.cpp] Print the name of the move group action server that failed to be connected (#640)
  • Contributors: Dave Coleman, Isaac I.Y. Saito, hemes

0.7.0 (2016-01-30)

  • Removed trailing whitespace from entire repository
  • 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
  • adding set_num_planning_attempts to python interface
  • 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
  • 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, 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.6 (2013-09-26)

  • update planning options

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.2 (2013-07-15)

  • move msgs to common_msgs

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)

0.4.4 (2013-06-26)

  • some refactoring

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged moveit_ros_planning_interface at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 0.5.20
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-planning/moveit_ros.git
VCS Type git
VCS Version hydro-devel
Last Updated 2015-04-14
Dev Status MAINTAINED
CI status Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

Components of MoveIt that offer simpler interfaces to planning and execution

Additional Links

Maintainers

  • Ioan Sucan

Authors

  • Ioan Sucan
README
No README found. See repository README.
CHANGELOG

Changelog for package moveit_ros_planning_interface

0.5.20 (2014-12-09)

  • Fix spurious warning ("execution should start at current state")
  • Add missing variants of place (PlaceLocation, place anywhere) for python interface
  • Python wrapper for getEndEffectorTips()
  • returning int values
  • Contributors: Dave Coleman, Martin Günther, 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.6 (2013-09-26)

  • update planning options

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.2 (2013-07-15)

  • move msgs to common_msgs

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)

0.4.4 (2013-06-26)

  • some refactoring

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged moveit_ros_planning_interface at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 0.9.18
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-planning/moveit.git
VCS Type git
VCS Version kinetic-devel
Last Updated 2020-10-12
Dev Status MAINTAINED
CI status Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

Components of MoveIt! that offer simpler interfaces to planning and execution

Additional Links

Maintainers

  • Michael Ferguson
  • Michael Görner
  • MoveIt! Release Team

Authors

  • Ioan Sucan
README
No README found. See repository README.
CHANGELOG

Changelog for package moveit_ros_planning_interface

0.9.18 (2020-01-24)

0.9.17 (2019-07-09)

  • Add missing run dependency to eigenpy
  • Contributors: Robert Haschke

0.9.16 (2019-06-29)

  • [maintanance] Resolve catkin lint issues (#1137)
  • [maintanance] Improve clang-format (#1214)
  • [feature] Add getMoveGroupClient() to move_group_interface (#1215)
  • Contributors: Ludovic Delval, Martin Günther, Robert Haschke, Ryosuke Tajima

0.9.15 (2018-10-29)

  • [improvement] Exploit the fact that our transforms are isometries (instead of general affine transformations). #1091
  • Contributors: Robert Haschke

0.9.14 (2018-10-24)

0.9.13 (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.9.12 (2018-05-29)

  • [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.6 (2013-09-26)

  • update planning options

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.2 (2013-07-15)

  • move msgs to common_msgs

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)

0.4.4 (2013-06-26)

  • some refactoring

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged moveit_ros_planning_interface at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 1.0.11
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-planning/moveit.git
VCS Type git
VCS Version melodic-devel
Last Updated 2022-09-13
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

Components of MoveIt! that offer simpler interfaces to planning and execution

Additional Links

Maintainers

  • Michael Ferguson
  • Michael Görner
  • MoveIt! Release Team

Authors

  • Ioan Sucan
README
No README found. See repository README.
CHANGELOG

Changelog for package moveit_ros_planning_interface

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.
  • Add missing noexcept declarations (#3016)
  • Move MoveItErrorCode class to moveit_core (#3009)
  • Revert "Fix scaling factor parameter names" (#2907)
  • Contributors: Michael Görner, Robert Haschke

1.0.8 (2021-05-23)

  • planning_interface: synchronize async interfaces in test (#2640)
  • Print an error indicating that the planning pipelines are empty before returning (#2639)
  • Fix docstring in MGI API (#2626)
  • Enable mesh filter (#2448)
  • add get_active_joint_names (#2533)
  • Improve robustness of move group interface test (#2484)
  • Fix scaling factor parameter names (#2452)
  • Contributors: Luc Bettaieb, Boston Cleek, Jafar Abdi, Michael Görner, Peter Mitrano, Shota Aoki, Tyler Weaver

1.0.7 (2020-11-20)

  • [feature] Python interface improvements. (#2356)
  • [feature] moveit_cpp: more informative error message, cover another potential failure condition. (#2336)
  • [feature] Unit Test for ByteString-based ROS msg conversion (#2362)
  • [feature] Make GILReleaser exception-safe (#2363)
  • [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)
  • [maint] Add comment to MOVEIT_CLASS_FORWARD (#2315)
  • Contributors: AndyZe, Bjar Ne, Felix von Drigalski, Gerard Canal, Peter Mitrano, Robert Haschke

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)
  • [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]{.title-ref} w/ and w/o a running [move_group]{.title-ref} node
  • [fix] Release Python [GIL]{.title-ref} for C++ calls (#1947)
  • [feature] Expose reference_point_position parameter in getJacobian() (#1595)
  • [feature] `MoveGroupInterface`: Expose [constructPickGoal]{.title-ref} and [constructPlaceGoal]{.title-ref} (#1498)
  • [feature] `python MoveGroupInterface`: Added custom time limit for [wait_for_servers()]{.title-ref} (#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]{.title-ref} 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
  • 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.6 (2013-09-26)

  • update planning options

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.2 (2013-07-15)

  • move msgs to common_msgs

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)

0.4.4 (2013-06-26)

  • some refactoring

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged moveit_ros_planning_interface at Robotics Stack Exchange