|
Package Summary
Tags | No category tags. |
Version | 2.8.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 | 2023-11-29 |
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
- MoveIt Release Team
Authors
- Ryan Luna
MoveIt ROS Benchmarks
This package provides methods to benchmark motion planning algorithms and aggregate/plot statistics. Results can be viewed in Planner Arena.
For more information and usage example please see moveit tutorials.
Changelog for package moveit_ros_benchmarks
2.8.0 (2023-09-10)
2.7.4 (2023-05-18)
2.7.3 (2023-04-24)
- Replace Variable PROJECT_NAME in CMakeLists.txt with the actual name (#2020)
- Contributors: Shobuj Paul
2.7.2 (2023-04-18)
- Update pre-commit (#2094)
- Extract parallel planning from moveit cpp
(#2043)
- Add parallel_planning_interface
- Add parallel planning interface
- Rename package to pipeline_planning_interface
- Move plan_responses_container into own header + source file
- Add plan_responses_contrainer source file
- Add solution selection and stopping criterion function files
- Remove parallel planning from moveit_cpp
- Move parallel planning into planning package
- Update moveit_cpp
- Drop planning_interface changes
- Add documentation
- Update other moveit packages
- Remove removed header
- Address CI complains
- Address clang-tidy complains
- Address clang-tidy complains 2
- Address clang-tidy complains 3
- Extract planning pipeline map creation function from moveit_cpp
- Cleanup comment
- Use const moveit::core::RobotModelConstPtr&
- Formatting
- Add header descriptions
- Remove superfluous TODOs
- Cleanup
- Contributors: Sebastian Jahr, Shobuj Paul
2.7.1 (2023-03-23)
Fix member naming (#1949) * Update clang-tidy rules for readability-identifier-naming Co-authored-by: Sebastian Jahr <sebastian.jahr@picknik.ai>
-
Benchmark parallel planning pipelines (#1539)
- Remove launch and config files (moved to moveit_resources)
-
remove underscore from public member in MotionPlanResponse (#1939)
- remove underscore from private members
- fix more uses of the suffix notation
Contributors: AlexWebb, Robert Haschke, Sebastian Jahr
2.7.0 (2023-01-29)
- converted characters from string format to character format (#1881)
- Fix BSD license in package.xml
(#1796)
- fix BSD license in package.xml
- this must also be spdx compliant
- Remove [MOVEIT_LIB_NAME]{.title-ref} (#1751) It\'s more readable and searchable if we just spell out the target name.
- Add braces around blocks. (#999)
- Used C++ style cast instead of C style cast (#1628) Co-authored-by: Henning Kayser <henningkayser@picknik.ai>
- Contributors: Abhijeet Das Gupta, Chris Thrasher, Christian Henkel, Cory Crean, Sameer Gupta
2.6.0 (2022-11-10)
- Remove unused benchmark_execution.cpp file (#1535)
- Merge PR #1553: Improve cmake files
- Use standard exported targets: export_\${PROJECT_NAME} -> \${PROJECT_NAME}Targets
- Improve CMake usage (#1550)
- Free functions for calculating properties of trajectories (#1503) Co-authored-by: Sebastian Jahr <sebastian.jahr@picknik.ai> Co-authored-by: Sebastian Jahr <sebastian.jahr@picknik.ai>
- Remove __has_include statements (#1481)
- Contributors: Robert Haschke, Sebastian Jahr, Tyler Weaver, Vatan Aksoy Tezer
2.5.3 (2022-07-28)
2.5.2 (2022-07-18)
- Merge https://github.com/ros-planning/moveit/commit/c88f6fb64e9057a4b9a8f6fafc01060e8c48a216
- 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)
- Fix namespace of planning plugin for benchmarks examples (#3128) Since #2888 / https://github.com/ros-planning/moveit_resources/pull/92 [planning_pipeline.launch.xml]{.title-ref} loads into [pipeline]{.title-ref} namespace by default, thus making an explicit specification of [ompl]{.title-ref} redundant.
- Merge pull request #3106 from v4hn/pr-master-bind-them-all / banish bind()
- various: prefer objects and references over pointers
- Contributors: Abishalini, David V. Lu, Henry Moore, Jafar, Michael G
Wiki Tutorials
Source Tutorials
Package Dependencies
System Dependencies
Dependant Packages
Name | Repo | Deps |
---|---|---|
moveit_ros | github-ros-planning-moveit2 |
Launch files
Messages
Services
Plugins
Recent questions tagged moveit_ros_benchmarks at answers.ros.org
|
Package Summary
Tags | No category tags. |
Version | 2.8.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 | 2023-11-29 |
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
- MoveIt Release Team
Authors
- Ryan Luna
MoveIt ROS Benchmarks
This package provides methods to benchmark motion planning algorithms and aggregate/plot statistics. Results can be viewed in Planner Arena.
For more information and usage example please see moveit tutorials.
Changelog for package moveit_ros_benchmarks
2.8.0 (2023-09-10)
2.7.4 (2023-05-18)
2.7.3 (2023-04-24)
- Replace Variable PROJECT_NAME in CMakeLists.txt with the actual name (#2020)
- Contributors: Shobuj Paul
2.7.2 (2023-04-18)
- Update pre-commit (#2094)
- Extract parallel planning from moveit cpp
(#2043)
- Add parallel_planning_interface
- Add parallel planning interface
- Rename package to pipeline_planning_interface
- Move plan_responses_container into own header + source file
- Add plan_responses_contrainer source file
- Add solution selection and stopping criterion function files
- Remove parallel planning from moveit_cpp
- Move parallel planning into planning package
- Update moveit_cpp
- Drop planning_interface changes
- Add documentation
- Update other moveit packages
- Remove removed header
- Address CI complains
- Address clang-tidy complains
- Address clang-tidy complains 2
- Address clang-tidy complains 3
- Extract planning pipeline map creation function from moveit_cpp
- Cleanup comment
- Use const moveit::core::RobotModelConstPtr&
- Formatting
- Add header descriptions
- Remove superfluous TODOs
- Cleanup
- Contributors: Sebastian Jahr, Shobuj Paul
2.7.1 (2023-03-23)
Fix member naming (#1949) * Update clang-tidy rules for readability-identifier-naming Co-authored-by: Sebastian Jahr <sebastian.jahr@picknik.ai>
-
Benchmark parallel planning pipelines (#1539)
- Remove launch and config files (moved to moveit_resources)
-
remove underscore from public member in MotionPlanResponse (#1939)
- remove underscore from private members
- fix more uses of the suffix notation
Contributors: AlexWebb, Robert Haschke, Sebastian Jahr
2.7.0 (2023-01-29)
- converted characters from string format to character format (#1881)
- Fix BSD license in package.xml
(#1796)
- fix BSD license in package.xml
- this must also be spdx compliant
- Remove [MOVEIT_LIB_NAME]{.title-ref} (#1751) It\'s more readable and searchable if we just spell out the target name.
- Add braces around blocks. (#999)
- Used C++ style cast instead of C style cast (#1628) Co-authored-by: Henning Kayser <henningkayser@picknik.ai>
- Contributors: Abhijeet Das Gupta, Chris Thrasher, Christian Henkel, Cory Crean, Sameer Gupta
2.6.0 (2022-11-10)
- Remove unused benchmark_execution.cpp file (#1535)
- Merge PR #1553: Improve cmake files
- Use standard exported targets: export_\${PROJECT_NAME} -> \${PROJECT_NAME}Targets
- Improve CMake usage (#1550)
- Free functions for calculating properties of trajectories (#1503) Co-authored-by: Sebastian Jahr <sebastian.jahr@picknik.ai> Co-authored-by: Sebastian Jahr <sebastian.jahr@picknik.ai>
- Remove __has_include statements (#1481)
- Contributors: Robert Haschke, Sebastian Jahr, Tyler Weaver, Vatan Aksoy Tezer
2.5.3 (2022-07-28)
2.5.2 (2022-07-18)
- Merge https://github.com/ros-planning/moveit/commit/c88f6fb64e9057a4b9a8f6fafc01060e8c48a216
- 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)
- Fix namespace of planning plugin for benchmarks examples (#3128) Since #2888 / https://github.com/ros-planning/moveit_resources/pull/92 [planning_pipeline.launch.xml]{.title-ref} loads into [pipeline]{.title-ref} namespace by default, thus making an explicit specification of [ompl]{.title-ref} redundant.
- Merge pull request #3106 from v4hn/pr-master-bind-them-all / banish bind()
- various: prefer objects and references over pointers
- Contributors: Abishalini, David V. Lu, Henry Moore, Jafar, Michael G
Wiki Tutorials
Source Tutorials
Package Dependencies
System Dependencies
Dependant Packages
Name | Repo | Deps |
---|---|---|
moveit_ros | github-ros-planning-moveit2 |
Launch files
Messages
Services
Plugins
Recent questions tagged moveit_ros_benchmarks at answers.ros.org
|
Package Summary
Tags | No category tags. |
Version | 2.8.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 | 2023-11-29 |
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
- MoveIt Release Team
Authors
- Ryan Luna
MoveIt ROS Benchmarks
This package provides methods to benchmark motion planning algorithms and aggregate/plot statistics. Results can be viewed in Planner Arena.
For more information and usage example please see moveit tutorials.
Changelog for package moveit_ros_benchmarks
2.8.0 (2023-09-10)
2.7.4 (2023-05-18)
2.7.3 (2023-04-24)
- Replace Variable PROJECT_NAME in CMakeLists.txt with the actual name (#2020)
- Contributors: Shobuj Paul
2.7.2 (2023-04-18)
- Update pre-commit (#2094)
- Extract parallel planning from moveit cpp
(#2043)
- Add parallel_planning_interface
- Add parallel planning interface
- Rename package to pipeline_planning_interface
- Move plan_responses_container into own header + source file
- Add plan_responses_contrainer source file
- Add solution selection and stopping criterion function files
- Remove parallel planning from moveit_cpp
- Move parallel planning into planning package
- Update moveit_cpp
- Drop planning_interface changes
- Add documentation
- Update other moveit packages
- Remove removed header
- Address CI complains
- Address clang-tidy complains
- Address clang-tidy complains 2
- Address clang-tidy complains 3
- Extract planning pipeline map creation function from moveit_cpp
- Cleanup comment
- Use const moveit::core::RobotModelConstPtr&
- Formatting
- Add header descriptions
- Remove superfluous TODOs
- Cleanup
- Contributors: Sebastian Jahr, Shobuj Paul
2.7.1 (2023-03-23)
Fix member naming (#1949) * Update clang-tidy rules for readability-identifier-naming Co-authored-by: Sebastian Jahr <sebastian.jahr@picknik.ai>
-
Benchmark parallel planning pipelines (#1539)
- Remove launch and config files (moved to moveit_resources)
-
remove underscore from public member in MotionPlanResponse (#1939)
- remove underscore from private members
- fix more uses of the suffix notation
Contributors: AlexWebb, Robert Haschke, Sebastian Jahr
2.7.0 (2023-01-29)
- converted characters from string format to character format (#1881)
- Fix BSD license in package.xml
(#1796)
- fix BSD license in package.xml
- this must also be spdx compliant
- Remove [MOVEIT_LIB_NAME]{.title-ref} (#1751) It\'s more readable and searchable if we just spell out the target name.
- Add braces around blocks. (#999)
- Used C++ style cast instead of C style cast (#1628) Co-authored-by: Henning Kayser <henningkayser@picknik.ai>
- Contributors: Abhijeet Das Gupta, Chris Thrasher, Christian Henkel, Cory Crean, Sameer Gupta
2.6.0 (2022-11-10)
- Remove unused benchmark_execution.cpp file (#1535)
- Merge PR #1553: Improve cmake files
- Use standard exported targets: export_\${PROJECT_NAME} -> \${PROJECT_NAME}Targets
- Improve CMake usage (#1550)
- Free functions for calculating properties of trajectories (#1503) Co-authored-by: Sebastian Jahr <sebastian.jahr@picknik.ai> Co-authored-by: Sebastian Jahr <sebastian.jahr@picknik.ai>
- Remove __has_include statements (#1481)
- Contributors: Robert Haschke, Sebastian Jahr, Tyler Weaver, Vatan Aksoy Tezer
2.5.3 (2022-07-28)
2.5.2 (2022-07-18)
- Merge https://github.com/ros-planning/moveit/commit/c88f6fb64e9057a4b9a8f6fafc01060e8c48a216
- 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)
- Fix namespace of planning plugin for benchmarks examples (#3128) Since #2888 / https://github.com/ros-planning/moveit_resources/pull/92 [planning_pipeline.launch.xml]{.title-ref} loads into [pipeline]{.title-ref} namespace by default, thus making an explicit specification of [ompl]{.title-ref} redundant.
- Merge pull request #3106 from v4hn/pr-master-bind-them-all / banish bind()
- various: prefer objects and references over pointers
- Contributors: Abishalini, David V. Lu, Henry Moore, Jafar, Michael G
Wiki Tutorials
Source Tutorials
Package Dependencies
System Dependencies
Dependant Packages
Name | Repo | Deps |
---|---|---|
moveit_ros | github-ros-planning-moveit2 |
Launch files
Messages
Services
Plugins
Recent questions tagged moveit_ros_benchmarks at answers.ros.org
|
Package Summary
Tags | No category tags. |
Version | 1.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 | 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
- Dave Coleman
- MoveIt Release Team
Authors
- Ryan Luna
MoveIt ROS Benchmarks
This package provides methods to benchmark motion planning algorithms and aggregate/plot statistics. Results can be viewed in Planner Arena.
For more information and usage example please see moveit tutorials.
Changelog for package moveit_ros_benchmarks
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)
- Contributors: Dave Coleman, Robert Haschke
0.10.8 (2018-12-24)
0.10.7 (2018-12-13)
0.10.6 (2018-12-09)
- [maintenance] Replaced Eigen::Affine3d -> Eigen::Isometry3d (#1096)
- Contributors: Robert Haschke
0.10.5 (2018-11-01)
0.10.4 (2018-10-29)
0.10.3 (2018-10-29)
- [maintenance] Use locale independent conversion from double to string (#1099)
- Contributors: Simon Schmeisser
0.10.2 (2018-10-24)
- [capability] Benchmarking with different Motion Planners (STOMP, CHOMP, OMPL) (#992)
- [maintenance] various compiler warnings (#1038)
- Contributors: Mohmmad Ayman, Raghavender Sahdev, Robert Haschke, mike lautman
0.10.1 (2018-05-25)
- migration from tf to tf2 API (#830)
- Contributors: Ian McMahon
0.9.11 (2017-12-25)
0.9.10 (2017-12-09)
- [fix] benchmarks: always prefer local header over system installations #630
- Contributors: Jorge Nicho, v4hn
0.9.9 (2017-08-06)
0.9.8 (2017-06-21)
0.9.7 (2017-06-05)
0.9.6 (2017-04-12)
- [improve] Add install rule for examples, statistics script
- Contributors: Bence Magyar
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)
- clang-format upgraded to 3.8 (#367)
- Contributors: Dave Coleman
- [enhancement] clang-format upgraded to 3.8 (#367)
- Contributors: Dave Coleman
0.9.3 (2016-11-16)
- 0.9.3 (catkin_prepare_release again missed increment as http://answers.ros.org/question/245969/catkin_prepare_release-not-bumping-packages-in-a-certain-folder
- Merge pull request #330 from davetcoleman/kinetic-package.xml Updated package.xml maintainers and author emails
- Updated package.xml maintainers and author emails
- Contributors: Dave Coleman, Ian McMahon, Isaac I.Y. Saito
0.9.2 (2016-11-05)
- Versions that didn\'t get bumped by catkin_prepare_release.
- Auto format codebase using clang-format (#284)
- Contributors: Dave Coleman, Isaac I.Y. Saito
0.9.1 (2016-10-21)
- add full VERSIONs / SONAMEs to all libraries (#273)
- More version consolidation for all package.xml in the moveit repo, which are not even going to be released (addition to https://github.com/ros-planning/moveit/commit/fcb8df12dead9e5a62b276c46bb0ac6e2411daca).
- More version down for release preparation to consolidate version of to-be released packages (addition to https://github.com/ros-planning/moveit/commit/56a3c6fcd39ca0b548998f04a688655d5133abe0)
- Cleanup readme (#258)
- Convert assorted internal shared_ptrs.
- Switch to std::unique_ptr (instead of boost::scoped_ptr).
- Use shared_ptr typedefs in BenchmarkExecutor.cpp
- Convert pluginlibs
shared_ptrs
tostd::
- Code review fixup Remove package benchmark_gui clang-format Benchmarks package
- Changes for warehouse refactor to single \"moveit\" repo
- New benchmarks suite from Rice
- [package.xml] Fix repository URLs. (#194)
- Use MOVEIT_CLASS_FORWARD for moveit classes in moveit_ros. (#182)
- Switched to C++11
- Contributors: Dave Coleman, Isaac I.Y. Saito, Maarten de Vries, Michael G
Wiki Tutorials
Source Tutorials
Package Dependencies
Deps | Name | |
---|---|---|
1 | ament_cmake | |
3 | moveit_ros_planning | |
1 | rclcpp | |
3 | tf2_eigen | |
1 | pluginlib |
System Dependencies
Dependant Packages
Name | Repo | Deps |
---|---|---|
moveit_ros | github-ros-planning-moveit2 |
Launch files
- examples/demo_panda.launch
-
- bench_opts [default: $(find moveit_ros_benchmarks)/examples/demo1.yaml]
- examples/demo_panda_all_planners.launch
-
- bench_opts [default: $(find moveit_ros_benchmarks)/examples/demo_panda_all_planners.yaml]
- examples/demo_fanuc.launch
-
- bench_opts [default: $(find moveit_ros_benchmarks)/examples/demo1.yaml]
- examples/demo_panda_all_planners_obstacles.launch
-
- bench_opts [default: $(find moveit_ros_benchmarks)/examples/demo_obstacles.yaml]
Messages
Services
Plugins
Recent questions tagged moveit_ros_benchmarks at answers.ros.org
|
Package Summary
Tags | No category tags. |
Version | 2.8.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 | 2023-11-29 |
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
- MoveIt Release Team
Authors
- Ryan Luna
MoveIt ROS Benchmarks
This package provides methods to benchmark motion planning algorithms and aggregate/plot statistics. Results can be viewed in Planner Arena.
For more information and usage example please see moveit tutorials.
Changelog for package moveit_ros_benchmarks
2.8.0 (2023-09-10)
2.7.4 (2023-05-18)
2.7.3 (2023-04-24)
- Replace Variable PROJECT_NAME in CMakeLists.txt with the actual name (#2020)
- Contributors: Shobuj Paul
2.7.2 (2023-04-18)
- Update pre-commit (#2094)
- Extract parallel planning from moveit cpp
(#2043)
- Add parallel_planning_interface
- Add parallel planning interface
- Rename package to pipeline_planning_interface
- Move plan_responses_container into own header + source file
- Add plan_responses_contrainer source file
- Add solution selection and stopping criterion function files
- Remove parallel planning from moveit_cpp
- Move parallel planning into planning package
- Update moveit_cpp
- Drop planning_interface changes
- Add documentation
- Update other moveit packages
- Remove removed header
- Address CI complains
- Address clang-tidy complains
- Address clang-tidy complains 2
- Address clang-tidy complains 3
- Extract planning pipeline map creation function from moveit_cpp
- Cleanup comment
- Use const moveit::core::RobotModelConstPtr&
- Formatting
- Add header descriptions
- Remove superfluous TODOs
- Cleanup
- Contributors: Sebastian Jahr, Shobuj Paul
2.7.1 (2023-03-23)
Fix member naming (#1949) * Update clang-tidy rules for readability-identifier-naming Co-authored-by: Sebastian Jahr <sebastian.jahr@picknik.ai>
-
Benchmark parallel planning pipelines (#1539)
- Remove launch and config files (moved to moveit_resources)
-
remove underscore from public member in MotionPlanResponse (#1939)
- remove underscore from private members
- fix more uses of the suffix notation
Contributors: AlexWebb, Robert Haschke, Sebastian Jahr
2.7.0 (2023-01-29)
- converted characters from string format to character format (#1881)
- Fix BSD license in package.xml
(#1796)
- fix BSD license in package.xml
- this must also be spdx compliant
- Remove [MOVEIT_LIB_NAME]{.title-ref} (#1751) It\'s more readable and searchable if we just spell out the target name.
- Add braces around blocks. (#999)
- Used C++ style cast instead of C style cast (#1628) Co-authored-by: Henning Kayser <henningkayser@picknik.ai>
- Contributors: Abhijeet Das Gupta, Chris Thrasher, Christian Henkel, Cory Crean, Sameer Gupta
2.6.0 (2022-11-10)
- Remove unused benchmark_execution.cpp file (#1535)
- Merge PR #1553: Improve cmake files
- Use standard exported targets: export_\${PROJECT_NAME} -> \${PROJECT_NAME}Targets
- Improve CMake usage (#1550)
- Free functions for calculating properties of trajectories (#1503) Co-authored-by: Sebastian Jahr <sebastian.jahr@picknik.ai> Co-authored-by: Sebastian Jahr <sebastian.jahr@picknik.ai>
- Remove __has_include statements (#1481)
- Contributors: Robert Haschke, Sebastian Jahr, Tyler Weaver, Vatan Aksoy Tezer
2.5.3 (2022-07-28)
2.5.2 (2022-07-18)
- Merge https://github.com/ros-planning/moveit/commit/c88f6fb64e9057a4b9a8f6fafc01060e8c48a216
- 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)
- Fix namespace of planning plugin for benchmarks examples (#3128) Since #2888 / https://github.com/ros-planning/moveit_resources/pull/92 [planning_pipeline.launch.xml]{.title-ref} loads into [pipeline]{.title-ref} namespace by default, thus making an explicit specification of [ompl]{.title-ref} redundant.
- Merge pull request #3106 from v4hn/pr-master-bind-them-all / banish bind()
- various: prefer objects and references over pointers
- Contributors: Abishalini, David V. Lu, Henry Moore, Jafar, Michael G
Wiki Tutorials
Source Tutorials
Package Dependencies
System Dependencies
Dependant Packages
Name | Repo | Deps |
---|---|---|
moveit_ros | github-ros-planning-moveit2 |
Launch files
Messages
Services
Plugins
Recent questions tagged moveit_ros_benchmarks at answers.ros.org
|
Package Summary
Tags | No category tags. |
Version | 2.8.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 | 2023-11-29 |
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
- MoveIt Release Team
Authors
- Ryan Luna
MoveIt ROS Benchmarks
This package provides methods to benchmark motion planning algorithms and aggregate/plot statistics. Results can be viewed in Planner Arena.
For more information and usage example please see moveit tutorials.
Changelog for package moveit_ros_benchmarks
2.8.0 (2023-09-10)
2.7.4 (2023-05-18)
2.7.3 (2023-04-24)
- Replace Variable PROJECT_NAME in CMakeLists.txt with the actual name (#2020)
- Contributors: Shobuj Paul
2.7.2 (2023-04-18)
- Update pre-commit (#2094)
- Extract parallel planning from moveit cpp
(#2043)
- Add parallel_planning_interface
- Add parallel planning interface
- Rename package to pipeline_planning_interface
- Move plan_responses_container into own header + source file
- Add plan_responses_contrainer source file
- Add solution selection and stopping criterion function files
- Remove parallel planning from moveit_cpp
- Move parallel planning into planning package
- Update moveit_cpp
- Drop planning_interface changes
- Add documentation
- Update other moveit packages
- Remove removed header
- Address CI complains
- Address clang-tidy complains
- Address clang-tidy complains 2
- Address clang-tidy complains 3
- Extract planning pipeline map creation function from moveit_cpp
- Cleanup comment
- Use const moveit::core::RobotModelConstPtr&
- Formatting
- Add header descriptions
- Remove superfluous TODOs
- Cleanup
- Contributors: Sebastian Jahr, Shobuj Paul
2.7.1 (2023-03-23)
Fix member naming (#1949) * Update clang-tidy rules for readability-identifier-naming Co-authored-by: Sebastian Jahr <sebastian.jahr@picknik.ai>
-
Benchmark parallel planning pipelines (#1539)
- Remove launch and config files (moved to moveit_resources)
-
remove underscore from public member in MotionPlanResponse (#1939)
- remove underscore from private members
- fix more uses of the suffix notation
Contributors: AlexWebb, Robert Haschke, Sebastian Jahr
2.7.0 (2023-01-29)
- converted characters from string format to character format (#1881)
- Fix BSD license in package.xml
(#1796)
- fix BSD license in package.xml
- this must also be spdx compliant
- Remove [MOVEIT_LIB_NAME]{.title-ref} (#1751) It\'s more readable and searchable if we just spell out the target name.
- Add braces around blocks. (#999)
- Used C++ style cast instead of C style cast (#1628) Co-authored-by: Henning Kayser <henningkayser@picknik.ai>
- Contributors: Abhijeet Das Gupta, Chris Thrasher, Christian Henkel, Cory Crean, Sameer Gupta
2.6.0 (2022-11-10)
- Remove unused benchmark_execution.cpp file (#1535)
- Merge PR #1553: Improve cmake files
- Use standard exported targets: export_\${PROJECT_NAME} -> \${PROJECT_NAME}Targets
- Improve CMake usage (#1550)
- Free functions for calculating properties of trajectories (#1503) Co-authored-by: Sebastian Jahr <sebastian.jahr@picknik.ai> Co-authored-by: Sebastian Jahr <sebastian.jahr@picknik.ai>
- Remove __has_include statements (#1481)
- Contributors: Robert Haschke, Sebastian Jahr, Tyler Weaver, Vatan Aksoy Tezer
2.5.3 (2022-07-28)
2.5.2 (2022-07-18)
- Merge https://github.com/ros-planning/moveit/commit/c88f6fb64e9057a4b9a8f6fafc01060e8c48a216
- 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)
- Fix namespace of planning plugin for benchmarks examples (#3128) Since #2888 / https://github.com/ros-planning/moveit_resources/pull/92 [planning_pipeline.launch.xml]{.title-ref} loads into [pipeline]{.title-ref} namespace by default, thus making an explicit specification of [ompl]{.title-ref} redundant.
- Merge pull request #3106 from v4hn/pr-master-bind-them-all / banish bind()
- various: prefer objects and references over pointers
- Contributors: Abishalini, David V. Lu, Henry Moore, Jafar, Michael G
Wiki Tutorials
Source Tutorials
Package Dependencies
System Dependencies
Dependant Packages
Name | Repo | Deps |
---|---|---|
moveit_ros | github-ros-planning-moveit2 |