|
Package Summary
Tags | No category tags. |
Version | 2.6.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 | 2022-12-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
- Henning Kayser
- Tyler Weaver
- Michael Görner
- MoveIt Release Team
Authors
- Ioan Sucan
- Sachin Chitta
Changelog for package moveit_ros_planning
2.6.0 (2022-11-10)
-
Short-circuit planning adapters (#1694) * Revert \"Planning request adapters: short-circuit if failure, return code rather than bool (#1605)\" This reverts commit 66a64b4a72b6ddef1af2329f20ed8162554d5bcb.
- Add debug message in call stack of planning_request_adapters
- Short-circuit planning request adapters
- Replace if-elseif cascade with switch
- 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
- Fix comment according to review
* Add braces Co-authored-by: Henning Kayser <henningkayser@picknik.ai> * Add braces Co-authored-by: Henning Kayser <henningkayser@picknik.ai> Co-authored-by: Henning Kayser <henningkayser@picknik.ai> Co-authored-by: AndyZe <andyz@utexas.edu>
Fixup for #1420: Restore constness of generatePlan() (#1699)
-
Parallel planning pipelines (#1420)
- Add setTrajectoryConstraints() to PlanningComponent
- Add planning time to PlanningComponent::PlanSolution
- Replace PlanSolution with MotionPlanResponse
- Address review
* Add MultiPipelinePlanRequestParameters Add plan(const MultiPipelinePlanRequestParameters& parameters) Add mutex to avoid segfaults Add optional stop_criterion_callback and solution_selection_callback Remove stop_criterion_callback Make default solution_selection_callback = nullptr Remove parameter handling copy&paste code in favor of a template Add TODO to refactor pushBack() method into insert() Fix selection criteria and add RCLCPP_INFO output Changes due to rebase and formatting Fix race condition and segfault when no solution is found Satisfy clang tidy Remove mutex and thread safety TODOs Add stopping functionality to parallel planning Remove unnecessary TODOs - Fix unused plan solution with failure - Add sanity check for number of parallel planning problems - Check stopping criterion when new solution is generated + make thread safe - Add terminatePlanningPipeline() to MoveItCpp interface - Format! - Bug fixes - Move getShortestSolution callback into own function - No east const - Remove PlanSolutions and make planner_id accessible - Make solution executable - Rename update_last_solution to store_solution - Alphabetize includes and include plan_solutions.hpp instead of .h - Address review - Add missing header
* Apply suggestions from code review Co-authored-by: AndyZe <andyz@utexas.edu> Co-authored-by: AndyZe <andyz@utexas.edu>
-
Fixed typo in deprecation warning in ControllerManager (#1688)
- fixed typo as suggested by \@AndyZe
* Update naming Co-authored-by: AndyZe <andyz@utexas.edu>
-
Planning request adapters: short-circuit if failure, return code rather than bool (#1605)
- Return code rather than bool
- Remove all debug prints
- Small fixup
- Minor cleanup of comment and error handling
- void return from PlannerFn
- Control reaches end of non-void function
- Use a MoveItErrorCode cast
- More efficient callAdapter()
- More MoveItErrorCode
- CI fixup attempt
-
Rename MoveItControllerManager. Add deprecation warning (#1601)
- Rename MoveItControllerManager->Ros2ControlManager. Add deprecation warning.
- Do not rename base class
* Still allow users to load plugins by the old names Co-authored-by: Jafar <jafar.uruc@gmail.com>
Use generate_parameter_library to load kinematics parameters (#1568)
Merge PR #1553: Improve cmake files
Use standard exported targets: export_\${PROJECT_NAME} -> \${PROJECT_NAME}Targets
Improve CMake usage (#1550)
Disable flaky test_servo_singularity + test_rdf_integration (#1530)
Remove sensor manager (#1172)
Removed plan_with_sensing (#1142)
Remove __has_include statements (#1481)
Merge https://github.com/ros-planning/moveit/commit/a63580edd05b01d9480c333645036e5b2b222da9
Default destructor for PlanningComponent (#1470)
trajectory execution manager: reactivate tests (#3177)
-
Clean up TrajectoryExecutionManager API: remove unused code (#3178)
- Clean up unused code
* Add a comment to MIGRATION.md Co-authored-by: Cristian Beltran <cristianbehe@gmail.com>
Merge PR #3172: Fix CI
Load robot_description via planning_context.launch
TrajectoryExecutionManager: Use local LOGNAME instead of member name_ (#3168)
Contributors: Abhijeet Das Gupta, Abishalini Sivaraman, AndyZe, Robert Haschke, Sebastian Jahr, Stephanie Eng, Tyler Weaver, Vatan Aksoy Tezer, abishalini, cambel
2.5.3 (2022-07-28)
2.5.2 (2022-07-18)
- Merge remote-tracking branch \'origin/main\' into feature/msa
- Removing more boost usage (#1372)
- Merge remote-tracking branch \'upstream/main\' into feature/msa
- Removing some boost usage (#1331) Co-authored-by: Vatan Aksoy Tezer <vatan@picknik.ai>
- Remove unnecessary rclcpp.hpp includes (#1333)
- Add missing headers
- MoveItCpp: Allow multiple pipelines
(#3131)
- Fix config of multiple pipelines
- Simply MoveItCpp::getPlanningPipelineNames()
- Merge pull request #3106 from v4hn/pr-master-bind-them-all / banish bind()
- banish bind()
- various: prefer objects and references over pointers
- Contributors: David V. Lu, Henry Moore, Jafar, Jochen Sprickerhof, Michael G
Wiki Tutorials
Source Tutorials
Package Dependencies
System Dependencies
Name |
---|
eigen |
Dependant Packages
Launch files
- launch/collision_checker_compare.launch
-
- visualization [default: false] — turns on and off visualization with rviz
Messages
Services
Plugins
Recent questions tagged moveit_ros_planning at answers.ros.org
|
Package Summary
Tags | No category tags. |
Version | 2.6.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 | 2022-12-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
- Henning Kayser
- Tyler Weaver
- Michael Görner
- MoveIt Release Team
Authors
- Ioan Sucan
- Sachin Chitta
Changelog for package moveit_ros_planning
2.6.0 (2022-11-10)
-
Short-circuit planning adapters (#1694) * Revert \"Planning request adapters: short-circuit if failure, return code rather than bool (#1605)\" This reverts commit 66a64b4a72b6ddef1af2329f20ed8162554d5bcb.
- Add debug message in call stack of planning_request_adapters
- Short-circuit planning request adapters
- Replace if-elseif cascade with switch
- 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
- Fix comment according to review
* Add braces Co-authored-by: Henning Kayser <henningkayser@picknik.ai> * Add braces Co-authored-by: Henning Kayser <henningkayser@picknik.ai> Co-authored-by: Henning Kayser <henningkayser@picknik.ai> Co-authored-by: AndyZe <andyz@utexas.edu>
Fixup for #1420: Restore constness of generatePlan() (#1699)
-
Parallel planning pipelines (#1420)
- Add setTrajectoryConstraints() to PlanningComponent
- Add planning time to PlanningComponent::PlanSolution
- Replace PlanSolution with MotionPlanResponse
- Address review
* Add MultiPipelinePlanRequestParameters Add plan(const MultiPipelinePlanRequestParameters& parameters) Add mutex to avoid segfaults Add optional stop_criterion_callback and solution_selection_callback Remove stop_criterion_callback Make default solution_selection_callback = nullptr Remove parameter handling copy&paste code in favor of a template Add TODO to refactor pushBack() method into insert() Fix selection criteria and add RCLCPP_INFO output Changes due to rebase and formatting Fix race condition and segfault when no solution is found Satisfy clang tidy Remove mutex and thread safety TODOs Add stopping functionality to parallel planning Remove unnecessary TODOs - Fix unused plan solution with failure - Add sanity check for number of parallel planning problems - Check stopping criterion when new solution is generated + make thread safe - Add terminatePlanningPipeline() to MoveItCpp interface - Format! - Bug fixes - Move getShortestSolution callback into own function - No east const - Remove PlanSolutions and make planner_id accessible - Make solution executable - Rename update_last_solution to store_solution - Alphabetize includes and include plan_solutions.hpp instead of .h - Address review - Add missing header
* Apply suggestions from code review Co-authored-by: AndyZe <andyz@utexas.edu> Co-authored-by: AndyZe <andyz@utexas.edu>
-
Fixed typo in deprecation warning in ControllerManager (#1688)
- fixed typo as suggested by \@AndyZe
* Update naming Co-authored-by: AndyZe <andyz@utexas.edu>
-
Planning request adapters: short-circuit if failure, return code rather than bool (#1605)
- Return code rather than bool
- Remove all debug prints
- Small fixup
- Minor cleanup of comment and error handling
- void return from PlannerFn
- Control reaches end of non-void function
- Use a MoveItErrorCode cast
- More efficient callAdapter()
- More MoveItErrorCode
- CI fixup attempt
-
Rename MoveItControllerManager. Add deprecation warning (#1601)
- Rename MoveItControllerManager->Ros2ControlManager. Add deprecation warning.
- Do not rename base class
* Still allow users to load plugins by the old names Co-authored-by: Jafar <jafar.uruc@gmail.com>
Use generate_parameter_library to load kinematics parameters (#1568)
Merge PR #1553: Improve cmake files
Use standard exported targets: export_\${PROJECT_NAME} -> \${PROJECT_NAME}Targets
Improve CMake usage (#1550)
Disable flaky test_servo_singularity + test_rdf_integration (#1530)
Remove sensor manager (#1172)
Removed plan_with_sensing (#1142)
Remove __has_include statements (#1481)
Merge https://github.com/ros-planning/moveit/commit/a63580edd05b01d9480c333645036e5b2b222da9
Default destructor for PlanningComponent (#1470)
trajectory execution manager: reactivate tests (#3177)
-
Clean up TrajectoryExecutionManager API: remove unused code (#3178)
- Clean up unused code
* Add a comment to MIGRATION.md Co-authored-by: Cristian Beltran <cristianbehe@gmail.com>
Merge PR #3172: Fix CI
Load robot_description via planning_context.launch
TrajectoryExecutionManager: Use local LOGNAME instead of member name_ (#3168)
Contributors: Abhijeet Das Gupta, Abishalini Sivaraman, AndyZe, Robert Haschke, Sebastian Jahr, Stephanie Eng, Tyler Weaver, Vatan Aksoy Tezer, abishalini, cambel
2.5.3 (2022-07-28)
2.5.2 (2022-07-18)
- Merge remote-tracking branch \'origin/main\' into feature/msa
- Removing more boost usage (#1372)
- Merge remote-tracking branch \'upstream/main\' into feature/msa
- Removing some boost usage (#1331) Co-authored-by: Vatan Aksoy Tezer <vatan@picknik.ai>
- Remove unnecessary rclcpp.hpp includes (#1333)
- Add missing headers
- MoveItCpp: Allow multiple pipelines
(#3131)
- Fix config of multiple pipelines
- Simply MoveItCpp::getPlanningPipelineNames()
- Merge pull request #3106 from v4hn/pr-master-bind-them-all / banish bind()
- banish bind()
- various: prefer objects and references over pointers
- Contributors: David V. Lu, Henry Moore, Jafar, Jochen Sprickerhof, Michael G
Wiki Tutorials
Source Tutorials
Package Dependencies
System Dependencies
Name |
---|
eigen |
Dependant Packages
Launch files
- launch/collision_checker_compare.launch
-
- visualization [default: false] — turns on and off visualization with rviz
Messages
Services
Plugins
Recent questions tagged moveit_ros_planning at answers.ros.org
|
Package Summary
Tags | No category tags. |
Version | 2.6.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 | 2022-12-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
- Henning Kayser
- Tyler Weaver
- Michael Görner
- MoveIt Release Team
Authors
- Ioan Sucan
- Sachin Chitta
Changelog for package moveit_ros_planning
2.6.0 (2022-11-10)
-
Short-circuit planning adapters (#1694) * Revert \"Planning request adapters: short-circuit if failure, return code rather than bool (#1605)\" This reverts commit 66a64b4a72b6ddef1af2329f20ed8162554d5bcb.
- Add debug message in call stack of planning_request_adapters
- Short-circuit planning request adapters
- Replace if-elseif cascade with switch
- 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
- Fix comment according to review
* Add braces Co-authored-by: Henning Kayser <henningkayser@picknik.ai> * Add braces Co-authored-by: Henning Kayser <henningkayser@picknik.ai> Co-authored-by: Henning Kayser <henningkayser@picknik.ai> Co-authored-by: AndyZe <andyz@utexas.edu>
Fixup for #1420: Restore constness of generatePlan() (#1699)
-
Parallel planning pipelines (#1420)
- Add setTrajectoryConstraints() to PlanningComponent
- Add planning time to PlanningComponent::PlanSolution
- Replace PlanSolution with MotionPlanResponse
- Address review
* Add MultiPipelinePlanRequestParameters Add plan(const MultiPipelinePlanRequestParameters& parameters) Add mutex to avoid segfaults Add optional stop_criterion_callback and solution_selection_callback Remove stop_criterion_callback Make default solution_selection_callback = nullptr Remove parameter handling copy&paste code in favor of a template Add TODO to refactor pushBack() method into insert() Fix selection criteria and add RCLCPP_INFO output Changes due to rebase and formatting Fix race condition and segfault when no solution is found Satisfy clang tidy Remove mutex and thread safety TODOs Add stopping functionality to parallel planning Remove unnecessary TODOs - Fix unused plan solution with failure - Add sanity check for number of parallel planning problems - Check stopping criterion when new solution is generated + make thread safe - Add terminatePlanningPipeline() to MoveItCpp interface - Format! - Bug fixes - Move getShortestSolution callback into own function - No east const - Remove PlanSolutions and make planner_id accessible - Make solution executable - Rename update_last_solution to store_solution - Alphabetize includes and include plan_solutions.hpp instead of .h - Address review - Add missing header
* Apply suggestions from code review Co-authored-by: AndyZe <andyz@utexas.edu> Co-authored-by: AndyZe <andyz@utexas.edu>
-
Fixed typo in deprecation warning in ControllerManager (#1688)
- fixed typo as suggested by \@AndyZe
* Update naming Co-authored-by: AndyZe <andyz@utexas.edu>
-
Planning request adapters: short-circuit if failure, return code rather than bool (#1605)
- Return code rather than bool
- Remove all debug prints
- Small fixup
- Minor cleanup of comment and error handling
- void return from PlannerFn
- Control reaches end of non-void function
- Use a MoveItErrorCode cast
- More efficient callAdapter()
- More MoveItErrorCode
- CI fixup attempt
-
Rename MoveItControllerManager. Add deprecation warning (#1601)
- Rename MoveItControllerManager->Ros2ControlManager. Add deprecation warning.
- Do not rename base class
* Still allow users to load plugins by the old names Co-authored-by: Jafar <jafar.uruc@gmail.com>
Use generate_parameter_library to load kinematics parameters (#1568)
Merge PR #1553: Improve cmake files
Use standard exported targets: export_\${PROJECT_NAME} -> \${PROJECT_NAME}Targets
Improve CMake usage (#1550)
Disable flaky test_servo_singularity + test_rdf_integration (#1530)
Remove sensor manager (#1172)
Removed plan_with_sensing (#1142)
Remove __has_include statements (#1481)
Merge https://github.com/ros-planning/moveit/commit/a63580edd05b01d9480c333645036e5b2b222da9
Default destructor for PlanningComponent (#1470)
trajectory execution manager: reactivate tests (#3177)
-
Clean up TrajectoryExecutionManager API: remove unused code (#3178)
- Clean up unused code
* Add a comment to MIGRATION.md Co-authored-by: Cristian Beltran <cristianbehe@gmail.com>
Merge PR #3172: Fix CI
Load robot_description via planning_context.launch
TrajectoryExecutionManager: Use local LOGNAME instead of member name_ (#3168)
Contributors: Abhijeet Das Gupta, Abishalini Sivaraman, AndyZe, Robert Haschke, Sebastian Jahr, Stephanie Eng, Tyler Weaver, Vatan Aksoy Tezer, abishalini, cambel
2.5.3 (2022-07-28)
2.5.2 (2022-07-18)
- Merge remote-tracking branch \'origin/main\' into feature/msa
- Removing more boost usage (#1372)
- Merge remote-tracking branch \'upstream/main\' into feature/msa
- Removing some boost usage (#1331) Co-authored-by: Vatan Aksoy Tezer <vatan@picknik.ai>
- Remove unnecessary rclcpp.hpp includes (#1333)
- Add missing headers
- MoveItCpp: Allow multiple pipelines
(#3131)
- Fix config of multiple pipelines
- Simply MoveItCpp::getPlanningPipelineNames()
- Merge pull request #3106 from v4hn/pr-master-bind-them-all / banish bind()
- banish bind()
- various: prefer objects and references over pointers
- Contributors: David V. Lu, Henry Moore, Jafar, Jochen Sprickerhof, Michael G
Wiki Tutorials
Source Tutorials
Package Dependencies
System Dependencies
Name |
---|
eigen |
Dependant Packages
Launch files
- launch/collision_checker_compare.launch
-
- visualization [default: false] — turns on and off visualization with rviz
Messages
Services
Plugins
Recent questions tagged moveit_ros_planning at answers.ros.org
|
Package Summary
Tags | No category tags. |
Version | 1.1.11 |
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 | 2022-12-21 |
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
- Sachin Chitta
Changelog for package moveit_ros_planning
1.1.11 (2022-12-21)
- Backport ruckig trajectory_processing plugin (#2902)
- Allow planning with multiple pipelines in parallel with moveit_cpp (#3244)
- 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\_
- 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
- Short-circuit planning request adapters
- Contributors: Robert Haschke, Simon Schmeisser
1.1.10 (2022-09-13)
Wiki Tutorials
Source Tutorials
Package Dependencies
System Dependencies
Name |
---|
eigen |
Dependant Packages
Launch files
- launch/collision_checker_compare.launch
-
- visualization [default: false] — turns on and off visualization with rviz
Messages
Services
Plugins
Recent questions tagged moveit_ros_planning 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
Additional Links
Maintainers
- Michael Ferguson
- Michael Görner
- MoveIt! Release Team
Authors
- Ioan Sucan
- Sachin Chitta
Changelog for package moveit_ros_planning
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)
- Unify and simplify CSM::haveCompleteState overloads (#2663)
- FixStartStateBounds: Copy attached bodies when adapting the start state (#2398)
- PlanExecution: Correctly handle preempt-requested flag (#2554)
- thread safety in clear octomap & only update geometry (#2500)
- Fix some typos in comments (#2466)
- Simplify logic in PSM (#2632) (#2637)
- Contributors: Jafar Abdi, Michael G
Wiki Tutorials
Source Tutorials
Package Dependencies
System Dependencies
Name |
---|
eigen |
Dependant Packages
Launch files
Messages
Services
Plugins
Recent questions tagged moveit_ros_planning 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
- Sachin Chitta
Changelog for package moveit_ros_planning
2.0.0 (2020-02-17)
- [fix] Fix double node executor exceptions
- [fix] PlanningSceneMonitor: Fix double executor exception for service call
- [sys] Fix export of moveit_ros_planning dependencies
- [improve] Support passing parameter subnamespace in PlanningPipeline
- [improve] Load planning request adapter parameters from subnamespace
- [fix] Fix parameter lookup: kinematics_plugin_loader
- [fix] Fix moveit_ros_visualization (#167)
- [fix] rdf_loader: Fix parameter lookup
- [port] Port moveit_cpp to ROS 2 (#163)
- [port] Port plan_execution to ROS 2 (#111)
- [fix] trajectory_execution_manager: Make library shared
- [fix] planning_pipeline: Make library shared
- [port] Port planning_components_tools to ROS 2 (#149)
- [port] Port moveit ros visualization to ROS 2 (#160)
- [sys] moveit_ros_planning: Fix export dependencies
- [port] Port moveit_simple_controller_manager to ROS 2 (#158)
- [fix] Fix and compile planning_pipeline (#162)
- [port] Port trajectory_execution_manager to ROS2 (#110)
- [fix] Fix linking issue in planning_scene_monitor (#161)
- [port] Port planning_scene_monitor to ROS2 (#112)
- [sys] Re-enable moveit_ros_planning (#144)
- [sys] Comment moveit_ros_occupancy_map_monitor as depend
- [sys] Upgrade to ROS 2 Eloquent (#152)
- [sys] Fix CMakeLists.txt files for Eloquent
- [port] Port collision_plugin_loader to ROS 2 (#137)
- [improve] Pass node to KinematicsBase initialization (#145)
- [sys] Fix docker images (#139)
- [sys] COLCON_IGNORE moveit_ros_planning
- [port] Port robot_model_loader to ROS2 (#109)
- [port] Port constraint_sampler_manager_loader to ROS2 (#113)
- [port] Port kinematics_plugin_loader to ROS2
(#107)
- Update CMakeLists.txt
- Update parameter resolution
- Update logger
- [port] Port planning_request_adapter_plugins to ROS2 (#114)
- [improve] Initialize parameters from node
- [sys] Export plugin description file in new way
- [fix] Fix warnings
- [sys] Enable planning_request_adapter_plugins for colcon build
- [port] Migrate to ROS 2 Logger
- [sys] Update CMakeLists.txt
- [port] Port planning_request_adapter_plugins to ROS 2
- [port] Port rdf_loader to ROS2 (#104)
- Contributors: Henning Kayser, Jafar Abdi, Robert Haschke, Yu Yan, V
Wiki Tutorials
Source Tutorials
Package Dependencies
System Dependencies
Name |
---|
eigen |
Dependant Packages
Launch files
- launch/collision_checker_compare.launch
-
- visualization [default: false] — turns on and off visualization with rviz
Messages
Services
Plugins
Recent questions tagged moveit_ros_planning at answers.ros.org
|
Package Summary
Tags | No category tags. |
Version | 2.6.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 | 2022-12-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
- Henning Kayser
- Tyler Weaver
- Michael Görner
- MoveIt Release Team
Authors
- Ioan Sucan
- Sachin Chitta
Changelog for package moveit_ros_planning
2.6.0 (2022-11-10)
-
Short-circuit planning adapters (#1694) * Revert \"Planning request adapters: short-circuit if failure, return code rather than bool (#1605)\" This reverts commit 66a64b4a72b6ddef1af2329f20ed8162554d5bcb.
- Add debug message in call stack of planning_request_adapters
- Short-circuit planning request adapters
- Replace if-elseif cascade with switch
- 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
- Fix comment according to review
* Add braces Co-authored-by: Henning Kayser <henningkayser@picknik.ai> * Add braces Co-authored-by: Henning Kayser <henningkayser@picknik.ai> Co-authored-by: Henning Kayser <henningkayser@picknik.ai> Co-authored-by: AndyZe <andyz@utexas.edu>
Fixup for #1420: Restore constness of generatePlan() (#1699)
-
Parallel planning pipelines (#1420)
- Add setTrajectoryConstraints() to PlanningComponent
- Add planning time to PlanningComponent::PlanSolution
- Replace PlanSolution with MotionPlanResponse
- Address review
* Add MultiPipelinePlanRequestParameters Add plan(const MultiPipelinePlanRequestParameters& parameters) Add mutex to avoid segfaults Add optional stop_criterion_callback and solution_selection_callback Remove stop_criterion_callback Make default solution_selection_callback = nullptr Remove parameter handling copy&paste code in favor of a template Add TODO to refactor pushBack() method into insert() Fix selection criteria and add RCLCPP_INFO output Changes due to rebase and formatting Fix race condition and segfault when no solution is found Satisfy clang tidy Remove mutex and thread safety TODOs Add stopping functionality to parallel planning Remove unnecessary TODOs - Fix unused plan solution with failure - Add sanity check for number of parallel planning problems - Check stopping criterion when new solution is generated + make thread safe - Add terminatePlanningPipeline() to MoveItCpp interface - Format! - Bug fixes - Move getShortestSolution callback into own function - No east const - Remove PlanSolutions and make planner_id accessible - Make solution executable - Rename update_last_solution to store_solution - Alphabetize includes and include plan_solutions.hpp instead of .h - Address review - Add missing header
* Apply suggestions from code review Co-authored-by: AndyZe <andyz@utexas.edu> Co-authored-by: AndyZe <andyz@utexas.edu>
-
Fixed typo in deprecation warning in ControllerManager (#1688)
- fixed typo as suggested by \@AndyZe
* Update naming Co-authored-by: AndyZe <andyz@utexas.edu>
-
Planning request adapters: short-circuit if failure, return code rather than bool (#1605)
- Return code rather than bool
- Remove all debug prints
- Small fixup
- Minor cleanup of comment and error handling
- void return from PlannerFn
- Control reaches end of non-void function
- Use a MoveItErrorCode cast
- More efficient callAdapter()
- More MoveItErrorCode
- CI fixup attempt
-
Rename MoveItControllerManager. Add deprecation warning (#1601)
- Rename MoveItControllerManager->Ros2ControlManager. Add deprecation warning.
- Do not rename base class
* Still allow users to load plugins by the old names Co-authored-by: Jafar <jafar.uruc@gmail.com>
Use generate_parameter_library to load kinematics parameters (#1568)
Merge PR #1553: Improve cmake files
Use standard exported targets: export_\${PROJECT_NAME} -> \${PROJECT_NAME}Targets
Improve CMake usage (#1550)
Disable flaky test_servo_singularity + test_rdf_integration (#1530)
Remove sensor manager (#1172)
Removed plan_with_sensing (#1142)
Remove __has_include statements (#1481)
Merge https://github.com/ros-planning/moveit/commit/a63580edd05b01d9480c333645036e5b2b222da9
Default destructor for PlanningComponent (#1470)
trajectory execution manager: reactivate tests (#3177)
-
Clean up TrajectoryExecutionManager API: remove unused code (#3178)
- Clean up unused code
* Add a comment to MIGRATION.md Co-authored-by: Cristian Beltran <cristianbehe@gmail.com>
Merge PR #3172: Fix CI
Load robot_description via planning_context.launch
TrajectoryExecutionManager: Use local LOGNAME instead of member name_ (#3168)
Contributors: Abhijeet Das Gupta, Abishalini Sivaraman, AndyZe, Robert Haschke, Sebastian Jahr, Stephanie Eng, Tyler Weaver, Vatan Aksoy Tezer, abishalini, cambel
2.5.3 (2022-07-28)
2.5.2 (2022-07-18)
- Merge remote-tracking branch \'origin/main\' into feature/msa
- Removing more boost usage (#1372)
- Merge remote-tracking branch \'upstream/main\' into feature/msa
- Removing some boost usage (#1331) Co-authored-by: Vatan Aksoy Tezer <vatan@picknik.ai>
- Remove unnecessary rclcpp.hpp includes (#1333)
- Add missing headers
- MoveItCpp: Allow multiple pipelines
(#3131)
- Fix config of multiple pipelines
- Simply MoveItCpp::getPlanningPipelineNames()
- Merge pull request #3106 from v4hn/pr-master-bind-them-all / banish bind()
- banish bind()
- various: prefer objects and references over pointers
- Contributors: David V. Lu, Henry Moore, Jafar, Jochen Sprickerhof, Michael G
Wiki Tutorials
Source Tutorials
Package Dependencies
System Dependencies
Name |
---|
eigen |
Dependant Packages
Launch files
- launch/collision_checker_compare.launch
-
- visualization [default: false] — turns on and off visualization with rviz
Messages
Services
Plugins
Recent questions tagged moveit_ros_planning 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
- Sachin Chitta
Changelog for package moveit_ros_planning
0.9.18 (2020-01-24)
0.9.17 (2019-07-09)
0.9.16 (2019-06-29)
- [maintanance] Cleanup Chomp packages (#1282)
- [maintanance] Disable (unused) dependencies (#1256)
- [maintanance] Resolve catkin lint issues (#1137)
- [maintanance] Improve clang-format (#1214)
- [maintanance] Change dynamic reconfigure limits for allowed_goal_duration_margin to 30s (#993)
- [fix] Use correct trajectory_initialization_method param (#1237)
- Contributors: Hamal Marino, Ludovic Delval, Michael G
Wiki Tutorials
Source Tutorials
Package Dependencies
System Dependencies
Name |
---|
eigen |
Dependant Packages
Launch files
Messages
Services
Plugins
Recent questions tagged moveit_ros_planning 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
- Sachin Chitta
- Ioan Sucan
- Michael Ferguson
Authors
- Ioan Sucan
- Sachin Chitta
Changelog for package moveit_ros_planning
0.6.6 (2016-06-08)
- Add library moveit_collision_plugin_loader as an exported catkin library (#678)
- replaced cmake_modules dependency with eigen
- [jade] eigen3 adjustment
- Fix compilation with C++11.
- Enable optional build against Qt5, use -DUseQt5=On to enable it
- merge indigo-devel changes (PR #633 trailing whitespace) into jade-devel
- Removed trailing whitespace from entire repository
- Optional ability to copy velocity and effort to RobotState
- cherry-picked PR #614 fixed segfault on shutdown
- fixed segfault on shutdown use of pluginlib\'s createUnmanagedInstance() is strongly discouraged: http://wiki.ros.org/class_loader#Understanding_Loading_and_Unloading here, the kinematics plugin libs were unloaded before destruction of corresponding pointers
- Deprecate shape_tools
- CurrentStateMonitor no longer requires hearing mimic joint state values.
- Fix crash due to robot state not getting updated (moveit_ros #559)
- Contributors: Dave Coleman, Dave Hershberger, Isaac I.Y. Saito, Levi Armstrong, Maarten de Vries, Robert Haschke, Simon Schmeisser (isys vision), kohlbrecher
0.6.5 (2015-01-24)
- update maintainers
- perception: adding RAII-based locking for OccMapTree
- perception: adding locks to planning scene monitor
- Add time factor support for iterative_time_parametrization
- Contributors: Jonathan Bohren, Michael Ferguson, kohlbrecher
0.6.4 (2014-12-20)
- Namespaced \"traj_execution\" for all trajectory_execution_manager logging
- planning_scene_monitor: add ros parameter for adding a wait-for-transform lookup time fixes #465
- Contributors: Dave Coleman, Jonathan Bohren
0.6.3 (2014-12-03)
- add plugin interface for collision detectors
- fix missing return value
- trivial fixes for warnings
- Contributors: Michael Ferguson
0.6.2 (2014-10-31)
0.6.1 (2014-10-31)
- re-add libqt4 dependency (previously came from pcl-all)
- Contributors: Michael Ferguson
0.6.0 (2014-10-27)
- Removed leadings slash from rosparam for robot padding
- Added move_group capability for clearing octomap.
- Made loading octomap_monitor optional in planning_scene_monitor when using WorldGeometryMonitor
- Contributors: Dave Coleman, Dave Hershberger, Sachin Chitta, ahb
0.5.19 (2014-06-23)
- Updated doxygen comment in TrajectoryExecutionManager.
- Added more informative error message text when cant\' find controllers.
- robot_model_loader.cpp: added call to KinematicsBase::supportsGroup().
- Fix [-Wreorder] warning.
- Fix broken log & output statements.
- Address [cppcheck: coutCerrMisusage] and [-Werror=format-extra-args] errors.
- ROS_ERROR -> ROS_ERROR_NAMED.
- Print size_t values portably.
- Address [-Wreturn-type] warning.
- Address [cppcheck: postfixOperator] warning.
- Address [cppcheck: duplicateIf] error. The same condition was being checked twice, and the same action was being taken.
- Add check for planning scene monitor connection, with 5 sec delay
- Fix for building srv_kinematics_plugin
- New ROS service call-based IK plugin
- Allow planning groups to have more than one tip
- Contributors: Adolfo Rodriguez Tsouroukdissian, Dave Coleman, Dave Hershberger
0.5.18 (2014-03-23)
0.5.17 (2014-03-22)
- update build system for ROS indigo
- update maintainer e-mail
- Namespace a debug message
- Minor non-functional changes to KDL
- Contributors: Dave Coleman, Ioan Sucan
0.5.16 (2014-02-27)
- Copy paste error fix
- Contributors: fivef
0.5.14 (2014-02-06)
0.5.13 (2014-02-06)
- remove debug printfs
- planning_scene_monitor: add requestPlanningSceneState()
- planning_scene_monitor: fix race condition
- planning_scene_monitor: fix state update bug The rate of state updates is limited to dt_state_update per second. When an update arrived it was not processed if another was recently processed. This meant that if a quick sequence of state updates arrived and then no updates arrive for a while that the last update(s) were not seen until another arrives (which may be much later or never). This fixes the bug by periodically checking for pending updates and running them if they have been pending longer than dt_state_update.
- add default_robot_link_padding/scale, set padding/scale value for each robot link, see https://github.com/ros-planning/moveit_ros/issues/402
- fix LockedPlanningSceneRW docs fix the text that was originally copied from another class (from LockedPlanningSceneRO) it mentioned an incorrect return value type of LockedPlanningSceneRW::operator->()
- Contributors: Acorn Pooley, Filip Jares, Kei Okada
0.5.12 (2014-01-03)
- Fixed trailing underscores in CHANGELOGs.
- Contributors: Dave Hershberger
0.5.11 (2014-01-03)
- planning_scene_monitor: slight code simplification
- planning_scene_monitor: fix scope of local vars
- planning_scene_monitor: fix init bug scene_const_ not set if scene passed to constructor.
- kdl_kinematics_plugin: fix warning
- Contributors: Acorn Pooley
0.5.10 (2013-12-08)
- fixing how joint names are filled up, fixed joints were getting included earlier, also resizing consistency limits for when random positions near by function is being called
- Contributors: Sachin Chitta
0.5.9 (2013-12-03)
- Doxygen: added warnings and details to planning_scene_monitor.h
- correcting maintainer email
- remove duplicate header
- Fixed exported targets
- Fixed dependency issue
- fixing joint limits setup for mimic joints
- implement feature requests
- clear monitored octomap when needed (see #315)
- fix the adapter for fixing path constraints for initial states
- fixed computation of dimension_.
- bugfixes in indexing added states for path adapters
- fixes for mimic joints and redundant joints
0.5.8 (2013-10-11)
- add executable for publishing scene geometry from text
- Made the goal duration margin and scaling optional rosparameters
- bugfixes
0.5.7 (2013-10-01)
0.5.6 (2013-09-26)
0.5.5 (2013-09-23)
- fix the event triggered on updating attached objects
- make scene monitor trigger updates only when needed
- fix loading of default params
- port to new RobotState API, new messages
- make sure we do not overwrite attached bodies, when updating the current state
- fix #308
- fix #304
- fix issue with sending trajectories for passive/mimic/fixed joints
- pass effort along
0.5.4 (2013-08-14)
- 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
- move background_processing lib to core
- add option to disable trajectory monitoring
0.5.2 (2013-07-15)
0.5.1 (2013-07-14)
0.5.0 (2013-07-12)
- minor doc fixes
- add docs for planning pipeline
- cleanup build system
- fixing approximate ik calculation
- white space fixes (tabs are now spaces)
- adding check for approximate solution flag
- adding options struct to kinematics base
- port to new base class for planning_interface (using planning contexts)
0.4.5 (2013-07-03)
- Namespaced ROS* log messages for better debug fitering - added \'kdl\' namespace
- remove dep
- make searchPositionIK actually const, and thread-safe
- Made debug output look better
0.4.4 (2013-06-26)
Wiki Tutorials
Source Tutorials
Package Dependencies
Deps | Name | |
---|---|---|
3 | moveit_core | |
3 | moveit_ros_perception | |
1 | pluginlib | |
1 | actionlib | |
1 | dynamic_reconfigure | |
1 | angles | |
1 | catkin |
System Dependencies
Name |
---|
eigen |
Dependant Packages
Launch files
Messages
Services
Plugins
Recent questions tagged moveit_ros_planning 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
- Sachin Chitta
- Ioan Sucan
- Michael Ferguson
Authors
- Ioan Sucan
- Sachin Chitta
Changelog for package moveit_ros_planning
0.7.2 (2016-06-20)
- apply planning scene: use newly exposed success value of newPlanningSceneMessage
- simplify newPlanningSceneMessage
- monitor: make newPlanningSceneMessage public This is required for capabilities to update the planning scene. ABI-compatible.
- Add library moveit_collision_plugin_loader as an exported catkin library (#677)
- Contributors: Levi Armstrong, v4hn
0.7.1 (2016-04-11)
- Adding acceleration scaling factor
- Contributors: hemes
0.7.0 (2016-01-30)
- Removed trailing whitespace from entire repository
- fixed segfault on shutdown use of pluginlib\'s createUnmanagedInstance() is strongly discouraged: http://wiki.ros.org/class_loader#Understanding_Loading_and_Unloading here, the kinematics plugin libs were unloaded before destruction of corresponding pointers
- Deprecate shape_tools
- CurrentStateMonitor no longer requires hearing mimic joint state values.
- Fix crash due to robot state not getting updated (moveit_ros #559)
- Contributors: Dave Coleman, Dave Hershberger, Robert Haschke, kohlbrecher
0.6.5 (2015-01-24)
- update maintainers
- perception: adding RAII-based locking for OccMapTree
- perception: adding locks to planning scene monitor
- Add time factor support for iterative_time_parametrization
- Contributors: Jonathan Bohren, Michael Ferguson, kohlbrecher
0.6.4 (2014-12-20)
- Namespaced \"traj_execution\" for all trajectory_execution_manager logging
- planning_scene_monitor: add ros parameter for adding a wait-for-transform lookup time fixes #465
- Contributors: Dave Coleman, Jonathan Bohren
0.6.3 (2014-12-03)
- add plugin interface for collision detectors
- fix missing return value
- trivial fixes for warnings
- Contributors: Michael Ferguson
0.6.2 (2014-10-31)
0.6.1 (2014-10-31)
- re-add libqt4 dependency (previously came from pcl-all)
- Contributors: Michael Ferguson
0.6.0 (2014-10-27)
- Removed leadings slash from rosparam for robot padding
- Added move_group capability for clearing octomap.
- Made loading octomap_monitor optional in planning_scene_monitor when using WorldGeometryMonitor
- Contributors: Dave Coleman, Dave Hershberger, Sachin Chitta, ahb
0.5.19 (2014-06-23)
- Updated doxygen comment in TrajectoryExecutionManager.
- Added more informative error message text when cant\' find controllers.
- robot_model_loader.cpp: added call to KinematicsBase::supportsGroup().
- Fix [-Wreorder] warning.
- Fix broken log & output statements.
- Address [cppcheck: coutCerrMisusage] and [-Werror=format-extra-args] errors.
- ROS_ERROR -> ROS_ERROR_NAMED.
- Print size_t values portably.
- Address [-Wreturn-type] warning.
- Address [cppcheck: postfixOperator] warning.
- Address [cppcheck: duplicateIf] error. The same condition was being checked twice, and the same action was being taken.
- Add check for planning scene monitor connection, with 5 sec delay
- Fix for building srv_kinematics_plugin
- New ROS service call-based IK plugin
- Allow planning groups to have more than one tip
- Contributors: Adolfo Rodriguez Tsouroukdissian, Dave Coleman, Dave Hershberger
0.5.18 (2014-03-23)
0.5.17 (2014-03-22)
- update build system for ROS indigo
- update maintainer e-mail
- Namespace a debug message
- Minor non-functional changes to KDL
- Contributors: Dave Coleman, Ioan Sucan
0.5.16 (2014-02-27)
- Copy paste error fix
- Contributors: fivef
0.5.14 (2014-02-06)
0.5.13 (2014-02-06)
- remove debug printfs
- planning_scene_monitor: add requestPlanningSceneState()
- planning_scene_monitor: fix race condition
- planning_scene_monitor: fix state update bug The rate of state updates is limited to dt_state_update per second. When an update arrived it was not processed if another was recently processed. This meant that if a quick sequence of state updates arrived and then no updates arrive for a while that the last update(s) were not seen until another arrives (which may be much later or never). This fixes the bug by periodically checking for pending updates and running them if they have been pending longer than dt_state_update.
- add default_robot_link_padding/scale, set padding/scale value for each robot link, see https://github.com/ros-planning/moveit_ros/issues/402
- fix LockedPlanningSceneRW docs fix the text that was originally copied from another class (from LockedPlanningSceneRO) it mentioned an incorrect return value type of LockedPlanningSceneRW::operator->()
- Contributors: Acorn Pooley, Filip Jares, Kei Okada
0.5.12 (2014-01-03)
- Fixed trailing underscores in CHANGELOGs.
- Contributors: Dave Hershberger
0.5.11 (2014-01-03)
- planning_scene_monitor: slight code simplification
- planning_scene_monitor: fix scope of local vars
- planning_scene_monitor: fix init bug scene_const_ not set if scene passed to constructor.
- kdl_kinematics_plugin: fix warning
- Contributors: Acorn Pooley
0.5.10 (2013-12-08)
- fixing how joint names are filled up, fixed joints were getting included earlier, also resizing consistency limits for when random positions near by function is being called
- Contributors: Sachin Chitta
0.5.9 (2013-12-03)
- Doxygen: added warnings and details to planning_scene_monitor.h
- correcting maintainer email
- remove duplicate header
- Fixed exported targets
- Fixed dependency issue
- fixing joint limits setup for mimic joints
- implement feature requests
- clear monitored octomap when needed (see #315)
- fix the adapter for fixing path constraints for initial states
- fixed computation of dimension_.
- bugfixes in indexing added states for path adapters
- fixes for mimic joints and redundant joints
0.5.8 (2013-10-11)
- add executable for publishing scene geometry from text
- Made the goal duration margin and scaling optional rosparameters
- bugfixes
0.5.7 (2013-10-01)
0.5.6 (2013-09-26)
0.5.5 (2013-09-23)
- fix the event triggered on updating attached objects
- make scene monitor trigger updates only when needed
- fix loading of default params
- port to new RobotState API, new messages
- make sure we do not overwrite attached bodies, when updating the current state
- fix #308
- fix #304
- fix issue with sending trajectories for passive/mimic/fixed joints
- pass effort along
0.5.4 (2013-08-14)
- 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
- move background_processing lib to core
- add option to disable trajectory monitoring
0.5.2 (2013-07-15)
0.5.1 (2013-07-14)
0.5.0 (2013-07-12)
- minor doc fixes
- add docs for planning pipeline
- cleanup build system
- fixing approximate ik calculation
- white space fixes (tabs are now spaces)
- adding check for approximate solution flag
- adding options struct to kinematics base
- port to new base class for planning_interface (using planning contexts)
0.4.5 (2013-07-03)
- Namespaced ROS* log messages for better debug fitering - added \'kdl\' namespace
- remove dep
- make searchPositionIK actually const, and thread-safe
- Made debug output look better
0.4.4 (2013-06-26)
Wiki Tutorials
Source Tutorials
Package Dependencies
Deps | Name | |
---|---|---|
3 | moveit_core | |
3 | moveit_ros_perception | |
1 | pluginlib | |
1 | actionlib | |
1 | dynamic_reconfigure | |
1 | angles | |
1 | cmake_modules | |
1 | catkin |
System Dependencies
Name |
---|
libqt4-dev |
libqt4 |
Dependant Packages
Launch files
Messages
Services
Plugins
Recent questions tagged moveit_ros_planning 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
- Sachin Chitta
- Ioan Sucan
Authors
- Ioan Sucan
- Sachin Chitta
Changelog for package moveit_ros_planning
0.5.20 (2014-12-09)
- Made loading octomap_monitor optional in planning_scene_monitor when using WorldGeometryMonitor
- remove leading \'/\' from DEFAULT_PLANNING_SCENE_SERVICE; otherwise planning_scene_rviz_plugin fails with \'Failed to call service /get_planning_scene ...\' if move_group is in a namespace different from \'/\'
- Made loading octomap_monitor optional in planning_scene_monitor when using WorldGeometryMonitor
- service must have access to global namespace
- Added capability to set max_planning_attempts in GUI. Parallel planner now plans until either the planning_time is reached or until max_planning_attempts are successfull.
- Contributors: Chris Lewis, Dave Coleman, Sachin Chitta, ahb
0.5.19 (2014-06-23)
- Updated doxygen comment in TrajectoryExecutionManager.
- Added more informative error message text when cant\' find controllers.
- robot_model_loader.cpp: added call to KinematicsBase::supportsGroup().
- Fix [-Wreorder] warning.
- Fix broken log & output statements.
- Address [cppcheck: coutCerrMisusage] and [-Werror=format-extra-args] errors.
- ROS_ERROR -> ROS_ERROR_NAMED.
- Print size_t values portably.
- Address [-Wreturn-type] warning.
- Address [cppcheck: postfixOperator] warning.
- Address [cppcheck: duplicateIf] error. The same condition was being checked twice, and the same action was being taken.
- Add check for planning scene monitor connection, with 5 sec delay
- Fix for building srv_kinematics_plugin
- New ROS service call-based IK plugin
- Allow planning groups to have more than one tip
- Contributors: Adolfo Rodriguez Tsouroukdissian, Dave Coleman, Dave Hershberger
0.5.18 (2014-03-23)
0.5.17 (2014-03-22)
- update build system for ROS indigo
- update maintainer e-mail
- Namespace a debug message
- Minor non-functional changes to KDL
- Contributors: Dave Coleman, Ioan Sucan
0.5.16 (2014-02-27)
- Copy paste error fix
- Contributors: fivef
0.5.14 (2014-02-06)
0.5.13 (2014-02-06)
- remove debug printfs
- planning_scene_monitor: add requestPlanningSceneState()
- planning_scene_monitor: fix race condition
- planning_scene_monitor: fix state update bug The rate of state updates is limited to dt_state_update per second. When an update arrived it was not processed if another was recently processed. This meant that if a quick sequence of state updates arrived and then no updates arrive for a while that the last update(s) were not seen until another arrives (which may be much later or never). This fixes the bug by periodically checking for pending updates and running them if they have been pending longer than dt_state_update.
- add default_robot_link_padding/scale, set padding/scale value for each robot link, see https://github.com/ros-planning/moveit_ros/issues/402
- fix LockedPlanningSceneRW docs fix the text that was originally copied from another class (from LockedPlanningSceneRO) it mentioned an incorrect return value type of LockedPlanningSceneRW::operator->()
- Contributors: Acorn Pooley, Filip Jares, Kei Okada
0.5.12 (2014-01-03)
- Fixed trailing underscores in CHANGELOGs.
- Contributors: Dave Hershberger
0.5.11 (2014-01-03)
- planning_scene_monitor: slight code simplification
- planning_scene_monitor: fix scope of local vars
- planning_scene_monitor: fix init bug scene_const_ not set if scene passed to constructor.
- kdl_kinematics_plugin: fix warning
- Contributors: Acorn Pooley
0.5.10 (2013-12-08)
- fixing how joint names are filled up, fixed joints were getting included earlier, also resizing consistency limits for when random positions near by function is being called
- Contributors: Sachin Chitta
0.5.9 (2013-12-03)
- Doxygen: added warnings and details to planning_scene_monitor.h
- correcting maintainer email
- remove duplicate header
- Fixed exported targets
- Fixed dependency issue
- fixing joint limits setup for mimic joints
- implement feature requests
- clear monitored octomap when needed (see #315)
- fix the adapter for fixing path constraints for initial states
- fixed computation of dimension_.
- bugfixes in indexing added states for path adapters
- fixes for mimic joints and redundant joints
0.5.8 (2013-10-11)
- add executable for publishing scene geometry from text
- Made the goal duration margin and scaling optional rosparameters
- bugfixes
0.5.7 (2013-10-01)
0.5.6 (2013-09-26)
0.5.5 (2013-09-23)
- fix the event triggered on updating attached objects
- make scene monitor trigger updates only when needed
- fix loading of default params
- port to new RobotState API, new messages
- make sure we do not overwrite attached bodies, when updating the current state
- fix #308
- fix #304
- fix issue with sending trajectories for passive/mimic/fixed joints
- pass effort along
0.5.4 (2013-08-14)
- 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
- move background_processing lib to core
- add option to disable trajectory monitoring
0.5.2 (2013-07-15)
0.5.1 (2013-07-14)
0.5.0 (2013-07-12)
- minor doc fixes
- add docs for planning pipeline
- cleanup build system
- fixing approximate ik calculation
- white space fixes (tabs are now spaces)
- adding check for approximate solution flag
- adding options struct to kinematics base
- port to new base class for planning_interface (using planning contexts)
0.4.5 (2013-07-03)
- Namespaced ROS* log messages for better debug fitering - added \'kdl\' namespace
- remove dep
- make searchPositionIK actually const, and thread-safe
- Made debug output look better
0.4.4 (2013-06-26)
Wiki Tutorials
Source Tutorials
Package Dependencies
Deps | Name | |
---|---|---|
3 | moveit_core | |
3 | moveit_ros_perception | |
1 | pluginlib | |
1 | actionlib | |
1 | dynamic_reconfigure | |
1 | angles | |
1 | cmake_modules | |
1 | catkin |
System Dependencies
Dependant Packages
Launch files
Messages
Services
Plugins
Recent questions tagged moveit_ros_planning 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
- Sachin Chitta
- Ioan Sucan
- Michael Ferguson
Authors
- Ioan Sucan
- Sachin Chitta
Changelog for package moveit_ros_planning
0.6.6 (2016-06-08)
- Add library moveit_collision_plugin_loader as an exported catkin library (#678)
- replaced cmake_modules dependency with eigen
- [jade] eigen3 adjustment
- Fix compilation with C++11.
- Enable optional build against Qt5, use -DUseQt5=On to enable it
- merge indigo-devel changes (PR #633 trailing whitespace) into jade-devel
- Removed trailing whitespace from entire repository
- Optional ability to copy velocity and effort to RobotState
- cherry-picked PR #614 fixed segfault on shutdown
- fixed segfault on shutdown use of pluginlib\'s createUnmanagedInstance() is strongly discouraged: http://wiki.ros.org/class_loader#Understanding_Loading_and_Unloading here, the kinematics plugin libs were unloaded before destruction of corresponding pointers
- Deprecate shape_tools
- CurrentStateMonitor no longer requires hearing mimic joint state values.
- Fix crash due to robot state not getting updated (moveit_ros #559)
- Contributors: Dave Coleman, Dave Hershberger, Isaac I.Y. Saito, Levi Armstrong, Maarten de Vries, Robert Haschke, Simon Schmeisser (isys vision), kohlbrecher
0.6.5 (2015-01-24)
- update maintainers
- perception: adding RAII-based locking for OccMapTree
- perception: adding locks to planning scene monitor
- Add time factor support for iterative_time_parametrization
- Contributors: Jonathan Bohren, Michael Ferguson, kohlbrecher
0.6.4 (2014-12-20)
- Namespaced \"traj_execution\" for all trajectory_execution_manager logging
- planning_scene_monitor: add ros parameter for adding a wait-for-transform lookup time fixes #465
- Contributors: Dave Coleman, Jonathan Bohren
0.6.3 (2014-12-03)
- add plugin interface for collision detectors
- fix missing return value
- trivial fixes for warnings
- Contributors: Michael Ferguson
0.6.2 (2014-10-31)
0.6.1 (2014-10-31)
- re-add libqt4 dependency (previously came from pcl-all)
- Contributors: Michael Ferguson
0.6.0 (2014-10-27)
- Removed leadings slash from rosparam for robot padding
- Added move_group capability for clearing octomap.
- Made loading octomap_monitor optional in planning_scene_monitor when using WorldGeometryMonitor
- Contributors: Dave Coleman, Dave Hershberger, Sachin Chitta, ahb
0.5.19 (2014-06-23)
- Updated doxygen comment in TrajectoryExecutionManager.
- Added more informative error message text when cant\' find controllers.
- robot_model_loader.cpp: added call to KinematicsBase::supportsGroup().
- Fix [-Wreorder] warning.
- Fix broken log & output statements.
- Address [cppcheck: coutCerrMisusage] and [-Werror=format-extra-args] errors.
- ROS_ERROR -> ROS_ERROR_NAMED.
- Print size_t values portably.
- Address [-Wreturn-type] warning.
- Address [cppcheck: postfixOperator] warning.
- Address [cppcheck: duplicateIf] error. The same condition was being checked twice, and the same action was being taken.
- Add check for planning scene monitor connection, with 5 sec delay
- Fix for building srv_kinematics_plugin
- New ROS service call-based IK plugin
- Allow planning groups to have more than one tip
- Contributors: Adolfo Rodriguez Tsouroukdissian, Dave Coleman, Dave Hershberger
0.5.18 (2014-03-23)
0.5.17 (2014-03-22)
- update build system for ROS indigo
- update maintainer e-mail
- Namespace a debug message
- Minor non-functional changes to KDL
- Contributors: Dave Coleman, Ioan Sucan
0.5.16 (2014-02-27)
- Copy paste error fix
- Contributors: fivef
0.5.14 (2014-02-06)
0.5.13 (2014-02-06)
- remove debug printfs
- planning_scene_monitor: add requestPlanningSceneState()
- planning_scene_monitor: fix race condition
- planning_scene_monitor: fix state update bug The rate of state updates is limited to dt_state_update per second. When an update arrived it was not processed if another was recently processed. This meant that if a quick sequence of state updates arrived and then no updates arrive for a while that the last update(s) were not seen until another arrives (which may be much later or never). This fixes the bug by periodically checking for pending updates and running them if they have been pending longer than dt_state_update.
- add default_robot_link_padding/scale, set padding/scale value for each robot link, see https://github.com/ros-planning/moveit_ros/issues/402
- fix LockedPlanningSceneRW docs fix the text that was originally copied from another class (from LockedPlanningSceneRO) it mentioned an incorrect return value type of LockedPlanningSceneRW::operator->()
- Contributors: Acorn Pooley, Filip Jares, Kei Okada
0.5.12 (2014-01-03)
- Fixed trailing underscores in CHANGELOGs.
- Contributors: Dave Hershberger
0.5.11 (2014-01-03)
- planning_scene_monitor: slight code simplification
- planning_scene_monitor: fix scope of local vars
- planning_scene_monitor: fix init bug scene_const_ not set if scene passed to constructor.
- kdl_kinematics_plugin: fix warning
- Contributors: Acorn Pooley
0.5.10 (2013-12-08)
- fixing how joint names are filled up, fixed joints were getting included earlier, also resizing consistency limits for when random positions near by function is being called
- Contributors: Sachin Chitta
0.5.9 (2013-12-03)
- Doxygen: added warnings and details to planning_scene_monitor.h
- correcting maintainer email
- remove duplicate header
- Fixed exported targets
- Fixed dependency issue
- fixing joint limits setup for mimic joints
- implement feature requests
- clear monitored octomap when needed (see #315)
- fix the adapter for fixing path constraints for initial states
- fixed computation of dimension_.
- bugfixes in indexing added states for path adapters
- fixes for mimic joints and redundant joints
0.5.8 (2013-10-11)
- add executable for publishing scene geometry from text
- Made the goal duration margin and scaling optional rosparameters
- bugfixes
0.5.7 (2013-10-01)
0.5.6 (2013-09-26)
0.5.5 (2013-09-23)
- fix the event triggered on updating attached objects
- make scene monitor trigger updates only when needed
- fix loading of default params
- port to new RobotState API, new messages
- make sure we do not overwrite attached bodies, when updating the current state
- fix #308
- fix #304
- fix issue with sending trajectories for passive/mimic/fixed joints
- pass effort along
0.5.4 (2013-08-14)
- 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
- move background_processing lib to core
- add option to disable trajectory monitoring
0.5.2 (2013-07-15)
0.5.1 (2013-07-14)
0.5.0 (2013-07-12)
- minor doc fixes
- add docs for planning pipeline
- cleanup build system
- fixing approximate ik calculation
- white space fixes (tabs are now spaces)
- adding check for approximate solution flag
- adding options struct to kinematics base
- port to new base class for planning_interface (using planning contexts)
0.4.5 (2013-07-03)
- Namespaced ROS* log messages for better debug fitering - added \'kdl\' namespace
- remove dep
- make searchPositionIK actually const, and thread-safe
- Made debug output look better
0.4.4 (2013-06-26)
Wiki Tutorials
Source Tutorials
Package Dependencies
Deps | Name | |
---|---|---|
3 | moveit_core | |
3 | moveit_ros_perception | |
1 | pluginlib | |
1 | actionlib | |
1 | dynamic_reconfigure | |
1 | angles | |
1 | catkin |
System Dependencies
Name |
---|
eigen |