No version for distro foxy. Known supported distros are highlighted in the buttons above.
No version for distro humble. Known supported distros are highlighted in the buttons above.
No version for distro iron. Known supported distros are highlighted in the buttons above.
No version for distro rolling. Known supported distros are highlighted in the buttons above.
|
Package Summary
Tags | No category tags. |
Version | 1.1.12 |
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 | 2023-05-28 |
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
The move_group node for MoveIt
Additional Links
Maintainers
- Michael Ferguson
- Michael Görner
- MoveIt Release Team
Authors
- Ioan Sucan
- Sachin Chitta
README
No README found.
See repository README.
CHANGELOG
Changelog for package moveit_ros_move_group
1.1.12 (2023-05-13)
- Generalize RobotState::setFromIK() (https://github.com/ros-planning/moveit/issues/3388)
- Resolve subframe in cartesian_path_service capability
- Fix MoveItCpp issues (#3369)
- Contributors: Robert Haschke
1.1.11 (2022-12-21)
- Merge PR
#3262:
Short-circuit planning adapters
- Early return from failing planning adapters, namely FixStartStateCollision and FixStartStatePathConstraint
- Propagate the error code via [MotionPlanResponse::error_code_]{.title-ref}
- Add string translations for all error codes
- Cleanup translation of MoveItErrorCode to string
- Move default code to moveit_core/utils
- Override defaults in existing getActionResultString()
- Provide translations for all error codes defined in moveit_msgs
-
Drop shortcut avoiding planning when all constraints are already met (#3228)
When calling the PlanAndExcute action, there was a shortcut avoiding planning (and execution) when all goal constraints were already met. However, this check also succeeded when there was an error, e.g. resolving link names. As proper link resolution might require some planning request adapters to be executed, e.g. ResolveConstraintFrames, we should not skip planning. Note, calling the
PlanOnly
action, didn\'t have this shortcut as well, resulting in inconsistent behavior. Contributors: Robert Haschke
1.1.10 (2022-09-13)
Wiki Tutorials
See ROS Wiki Tutorials for more details.
Source Tutorials
Not currently indexed.
Dependant Packages
Launch files
No launch files found
Messages
No message files found.
Services
No service files found
Plugins
Recent questions tagged moveit_ros_move_group at answers.ros.org
|
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
The move_group node for MoveIt
Additional Links
Maintainers
- Michael Ferguson
- Michael Görner
- MoveIt! Release Team
Authors
- Ioan Sucan
- Sachin Chitta
README
No README found.
See repository README.
CHANGELOG
Changelog for package moveit_ros_move_group
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
- 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.
- Simplify launch files to use the test_environment.launch files
from
- Contributors: Robert Haschke
1.0.8 (2021-05-23)
- Fix missing isEmpty() check in compute_ik service (#2544)
- Contributors: Michael G
Wiki Tutorials
See ROS Wiki Tutorials for more details.
Source Tutorials
Not currently indexed.
Dependant Packages
Launch files
No launch files found
Messages
No message files found.
Services
No service files found
Plugins
Recent questions tagged moveit_ros_move_group at answers.ros.org
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.
No version for distro galactic. Known supported distros are highlighted in the buttons above.
|
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
The move_group node for MoveIt
Additional Links
Maintainers
- Michael Ferguson
- Michael Görner
- MoveIt! Release Team
Authors
- Ioan Sucan
- Sachin Chitta
README
No README found.
See repository README.
CHANGELOG
Changelog for package moveit_ros_move_group
0.9.18 (2020-01-24)
0.9.17 (2019-07-09)
0.9.16 (2019-06-29)
- [maintanance] Resolve catkin lint issues (#1137)
- [maintanance] Reduce log spamming: list capabilities only once (#1250)
- Contributors: Ludovic Delval, Robert Haschke
0.9.15 (2018-10-29)
0.9.14 (2018-10-24)
0.9.13 (2018-10-24)
- [fix] PlanningSceneMonitor lock #1033: Fix #868 (#1057)
- [maintenance] various compiler warnings (#1038)
- [maintenance] add minimum required pluginlib version (#927)
- Contributors: Mikael Arguedas, Mohmmad Ayman, Robert Haschke, mike lautman
0.9.12 (2018-05-29)
- disable waitForCurrentRobotState() for PlanService capability (#923), fixing (#868)
- Add namespace capabilities to moveit_commander (#835)
- [fix] MoveAction capability can drop cancel request if it is sent shortly after goal is sent (#756)
- Contributors: Dave Coleman, Ian McMahon, Mikael Arguedas, Robert Haschke, Will Baker
0.9.11 (2017-12-25)
0.9.10 (2017-12-09)
- [fix] always return true in MoveGroupPlanService callback #674
- [improve] adding swp\'s to gitignore and removing redundant capabilites from capability_names.h (#704)
- Contributors: Mike Lautman, Shingo Kitagawa
0.9.9 (2017-08-06)
0.9.8 (2017-06-21)
0.9.7 (2017-06-05)
0.9.6 (2017-04-12)
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)
- Contributors: Bence Magyar, Dave Coleman
0.9.4 (2017-02-06)
- [fix] race conditions when updating PlanningScene (#350)
- [maintenance] clang-format upgraded to 3.8 (#367)
- Contributors: Dave Coleman, Robert Haschke
0.9.3 (2016-11-16)
- [maintenance] Updated package.xml maintainers and author emails #330
- Contributors: Dave Coleman, Ian McMahon
0.9.2 (2016-11-05)
0.6.6 (2016-06-08)
- added missing validity check iterator found with [configs.find()]{.title-ref} needs to be validated before use...
- Removed trailing whitespace from entire repository
- moved planner params services into existing capability QueryPlannerInterfaces
- capability plugin MoveGroupPlannerParamsService to get/set planner params
- Fixed bug(?) in move_group::MoveGroupKinematicsService::computeIK link name selection.
- Contributors: Dave Coleman, Mihai Pomarlan, Robert Haschke
0.6.5 (2015-01-24)
- update maintainers
- Contributors: Michael Ferguson
0.6.4 (2014-12-20)
0.6.3 (2014-12-03)
0.6.2 (2014-10-31)
- Merge pull request #522 from mikeferguson/indigo-devel add dependency on std_srvs (part of octomap clearing service)
- Contributors: Ioan A Sucan, Michael Ferguson
0.6.1 (2014-10-31)
0.6.0 (2014-10-27)
- Added move_group capability for clearing octomap.
- Contributors: Dave Hershberger, Sachin Chitta
0.5.19 (2014-06-23)
- Address [cppcheck: duplicateIf] error. The same condition was being checked twice, and the same action was being taken.
- Contributors: Adolfo Rodriguez Tsouroukdissian
0.5.18 (2014-03-23)
0.5.17 (2014-03-22)
- update maintainer e-mail
- Contributors: Ioan Sucan
0.5.16 (2014-02-27)
- empty state should be a diff state, otherwise attached objects are deleted
- Contributors: sachinc
0.5.14 (2014-02-06)
0.5.13 (2014-02-06)
0.5.12 (2014-01-03)
0.5.11 (2014-01-03)
0.5.10 (2013-12-08)
0.5.9 (2013-12-03)
- Re-ordered movegroup\'s initialization, so capabilities start after monitors.
- correcting maintainer email
- Added planning feedback to gui, refactored states tab
0.5.8 (2013-10-11)
0.5.7 (2013-10-01)
0.5.6 (2013-09-26)
0.5.5 (2013-09-23)
- porting to new RobotState API
- more console output
0.5.4 (2013-08-14)
- make headers and author definitions aligned the same way; white space fixes
- Dependency for move_group_capabilities_base fixed.
0.5.2 (2013-07-15)
0.5.1 (2013-07-14)
0.5.0 (2013-07-12)
- white space fixes (tabs are now spaces)
- port to new base class for planning_interface (using planning contexts)
0.4.5 (2013-07-03)
- Fixed for moveit_msgs/JointLimits.h no such file or directory
0.4.4 (2013-06-26)
Wiki Tutorials
See ROS Wiki Tutorials for more details.
Source Tutorials
Not currently indexed.
Launch files
No launch files found
Messages
No message files found.
Services
No service files found
Plugins
Recent questions tagged moveit_ros_move_group at answers.ros.org
|
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 | No Continuous Integration |
Released | RELEASED |
Tags | No category tags. |
Contributing |
Help Wanted (0)
Good First Issues (0) Pull Requests to Review (0) |
Package Description
The move_group node for MoveIt
Additional Links
Maintainers
- Sachin Chitta
- Ioan Sucan
- Michael Ferguson
Authors
- Ioan Sucan
- Sachin Chitta
README
No README found.
See repository README.
CHANGELOG
Changelog for package moveit_ros_move_group
0.8.7 (2017-04-03)
0.8.6 (2017-03-08)
0.8.4 (2017-02-06)
- [capability] validate trajectory before execution (#63)
- Contributors: Dave Coleman, Isaac I.Y. Saito, Maarten de Vries, Robert Haschke
0.8.3 (2016-08-19)
- Dummy to temporarily workaround https://github.com/ros-infrastructure/catkin_pkg/issues/158#issuecomment-277852080
0.6.6 (2016-06-08)
- added missing validity check iterator found with [configs.find()]{.title-ref} needs to be validated before use...
- Removed trailing whitespace from entire repository
- moved planner params services into existing capability QueryPlannerInterfaces
- capability plugin MoveGroupPlannerParamsService to get/set planner params
- Fixed bug(?) in move_group::MoveGroupKinematicsService::computeIK link name selection.
- Contributors: Dave Coleman, Mihai Pomarlan, Robert Haschke
0.6.5 (2015-01-24)
- update maintainers
- Contributors: Michael Ferguson
0.6.4 (2014-12-20)
0.6.3 (2014-12-03)
0.6.2 (2014-10-31)
- Merge pull request #522 from mikeferguson/indigo-devel add dependency on std_srvs (part of octomap clearing service)
- Contributors: Ioan A Sucan, Michael Ferguson
0.6.1 (2014-10-31)
0.6.0 (2014-10-27)
- Added move_group capability for clearing octomap.
- Contributors: Dave Hershberger, Sachin Chitta
0.5.19 (2014-06-23)
- Address [cppcheck: duplicateIf] error. The same condition was being checked twice, and the same action was being taken.
- Contributors: Adolfo Rodriguez Tsouroukdissian
0.5.18 (2014-03-23)
0.5.17 (2014-03-22)
- update maintainer e-mail
- Contributors: Ioan Sucan
0.5.16 (2014-02-27)
- empty state should be a diff state, otherwise attached objects are deleted
- Contributors: sachinc
0.5.14 (2014-02-06)
0.5.13 (2014-02-06)
0.5.12 (2014-01-03)
0.5.11 (2014-01-03)
0.5.10 (2013-12-08)
0.5.9 (2013-12-03)
- Re-ordered movegroup\'s initialization, so capabilities start after monitors.
- correcting maintainer email
- Added planning feedback to gui, refactored states tab
0.5.8 (2013-10-11)
0.5.7 (2013-10-01)
0.5.6 (2013-09-26)
0.5.5 (2013-09-23)
- porting to new RobotState API
- more console output
0.5.4 (2013-08-14)
- make headers and author definitions aligned the same way; white space fixes
- Dependency for move_group_capabilities_base fixed.
0.5.2 (2013-07-15)
0.5.1 (2013-07-14)
0.5.0 (2013-07-12)
- white space fixes (tabs are now spaces)
- port to new base class for planning_interface (using planning contexts)
0.4.5 (2013-07-03)
- Fixed for moveit_msgs/JointLimits.h no such file or directory
0.4.4 (2013-06-26)
Wiki Tutorials
See ROS Wiki Tutorials for more details.
Source Tutorials
Not currently indexed.
Dependant Packages
Launch files
No launch files found
Messages
No message files found.
Services
No service files found
Plugins
Recent questions tagged moveit_ros_move_group at answers.ros.org
|
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 | No Continuous Integration |
Released | RELEASED |
Tags | No category tags. |
Contributing |
Help Wanted (0)
Good First Issues (0) Pull Requests to Review (0) |
Package Description
The move_group node for MoveIt
Additional Links
Maintainers
- Michael Ferguson
- Michael Görner
- MoveIt! Release Team
Authors
- Ioan Sucan
- Sachin Chitta
README
No README found.
See repository README.
CHANGELOG
Changelog for package moveit_ros_move_group
0.7.14 (2018-10-20)
- [fix] race conditions when updating PlanningScene #350
- Contributors: Michael G
Wiki Tutorials
See ROS Wiki Tutorials for more details.
Source Tutorials
Not currently indexed.
Dependant Packages
Launch files
No launch files found
Messages
No message files found.
Services
No service files found
Plugins
Recent questions tagged moveit_ros_move_group at answers.ros.org
No version for distro hydro. Known supported distros are highlighted in the buttons above.
|
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
The move_group node for MoveIt
Additional Links
Maintainers
- Michael Ferguson
- Michael Görner
- MoveIt! Release Team
Authors
- Ioan Sucan
- Sachin Chitta
README
No README found.
See repository README.
CHANGELOG
Changelog for package moveit_ros_move_group
0.9.18 (2020-01-24)
0.9.17 (2019-07-09)
0.9.16 (2019-06-29)
- [maintanance] Resolve catkin lint issues (#1137)
- [maintanance] Reduce log spamming: list capabilities only once (#1250)
- Contributors: Ludovic Delval, Robert Haschke
0.9.15 (2018-10-29)
0.9.14 (2018-10-24)
0.9.13 (2018-10-24)
- [fix] PlanningSceneMonitor lock #1033: Fix #868 (#1057)
- [maintenance] various compiler warnings (#1038)
- [maintenance] add minimum required pluginlib version (#927)
- Contributors: Mikael Arguedas, Mohmmad Ayman, Robert Haschke, mike lautman
0.9.12 (2018-05-29)
- disable waitForCurrentRobotState() for PlanService capability (#923), fixing (#868)
- Add namespace capabilities to moveit_commander (#835)
- [fix] MoveAction capability can drop cancel request if it is sent shortly after goal is sent (#756)
- Contributors: Dave Coleman, Ian McMahon, Mikael Arguedas, Robert Haschke, Will Baker
0.9.11 (2017-12-25)
0.9.10 (2017-12-09)
- [fix] always return true in MoveGroupPlanService callback #674
- [improve] adding swp\'s to gitignore and removing redundant capabilites from capability_names.h (#704)
- Contributors: Mike Lautman, Shingo Kitagawa
0.9.9 (2017-08-06)
0.9.8 (2017-06-21)
0.9.7 (2017-06-05)
0.9.6 (2017-04-12)
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)
- Contributors: Bence Magyar, Dave Coleman
0.9.4 (2017-02-06)
- [fix] race conditions when updating PlanningScene (#350)
- [maintenance] clang-format upgraded to 3.8 (#367)
- Contributors: Dave Coleman, Robert Haschke
0.9.3 (2016-11-16)
- [maintenance] Updated package.xml maintainers and author emails #330
- Contributors: Dave Coleman, Ian McMahon
0.9.2 (2016-11-05)
0.6.6 (2016-06-08)
- added missing validity check iterator found with [configs.find()]{.title-ref} needs to be validated before use...
- Removed trailing whitespace from entire repository
- moved planner params services into existing capability QueryPlannerInterfaces
- capability plugin MoveGroupPlannerParamsService to get/set planner params
- Fixed bug(?) in move_group::MoveGroupKinematicsService::computeIK link name selection.
- Contributors: Dave Coleman, Mihai Pomarlan, Robert Haschke
0.6.5 (2015-01-24)
- update maintainers
- Contributors: Michael Ferguson
0.6.4 (2014-12-20)
0.6.3 (2014-12-03)
0.6.2 (2014-10-31)
- Merge pull request #522 from mikeferguson/indigo-devel add dependency on std_srvs (part of octomap clearing service)
- Contributors: Ioan A Sucan, Michael Ferguson
0.6.1 (2014-10-31)
0.6.0 (2014-10-27)
- Added move_group capability for clearing octomap.
- Contributors: Dave Hershberger, Sachin Chitta
0.5.19 (2014-06-23)
- Address [cppcheck: duplicateIf] error. The same condition was being checked twice, and the same action was being taken.
- Contributors: Adolfo Rodriguez Tsouroukdissian
0.5.18 (2014-03-23)
0.5.17 (2014-03-22)
- update maintainer e-mail
- Contributors: Ioan Sucan
0.5.16 (2014-02-27)
- empty state should be a diff state, otherwise attached objects are deleted
- Contributors: sachinc
0.5.14 (2014-02-06)
0.5.13 (2014-02-06)
0.5.12 (2014-01-03)
0.5.11 (2014-01-03)
0.5.10 (2013-12-08)
0.5.9 (2013-12-03)
- Re-ordered movegroup\'s initialization, so capabilities start after monitors.
- correcting maintainer email
- Added planning feedback to gui, refactored states tab
0.5.8 (2013-10-11)
0.5.7 (2013-10-01)
0.5.6 (2013-09-26)
0.5.5 (2013-09-23)
- porting to new RobotState API
- more console output
0.5.4 (2013-08-14)
- make headers and author definitions aligned the same way; white space fixes
- Dependency for move_group_capabilities_base fixed.
0.5.2 (2013-07-15)
0.5.1 (2013-07-14)
0.5.0 (2013-07-12)
- white space fixes (tabs are now spaces)
- port to new base class for planning_interface (using planning contexts)
0.4.5 (2013-07-03)
- Fixed for moveit_msgs/JointLimits.h no such file or directory
0.4.4 (2013-06-26)
Wiki Tutorials
See ROS Wiki Tutorials for more details.
Source Tutorials
Not currently indexed.
Dependant Packages
Launch files
No launch files found
Messages
No message files found.
Services
No service files found