Package Summary
Tags | No category tags. |
Version | 2.1.0 |
License | BSD |
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 | 2021-01-22 |
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
Additional Links
Maintainers
- Michael Ferguson
- Michael Görner
- MoveIt Release Team
Authors
- Ioan Sucan
Changelog for package moveit_ros_planning_interface
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)
- [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
Wiki Tutorials
Source Tutorials
Package Dependencies
System Dependencies
Dependant Packages
Launch files
Messages
Services
Plugins
Recent questions tagged moveit_ros_planning_interface at answers.ros.org
Package Summary
Tags | No category tags. |
Version | 1.1.1 |
License | BSD |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Checkout URI | https://github.com/ros-planning/moveit.git |
VCS Type | git |
VCS Version | noetic-devel |
Last Updated | 2020-12-09 |
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
Additional Links
Maintainers
- Michael Ferguson
- Michael Görner
- MoveIt Release Team
Authors
- Ioan Sucan
Changelog for package moveit_ros_planning_interface
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
Wiki Tutorials
Source Tutorials
Package Dependencies
System Dependencies
Dependant Packages
Launch files
Messages
Services
Plugins
Recent questions tagged moveit_ros_planning_interface at answers.ros.org
Package Summary
Tags | No category tags. |
Version | 1.0.7 |
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 | 2021-01-14 |
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
Additional Links
Maintainers
- Michael Ferguson
- Michael Görner
- MoveIt! Release Team
Authors
- Ioan Sucan
Changelog for package moveit_ros_planning_interface
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
Wiki Tutorials
Source Tutorials
Package Dependencies
System Dependencies
Name |
---|
eigen |
python-catkin-pkg |
python |
Dependant Packages
Launch files
Messages
Services
Plugins
Recent questions tagged moveit_ros_planning_interface at answers.ros.org
Package Summary
Tags | No category tags. |
Version | 0.6.6 |
License | BSD |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Checkout URI | https://github.com/ros-planning/moveit_ros.git |
VCS Type | git |
VCS Version | kinetic-devel |
Last Updated | 2016-08-05 |
Dev Status | MAINTAINED |
CI status | No Continuous Integration |
Released | UNRELEASED |
Tags | No category tags. |
Contributing |
Help Wanted (0)
Good First Issues (0) Pull Requests to Review (0) |
Package Description
Additional Links
Maintainers
- Ioan Sucan
- Michael Ferguson
Authors
- Ioan Sucan
Changelog for package moveit_ros_planning_interface
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
Source Tutorials
Package Dependencies
Deps | Name | |
---|---|---|
3 | moveit_ros_planning | |
3 | moveit_ros_warehouse | |
3 | moveit_ros_move_group | |
3 | moveit_ros_manipulation | |
2 | roscpp | |
2 | rospy | |
2 | rosconsole | |
1 | actionlib | |
1 | tf | |
1 | eigen_conversions | |
1 | tf_conversions | |
1 | catkin |
System Dependencies
Name |
---|
python |
eigen |
python-catkin-pkg |
Dependant Packages
Launch files
Messages
Services
Plugins
Recent questions tagged moveit_ros_planning_interface at answers.ros.org
Package Summary
Tags | No category tags. |
Version | 2.0.0 |
License | BSD |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Checkout URI | https://github.com/ros-planning/moveit2.git |
VCS Type | git |
VCS Version | eloquent |
Last Updated | 2020-10-13 |
Dev Status | DEVELOPED |
CI status | No Continuous Integration |
Released | UNRELEASED |
Tags | No category tags. |
Contributing |
Help Wanted (0)
Good First Issues (0) Pull Requests to Review (0) |
Package Description
Additional Links
Maintainers
- Michael Ferguson
- Michael Görner
- MoveIt Release Team
Authors
- Ioan Sucan
Changelog for package moveit_ros_planning_interface
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.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
Wiki Tutorials
Source Tutorials
Package Dependencies
System Dependencies
Dependant Packages
Launch files
Messages
Services
Plugins
Recent questions tagged moveit_ros_planning_interface at answers.ros.org
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 | No Continuous Integration |
Released | RELEASED |
Tags | No category tags. |
Contributing |
Help Wanted (0)
Good First Issues (0) Pull Requests to Review (0) |
Package Description
Additional Links
Maintainers
- Michael Ferguson
- Michael Görner
- MoveIt! Release Team
Authors
- Ioan Sucan
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)
Wiki Tutorials
Source Tutorials
Package Dependencies
System Dependencies
Name |
---|
python |
eigen |
python-catkin-pkg |
Launch files
Messages
Services
Plugins
Recent questions tagged moveit_ros_planning_interface at answers.ros.org
Package Summary
Tags | No category tags. |
Version | 0.6.6 |
License | BSD |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Checkout URI | https://github.com/ros-planning/moveit_ros.git |
VCS Type | git |
VCS Version | jade-devel |
Last Updated | 2016-08-05 |
Dev Status | MAINTAINED |
CI status | No Continuous Integration |
Released | UNRELEASED |
Tags | No category tags. |
Contributing |
Help Wanted (0)
Good First Issues (0) Pull Requests to Review (0) |
Package Description
Additional Links
Maintainers
- Ioan Sucan
- Michael Ferguson
Authors
- Ioan Sucan
Changelog for package moveit_ros_planning_interface
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
Source Tutorials
Package Dependencies
Deps | Name | |
---|---|---|
3 | moveit_ros_planning | |
3 | moveit_ros_warehouse | |
3 | moveit_ros_move_group | |
3 | moveit_ros_manipulation | |
2 | roscpp | |
2 | rospy | |
2 | rosconsole | |
1 | actionlib | |
1 | tf | |
1 | eigen_conversions | |
1 | tf_conversions | |
1 | catkin |
System Dependencies
Name |
---|
python |
eigen |
python-catkin-pkg |
Dependant Packages
Launch files
Messages
Services
Plugins
Recent questions tagged moveit_ros_planning_interface at answers.ros.org
Package Summary
Tags | No category tags. |
Version | 0.7.2 |
License | BSD |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Checkout URI | https://github.com/ros-planning/moveit_ros.git |
VCS Type | git |
VCS Version | indigo-devel |
Last Updated | 2016-08-05 |
Dev Status | MAINTAINED |
CI status | No Continuous Integration |
Released | UNRELEASED |
Tags | No category tags. |
Contributing |
Help Wanted (0)
Good First Issues (0) Pull Requests to Review (0) |
Package Description
Additional Links
Maintainers
- Ioan Sucan
- Michael Ferguson
Authors
- Ioan Sucan
Changelog for package moveit_ros_planning_interface
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
Source Tutorials
Package Dependencies
System Dependencies
Name |
---|
python |
python-catkin-pkg |
Dependant Packages
Launch files
Messages
Services
Plugins
Recent questions tagged moveit_ros_planning_interface at answers.ros.org
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 | No Continuous Integration |
Released | RELEASED |
Tags | No category tags. |
Contributing |
Help Wanted (0)
Good First Issues (0) Pull Requests to Review (0) |
Package Description
Additional Links
Maintainers
- Ioan Sucan
Authors
- Ioan Sucan
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
Wiki Tutorials
Source Tutorials
Package Dependencies
System Dependencies
Name |
---|
python |
python-catkin-pkg |