Package Summary

Tags No category tags.
Version 2.7.4
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-05-26
Dev Status DEVELOPED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

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

Additional Links

Maintainers

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

Authors

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

Changelog for package moveit_ros_planning_interface

2.7.4 (2023-05-18)

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

2.7.3 (2023-04-24)

  • Replace Variable PROJECT_NAME in CMakeLists.txt with the actual name (#2020)
  • Contributors: Shobuj Paul

2.7.2 (2023-04-18)

2.7.1 (2023-03-23)

  • Fix member naming (#1949) * Update clang-tidy rules for readability-identifier-naming Co-authored-by: Sebastian Jahr <sebastian.jahr@picknik.ai>

  • remove underscore from public member in MotionPlanResponse (#1939)

    • remove underscore from private members
    • fix more uses of the suffix notation
  • Contributors: AlexWebb, Robert Haschke

2.7.0 (2023-01-29)

  • Merge https://github.com/ros-planning/moveit/commit/9225971216885490e933ece25390c63ca14f8a58
  • converted characters from string format to character format (#1881)
  • 400% speed up to move group interface (#1865)
  • GHA: Build moveit_msgs from source (#1853) * Revert #1739: moveit_msgs no longer needs to be built from source This reverts commit 6e0fce31cfe94ef8c6d5ebccb4d865f0c144b6e1.

    • Remove obsolete include: moveit_msgs/srv/execute_known_trajectory.hpp
    • Cleanup moveit2.repos
  • Cleanup msg includes: Use C++ instead of C header (#1844)

  • Fix BSD license in package.xml (#1796)

    • fix BSD license in package.xml
    • this must also be spdx compliant
  • Minimize use of [this->]{.title-ref} (#1784) It\'s often unnecessary. MoveIt already avoids this in most cases so this PR better cements that existing pattern.

  • Remove [MOVEIT_LIB_NAME]{.title-ref} (#1751) It\'s more readable and searchable if we just spell out the target name.

  • Add braces around blocks. (#999)

  • Use <> for non-local headers (#1734) Unless a header lives in the same or a child directory of the file including it, it\'s recommended to use <> for the #include statement. For more information, see the C++ Core Guidelines item SF.12 https://isocpp.github.io/CppCoreGuidelines/CppCoreGuidelines#sf12-prefer-the-quoted-form-of-include-for-files-relative-to-the-including-file-and-the-angle-bracket-form-everywhere-else

  • Used C++ style cast instead of C style cast (#1628) Co-authored-by: Henning Kayser <henningkayser@picknik.ai>

  • Fix clang-tidy issues (#1706)

    • Blindly apply automatic clang-tidy fixes
    • Exemplarily cleanup a few automatic clang-tidy fixes
    • Clang-tidy fixups
    • Missed const-ref fixups
    • Fix unsupported non-const -> const

    * More fixes Co-authored-by: Henning Kayser <henningkayser@picknik.ai>

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

    • Test with JointState argument

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

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

2.6.0 (2022-11-10)

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

    • Add dual arm test

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

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

2.5.3 (2022-07-28)

2.5.2 (2022-07-18)

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged moveit_ros_planning_interface at answers.ros.org

Package Summary

Tags No category tags.
Version 2.7.4
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-05-26
Dev Status DEVELOPED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

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

Additional Links

Maintainers

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

Authors

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

Changelog for package moveit_ros_planning_interface

2.7.4 (2023-05-18)

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

2.7.3 (2023-04-24)

  • Replace Variable PROJECT_NAME in CMakeLists.txt with the actual name (#2020)
  • Contributors: Shobuj Paul

2.7.2 (2023-04-18)

2.7.1 (2023-03-23)

  • Fix member naming (#1949) * Update clang-tidy rules for readability-identifier-naming Co-authored-by: Sebastian Jahr <sebastian.jahr@picknik.ai>

  • remove underscore from public member in MotionPlanResponse (#1939)

    • remove underscore from private members
    • fix more uses of the suffix notation
  • Contributors: AlexWebb, Robert Haschke

2.7.0 (2023-01-29)

  • Merge https://github.com/ros-planning/moveit/commit/9225971216885490e933ece25390c63ca14f8a58
  • converted characters from string format to character format (#1881)
  • 400% speed up to move group interface (#1865)
  • GHA: Build moveit_msgs from source (#1853) * Revert #1739: moveit_msgs no longer needs to be built from source This reverts commit 6e0fce31cfe94ef8c6d5ebccb4d865f0c144b6e1.

    • Remove obsolete include: moveit_msgs/srv/execute_known_trajectory.hpp
    • Cleanup moveit2.repos
  • Cleanup msg includes: Use C++ instead of C header (#1844)

  • Fix BSD license in package.xml (#1796)

    • fix BSD license in package.xml
    • this must also be spdx compliant
  • Minimize use of [this->]{.title-ref} (#1784) It\'s often unnecessary. MoveIt already avoids this in most cases so this PR better cements that existing pattern.

  • Remove [MOVEIT_LIB_NAME]{.title-ref} (#1751) It\'s more readable and searchable if we just spell out the target name.

  • Add braces around blocks. (#999)

  • Use <> for non-local headers (#1734) Unless a header lives in the same or a child directory of the file including it, it\'s recommended to use <> for the #include statement. For more information, see the C++ Core Guidelines item SF.12 https://isocpp.github.io/CppCoreGuidelines/CppCoreGuidelines#sf12-prefer-the-quoted-form-of-include-for-files-relative-to-the-including-file-and-the-angle-bracket-form-everywhere-else

  • Used C++ style cast instead of C style cast (#1628) Co-authored-by: Henning Kayser <henningkayser@picknik.ai>

  • Fix clang-tidy issues (#1706)

    • Blindly apply automatic clang-tidy fixes
    • Exemplarily cleanup a few automatic clang-tidy fixes
    • Clang-tidy fixups
    • Missed const-ref fixups
    • Fix unsupported non-const -> const

    * More fixes Co-authored-by: Henning Kayser <henningkayser@picknik.ai>

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

    • Test with JointState argument

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

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

2.6.0 (2022-11-10)

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

    • Add dual arm test

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

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

2.5.3 (2022-07-28)

2.5.2 (2022-07-18)

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged moveit_ros_planning_interface at answers.ros.org

Package Summary

Tags No category tags.
Version 2.7.4
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-05-26
Dev Status DEVELOPED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

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

Additional Links

Maintainers

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

Authors

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

Changelog for package moveit_ros_planning_interface

2.7.4 (2023-05-18)

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

2.7.3 (2023-04-24)

  • Replace Variable PROJECT_NAME in CMakeLists.txt with the actual name (#2020)
  • Contributors: Shobuj Paul

2.7.2 (2023-04-18)

2.7.1 (2023-03-23)

  • Fix member naming (#1949) * Update clang-tidy rules for readability-identifier-naming Co-authored-by: Sebastian Jahr <sebastian.jahr@picknik.ai>

  • remove underscore from public member in MotionPlanResponse (#1939)

    • remove underscore from private members
    • fix more uses of the suffix notation
  • Contributors: AlexWebb, Robert Haschke

2.7.0 (2023-01-29)

  • Merge https://github.com/ros-planning/moveit/commit/9225971216885490e933ece25390c63ca14f8a58
  • converted characters from string format to character format (#1881)
  • 400% speed up to move group interface (#1865)
  • GHA: Build moveit_msgs from source (#1853) * Revert #1739: moveit_msgs no longer needs to be built from source This reverts commit 6e0fce31cfe94ef8c6d5ebccb4d865f0c144b6e1.

    • Remove obsolete include: moveit_msgs/srv/execute_known_trajectory.hpp
    • Cleanup moveit2.repos
  • Cleanup msg includes: Use C++ instead of C header (#1844)

  • Fix BSD license in package.xml (#1796)

    • fix BSD license in package.xml
    • this must also be spdx compliant
  • Minimize use of [this->]{.title-ref} (#1784) It\'s often unnecessary. MoveIt already avoids this in most cases so this PR better cements that existing pattern.

  • Remove [MOVEIT_LIB_NAME]{.title-ref} (#1751) It\'s more readable and searchable if we just spell out the target name.

  • Add braces around blocks. (#999)

  • Use <> for non-local headers (#1734) Unless a header lives in the same or a child directory of the file including it, it\'s recommended to use <> for the #include statement. For more information, see the C++ Core Guidelines item SF.12 https://isocpp.github.io/CppCoreGuidelines/CppCoreGuidelines#sf12-prefer-the-quoted-form-of-include-for-files-relative-to-the-including-file-and-the-angle-bracket-form-everywhere-else

  • Used C++ style cast instead of C style cast (#1628) Co-authored-by: Henning Kayser <henningkayser@picknik.ai>

  • Fix clang-tidy issues (#1706)

    • Blindly apply automatic clang-tidy fixes
    • Exemplarily cleanup a few automatic clang-tidy fixes
    • Clang-tidy fixups
    • Missed const-ref fixups
    • Fix unsupported non-const -> const

    * More fixes Co-authored-by: Henning Kayser <henningkayser@picknik.ai>

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

    • Test with JointState argument

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

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

2.6.0 (2022-11-10)

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

    • Add dual arm test

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

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

2.5.3 (2022-07-28)

2.5.2 (2022-07-18)

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged moveit_ros_planning_interface at answers.ros.org

Package Summary

Tags No category tags.
Version 2.7.4
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-05-26
Dev Status DEVELOPED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

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

Additional Links

Maintainers

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

Authors

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

Changelog for package moveit_ros_planning_interface

2.7.4 (2023-05-18)

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

2.7.3 (2023-04-24)

  • Replace Variable PROJECT_NAME in CMakeLists.txt with the actual name (#2020)
  • Contributors: Shobuj Paul

2.7.2 (2023-04-18)

2.7.1 (2023-03-23)

  • Fix member naming (#1949) * Update clang-tidy rules for readability-identifier-naming Co-authored-by: Sebastian Jahr <sebastian.jahr@picknik.ai>

  • remove underscore from public member in MotionPlanResponse (#1939)

    • remove underscore from private members
    • fix more uses of the suffix notation
  • Contributors: AlexWebb, Robert Haschke

2.7.0 (2023-01-29)

  • Merge https://github.com/ros-planning/moveit/commit/9225971216885490e933ece25390c63ca14f8a58
  • converted characters from string format to character format (#1881)
  • 400% speed up to move group interface (#1865)
  • GHA: Build moveit_msgs from source (#1853) * Revert #1739: moveit_msgs no longer needs to be built from source This reverts commit 6e0fce31cfe94ef8c6d5ebccb4d865f0c144b6e1.

    • Remove obsolete include: moveit_msgs/srv/execute_known_trajectory.hpp
    • Cleanup moveit2.repos
  • Cleanup msg includes: Use C++ instead of C header (#1844)

  • Fix BSD license in package.xml (#1796)

    • fix BSD license in package.xml
    • this must also be spdx compliant
  • Minimize use of [this->]{.title-ref} (#1784) It\'s often unnecessary. MoveIt already avoids this in most cases so this PR better cements that existing pattern.

  • Remove [MOVEIT_LIB_NAME]{.title-ref} (#1751) It\'s more readable and searchable if we just spell out the target name.

  • Add braces around blocks. (#999)

  • Use <> for non-local headers (#1734) Unless a header lives in the same or a child directory of the file including it, it\'s recommended to use <> for the #include statement. For more information, see the C++ Core Guidelines item SF.12 https://isocpp.github.io/CppCoreGuidelines/CppCoreGuidelines#sf12-prefer-the-quoted-form-of-include-for-files-relative-to-the-including-file-and-the-angle-bracket-form-everywhere-else

  • Used C++ style cast instead of C style cast (#1628) Co-authored-by: Henning Kayser <henningkayser@picknik.ai>

  • Fix clang-tidy issues (#1706)

    • Blindly apply automatic clang-tidy fixes
    • Exemplarily cleanup a few automatic clang-tidy fixes
    • Clang-tidy fixups
    • Missed const-ref fixups
    • Fix unsupported non-const -> const

    * More fixes Co-authored-by: Henning Kayser <henningkayser@picknik.ai>

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

    • Test with JointState argument

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

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

2.6.0 (2022-11-10)

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

    • Add dual arm test

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

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

2.5.3 (2022-07-28)

2.5.2 (2022-07-18)

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged moveit_ros_planning_interface at answers.ros.org

Package Summary

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

Repository Summary

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

Package Description

Components of MoveIt that offer simpler interfaces to planning and execution

Additional Links

Maintainers

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

Authors

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

Changelog for package moveit_ros_planning_interface

1.1.12 (2023-05-13)

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged moveit_ros_planning_interface 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

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

Additional Links

Maintainers

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

Authors

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

Changelog for package moveit_ros_planning_interface

1.0.11 (2022-09-13)

1.0.10 (2022-03-06)

1.0.9 (2022-01-09)

  • Use moveit-resources@master (#2951)
    • Simplify launch files to use the test_environment.launch files from
    • Provide compatibility to the Noetic-style configuration of (multiple) planning pipelines Only a single pipeline can be used at a time, specified via the ~default_planning_pipeline parameter.
  • Add missing noexcept declarations (#3016)
  • Move MoveItErrorCode class to moveit_core (#3009)
  • Revert \"Fix scaling factor parameter names\" (#2907)
  • Contributors: Michael G

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Dependant Packages

Name Repo Deps
cob_obstacle_distance_moveit github-ipa320-cob_manipulation
force_torque_sensor_calib github-kth-ros-pkg-force_torque_tools
industrial_extrinsic_cal github-ros-industrial-industrial_calibration
moveit_commander github-ros-planning-moveit
moveit_planners_chomp github-ros-planning-moveit
pilz_industrial_motion_planner github-ros-planning-moveit
moveit_ros github-ros-planning-moveit
moveit_servo github-ros-planning-moveit
moveit_ros_visualization github-ros-planning-moveit
moveit_runtime github-ros-planning-moveit
moveit_tutorials github-ros-planning-moveit_tutorials
open_manipulator_with_tb3_tools github-ROBOTIS-GIT-open_manipulator_with_tb3
open_manipulator_with_tb3_tools github-ROBOTIS-GIT-turtlebot3_manipulation
pilz_trajectory_generation github-PilzDE-pilz_industrial_motion
play_motion github-pal-robotics-play_motion
ram_trajectory gitlab-InstitutMaupertuis-ros_additive_manufacturing
nextage_moveit_config github-tork-a-rtmros_nextage
sr_utilities github-shadow-robot-sr_core
sr_error_reporter github-shadow-robot-sr_interface
sr_multi_moveit_test github-shadow-robot-sr_interface
sr_robot_commander github-shadow-robot-sr_interface
turtlebot_arm_block_manipulation github-turtlebot-turtlebot_arm
turtlebot_arm_object_manipulation github-turtlebot-turtlebot_arm
webots_ros github-cyberbotics-webots_ros
webots_ros github-omichel-webots_ros
bwi_manipulation github-utexas-bwi-bwi_common
bwi_moveit_utils github-utexas-bwi-bwi_common
kinova_arm_moveit_demo github-Kinovarobotics-jaco-ros
tork_moveit_tutorial github-tork-a-tork_moveit_tutorial
end_effector github-ADVRHumanoids-ROSEndEffector
pincher_arm_moveit_demos github-fictionlab-pincher_arm
move_group_interface_client github-robosoft-ai-smacc

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged moveit_ros_planning_interface at answers.ros.org

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

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

Components of MoveIt that offer simpler interfaces to planning and execution

Additional Links

Maintainers

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

Authors

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

Changelog for package moveit_ros_planning_interface

2.0.0 (2020-02-17)

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

1.0.1 (2019-03-08)

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

1.0.0 (2019-02-24)

  • [fix] catkin_lint issues (#1341)
  • [improve] Remove (redundant) random seeding and #attempts from RobotState::setFromIK() as the IK solver perform random seeding themselves. #1288
  • Contributors: Dave Coleman, Robert Haschke

0.10.8 (2018-12-24)

0.10.7 (2018-12-13)

  • [fix] Fixed destruction order of shared tf2::Buffer / tf2::TransformListener (#1261)
  • Contributors: Robert Haschke

0.10.6 (2018-12-09)

  • [fix] Fixed various memory leaks (#1104)
    • SharedStorage: Use weak_ptrs for caching
  • [enhancement] Add getMoveGroupClient() to move_group_interface (#1215)
  • [maintenance] Replaced Eigen::Affine3d -> Eigen::Isometry3d (#1096)
  • [maintenance] Remove deprecated MoveGroup class (#1211)
  • [maintenance] Use C++14 (#1146)
  • [maintenance] Code Cleanup
  • Contributors: Alex Moriarty, Dave Coleman, Martin G

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged moveit_ros_planning_interface at answers.ros.org

No version for distro dashing. Known supported distros are highlighted in the buttons above.

Package Summary

Tags No category tags.
Version 2.7.4
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-05-26
Dev Status DEVELOPED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

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

Additional Links

Maintainers

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

Authors

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

Changelog for package moveit_ros_planning_interface

2.7.4 (2023-05-18)

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

2.7.3 (2023-04-24)

  • Replace Variable PROJECT_NAME in CMakeLists.txt with the actual name (#2020)
  • Contributors: Shobuj Paul

2.7.2 (2023-04-18)

2.7.1 (2023-03-23)

  • Fix member naming (#1949) * Update clang-tidy rules for readability-identifier-naming Co-authored-by: Sebastian Jahr <sebastian.jahr@picknik.ai>

  • remove underscore from public member in MotionPlanResponse (#1939)

    • remove underscore from private members
    • fix more uses of the suffix notation
  • Contributors: AlexWebb, Robert Haschke

2.7.0 (2023-01-29)

  • Merge https://github.com/ros-planning/moveit/commit/9225971216885490e933ece25390c63ca14f8a58
  • converted characters from string format to character format (#1881)
  • 400% speed up to move group interface (#1865)
  • GHA: Build moveit_msgs from source (#1853) * Revert #1739: moveit_msgs no longer needs to be built from source This reverts commit 6e0fce31cfe94ef8c6d5ebccb4d865f0c144b6e1.

    • Remove obsolete include: moveit_msgs/srv/execute_known_trajectory.hpp
    • Cleanup moveit2.repos
  • Cleanup msg includes: Use C++ instead of C header (#1844)

  • Fix BSD license in package.xml (#1796)

    • fix BSD license in package.xml
    • this must also be spdx compliant
  • Minimize use of [this->]{.title-ref} (#1784) It\'s often unnecessary. MoveIt already avoids this in most cases so this PR better cements that existing pattern.

  • Remove [MOVEIT_LIB_NAME]{.title-ref} (#1751) It\'s more readable and searchable if we just spell out the target name.

  • Add braces around blocks. (#999)

  • Use <> for non-local headers (#1734) Unless a header lives in the same or a child directory of the file including it, it\'s recommended to use <> for the #include statement. For more information, see the C++ Core Guidelines item SF.12 https://isocpp.github.io/CppCoreGuidelines/CppCoreGuidelines#sf12-prefer-the-quoted-form-of-include-for-files-relative-to-the-including-file-and-the-angle-bracket-form-everywhere-else

  • Used C++ style cast instead of C style cast (#1628) Co-authored-by: Henning Kayser <henningkayser@picknik.ai>

  • Fix clang-tidy issues (#1706)

    • Blindly apply automatic clang-tidy fixes
    • Exemplarily cleanup a few automatic clang-tidy fixes
    • Clang-tidy fixups
    • Missed const-ref fixups
    • Fix unsupported non-const -> const

    * More fixes Co-authored-by: Henning Kayser <henningkayser@picknik.ai>

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

    • Test with JointState argument

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

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

2.6.0 (2022-11-10)

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

    • Add dual arm test

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

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

2.5.3 (2022-07-28)

2.5.2 (2022-07-18)

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged moveit_ros_planning_interface at answers.ros.org

Package Summary

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

Repository Summary

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

Package Description

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

Additional Links

Maintainers

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

Authors

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

Changelog for package moveit_ros_planning_interface

0.9.18 (2020-01-24)

0.9.17 (2019-07-09)

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

0.9.16 (2019-06-29)

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

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged moveit_ros_planning_interface at answers.ros.org

Package Summary

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

Repository Summary

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

Package Description

Components of MoveIt that offer simpler interfaces to planning and execution

Additional Links

Maintainers

  • Ioan Sucan
  • Michael Ferguson

Authors

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

Changelog for package moveit_ros_planning_interface

0.6.6 (2016-06-08)

  • replaced cmake_modules dependency with eigen
  • [jade] eigen3 adjustment
  • merge indigo-devel changes (PR #633 trailing whitespace) into jade-devel
  • Removed trailing whitespace from entire repository
  • planning_interface::MoveGroup::get/setPlannerParams
  • new method MoveGroup::getDefaultPlannerId(const std::string &group) ... to retrieve default planner config from param server moved corresponding code from rviz plugin to MoveGroup interface to facilitate re-use
  • fixing conflicts, renaming variable
  • Merge pull request #589 from MichaelStevens/set_num_planning_attempts adding set_num_planning_attempts to python interface
  • comments addressed
  • Added python wrapper for setMaxVelocityScalingFactor
  • saves robot name to db from moveit. also robot name accessible through robot interface python wrapper
  • adding set_num_planning_attempts to python interface
  • Merge pull request #571 from ymollard/indigo-devel Added python wrapper for MoveGroup.asyncExecute()
  • Added python wrapper for MoveGroup.asyncExecute()
  • Add retime_trajectory to moveit python wrapper
  • add getHandle to move_group_interface
  • Updated documentation on move() to inform the user that an asynchronus spinner is required. Commonly new users don\'t do this and move() blocks permanently
  • Contributors: Dave Coleman, Dave Hershberger, Isaac I.Y. Saito, Kei Okada, Michael Stevens, Robert Haschke, Sachin Chitta, Scott, Yoan Mollard, dg, ferherranz

0.6.5 (2015-01-24)

  • update maintainers
  • Add time factor support for iterative_time_parametrization
  • Contributors: Michael Ferguson, kohlbrecher

0.6.4 (2014-12-20)

0.6.3 (2014-12-03)

  • include correct boost::*_ptr class for boost 1.57.
  • Contributors: v4hn

0.6.2 (2014-10-31)

0.6.1 (2014-10-31)

0.6.0 (2014-10-27)

  • Add missing variants of place (PlaceLocation, place anywhere) for python interface
  • Python wrapper for getEndEffectorTips()
  • Contributors: Dave Coleman, Sachin Chitta, corot

0.5.19 (2014-06-23)

  • Add check for planning scene monitor connection, with 5 sec delay
  • Contributors: Dave Coleman

0.5.18 (2014-03-23)

0.5.17 (2014-03-22)

  • update build system for ROS indigo
  • added move_group python interface bindings to move group interface function: void setPathConstraints(const moveit_msgs::Constraint &constraint) in order to be able to set path constraints from python scripts directly and no need to use the DB.
  • Use member NodeHandle in action clients. Currently services and topics are already using the member NodeHandle instance, but not the action clients. This is relevant for two reasons:

    • Consistency in the resulting ROS API namespace (everything in the same namespace).

    - Consistency in the spinning policy. All services, topics and actions will be spinned by the same NodeHandle, and whatever custom (or not) spinners and callback queues it has associated.

  • adding error code returns to relevant functions

  • Contributors: Adolfo Rodriguez Tsouroukdissian, Emili Boronat, Ioan A Sucan, Sachin Chitta

0.5.16 (2014-02-27)

  • adding node handle to options in move_group_interface
  • adding get for active joints
  • Contributors: Sachin Chitta

0.5.14 (2014-02-06)

0.5.13 (2014-02-06)

  • add API for setting the number of motion plans to be evaluated via the MoveGroupInterface
  • move_group_interface: improve documentation
  • Contributors: Acorn Pooley, Ioan Sucan

0.5.12 (2014-01-03)

0.5.11 (2014-01-03)

  • Fixed bug in computeCartesianPathPython.
  • Adding collision object interface to planning_scene interface.
  • Contributors: Acorn Pooley, Sachin Chitta

0.5.10 (2013-12-08)

0.5.9 (2013-12-03)

  • Fixed doxygen function-grouping.
  • Added planning feedback to gui, refactored states tab

0.5.8 (2013-10-11)

  • add function to start state monitor in move_group_interface::MoveGroup

0.5.7 (2013-10-01)

0.5.6 (2013-09-26)

  • update planning options

0.5.5 (2013-09-23)

  • add support for setting joint targets from approximate IK
  • specifies python version 2.7 for linking (fixes #302)
  • use new messages for pick & place
  • expand functionality of MoveGroupInterface
  • porting to new RobotState API

0.5.4 (2013-08-14)

  • make pick more general
  • use message serialization for python bindings
  • remove CollisionMap, expose topic names in PlanningSceneMonitor, implement detach / attach operations as requested by #280
  • make headers and author definitions aligned the same way; white space fixes

0.5.2 (2013-07-15)

  • move msgs to common_msgs

0.5.1 (2013-07-14)

0.5.0 (2013-07-12)

  • white space fixes (tabs are now spaces)

0.4.5 (2013-07-03)

0.4.4 (2013-06-26)

  • some refactoring

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged moveit_ros_planning_interface at answers.ros.org

Package Summary

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

Repository Summary

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

Package Description

Components of MoveIt that offer simpler interfaces to planning and execution

Additional Links

Maintainers

  • Ioan Sucan
  • Michael Ferguson

Authors

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

Changelog for package moveit_ros_planning_interface

0.7.2 (2016-06-20)

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

0.7.1 (2016-04-11)

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

0.7.0 (2016-01-30)

  • Removed trailing whitespace from entire repository
  • new method MoveGroup::getDefaultPlannerId(const std::string &group) ... to retrieve default planner config from param server moved corresponding code from rviz plugin to MoveGroup interface to facilitate re-use
  • adding set_num_planning_attempts to python interface
  • Added python wrapper for setMaxVelocityScalingFactor
  • saves robot name to db from moveit. also robot name accessible through robot interface python wrapper
  • adding set_num_planning_attempts to python interface
  • Added python wrapper for MoveGroup.asyncExecute()
  • Add retime_trajectory to moveit python wrapper
  • add getHandle to move_group_interface
  • Updated documentation on move() to inform the user that an asynchronus spinner is required. Commonly new users don\'t do this and move() blocks permanently
  • Contributors: Dave Coleman, Dave Hershberger, Kei Okada, Michael Stevens, Robert Haschke, Sachin Chitta, Scott, Yoan Mollard, dg, ferherranz

0.6.5 (2015-01-24)

  • update maintainers
  • Add time factor support for iterative_time_parametrization
  • Contributors: Michael Ferguson, kohlbrecher

0.6.4 (2014-12-20)

0.6.3 (2014-12-03)

  • include correct boost::*_ptr class for boost 1.57.
  • Contributors: v4hn

0.6.2 (2014-10-31)

0.6.1 (2014-10-31)

0.6.0 (2014-10-27)

  • Add missing variants of place (PlaceLocation, place anywhere) for python interface
  • Python wrapper for getEndEffectorTips()
  • Contributors: Dave Coleman, Sachin Chitta, corot

0.5.19 (2014-06-23)

  • Add check for planning scene monitor connection, with 5 sec delay
  • Contributors: Dave Coleman

0.5.18 (2014-03-23)

0.5.17 (2014-03-22)

  • update build system for ROS indigo
  • added move_group python interface bindings to move group interface function: void setPathConstraints(const moveit_msgs::Constraint &constraint) in order to be able to set path constraints from python scripts directly and no need to use the DB.
  • Use member NodeHandle in action clients. Currently services and topics are already using the member NodeHandle instance, but not the action clients. This is relevant for two reasons:

    • Consistency in the resulting ROS API namespace (everything in the same namespace).

    - Consistency in the spinning policy. All services, topics and actions will be spinned by the same NodeHandle, and whatever custom (or not) spinners and callback queues it has associated.

  • adding error code returns to relevant functions

  • Contributors: Adolfo Rodriguez Tsouroukdissian, Emili Boronat, Ioan A Sucan, Sachin Chitta

0.5.16 (2014-02-27)

  • adding node handle to options in move_group_interface
  • adding get for active joints
  • Contributors: Sachin Chitta

0.5.14 (2014-02-06)

0.5.13 (2014-02-06)

  • add API for setting the number of motion plans to be evaluated via the MoveGroupInterface
  • move_group_interface: improve documentation
  • Contributors: Acorn Pooley, Ioan Sucan

0.5.12 (2014-01-03)

0.5.11 (2014-01-03)

  • Fixed bug in computeCartesianPathPython.
  • Adding collision object interface to planning_scene interface.
  • Contributors: Acorn Pooley, Sachin Chitta

0.5.10 (2013-12-08)

0.5.9 (2013-12-03)

  • Fixed doxygen function-grouping.
  • Added planning feedback to gui, refactored states tab

0.5.8 (2013-10-11)

  • add function to start state monitor in move_group_interface::MoveGroup

0.5.7 (2013-10-01)

0.5.6 (2013-09-26)

  • update planning options

0.5.5 (2013-09-23)

  • add support for setting joint targets from approximate IK
  • specifies python version 2.7 for linking (fixes #302)
  • use new messages for pick & place
  • expand functionality of MoveGroupInterface
  • porting to new RobotState API

0.5.4 (2013-08-14)

  • make pick more general
  • use message serialization for python bindings
  • remove CollisionMap, expose topic names in PlanningSceneMonitor, implement detach / attach operations as requested by #280
  • make headers and author definitions aligned the same way; white space fixes

0.5.2 (2013-07-15)

  • move msgs to common_msgs

0.5.1 (2013-07-14)

0.5.0 (2013-07-12)

  • white space fixes (tabs are now spaces)

0.4.5 (2013-07-03)

0.4.4 (2013-06-26)

  • some refactoring

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Dependant Packages

Name Repo Deps
cob_obstacle_distance_moveit github-ipa320-cob_manipulation
cob_pick_place_action github-ipa320-cob_manipulation
force_torque_sensor_calib github-kth-ros-pkg-force_torque_tools
industrial_extrinsic_cal github-ros-industrial-industrial_calibration
jog_arm github-UTNuclearRoboticsPublic-jog_arm
move_base_to_manip github-UTNuclearRoboticsPublic-move_base_to_manip
moveit_commander github-ros-planning-moveit
moveit_commander github-ros-planning-moveit_commander
moveit_ros github-ros-planning-moveit
moveit_ros github-ros-planning-moveit_ros
moveit_ros_visualization github-ros-planning-moveit
moveit_ros_visualization github-ros-planning-moveit_ros
moveit_runtime github-ros-planning-moveit
moveit_tutorials github-ros-planning-moveit_tutorials
play_motion github-pal-robotics-play_motion
nextage_moveit_config github-tork-a-rtmros_nextage
sr_robot_commander github-shadow-robot-sr_interface
turtlebot_arm_block_manipulation github-turtlebot-turtlebot_arm
calvin_pick_n_place github-uos-calvin_robot
calvin_pick_server github-uos-calvin_robot
kinova_arm_moveit_demo github-Kinovarobotics-jaco-ros
moveit_simple_grasps github-davetcoleman-moveit_simple_grasps
aubo_trajectory github-auboliuxin-aubo_robot
baxter_sim_kinematics github-RethinkRobotics-baxter_simulator
carl_moveit github-GT-RAIL-carl_moveit
fetch_pbd_interaction github-fetchrobotics-fetch_pbd
moveit_planning_helper github-JenniferBuehler-moveit-pkgs
rapid_pbd github-jstnhuang-rapid_pbd
romeo_moveit_actions github-ros-aldebaran-romeo_moveit_actions
tork_moveit_tutorial github-tork-a-tork_moveit_tutorial

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged moveit_ros_planning_interface at 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

Components of MoveIt that offer simpler interfaces to planning and execution

Additional Links

Maintainers

  • Ioan Sucan

Authors

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

Changelog for package moveit_ros_planning_interface

0.5.20 (2014-12-09)

  • Fix spurious warning (\"execution should start at current state\")
  • Add missing variants of place (PlaceLocation, place anywhere) for python interface
  • Python wrapper for getEndEffectorTips()
  • returning int values
  • Contributors: Dave Coleman, Martin G

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged moveit_ros_planning_interface at answers.ros.org

Package Summary

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

Repository Summary

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

Package Description

Components of MoveIt that offer simpler interfaces to planning and execution

Additional Links

Maintainers

  • Ioan Sucan
  • Michael Ferguson

Authors

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

Changelog for package moveit_ros_planning_interface

0.6.6 (2016-06-08)

  • replaced cmake_modules dependency with eigen
  • [jade] eigen3 adjustment
  • merge indigo-devel changes (PR #633 trailing whitespace) into jade-devel
  • Removed trailing whitespace from entire repository
  • planning_interface::MoveGroup::get/setPlannerParams
  • new method MoveGroup::getDefaultPlannerId(const std::string &group) ... to retrieve default planner config from param server moved corresponding code from rviz plugin to MoveGroup interface to facilitate re-use
  • fixing conflicts, renaming variable
  • Merge pull request #589 from MichaelStevens/set_num_planning_attempts adding set_num_planning_attempts to python interface
  • comments addressed
  • Added python wrapper for setMaxVelocityScalingFactor
  • saves robot name to db from moveit. also robot name accessible through robot interface python wrapper
  • adding set_num_planning_attempts to python interface
  • Merge pull request #571 from ymollard/indigo-devel Added python wrapper for MoveGroup.asyncExecute()
  • Added python wrapper for MoveGroup.asyncExecute()
  • Add retime_trajectory to moveit python wrapper
  • add getHandle to move_group_interface
  • Updated documentation on move() to inform the user that an asynchronus spinner is required. Commonly new users don\'t do this and move() blocks permanently
  • Contributors: Dave Coleman, Dave Hershberger, Isaac I.Y. Saito, Kei Okada, Michael Stevens, Robert Haschke, Sachin Chitta, Scott, Yoan Mollard, dg, ferherranz

0.6.5 (2015-01-24)

  • update maintainers
  • Add time factor support for iterative_time_parametrization
  • Contributors: Michael Ferguson, kohlbrecher

0.6.4 (2014-12-20)

0.6.3 (2014-12-03)

  • include correct boost::*_ptr class for boost 1.57.
  • Contributors: v4hn

0.6.2 (2014-10-31)

0.6.1 (2014-10-31)

0.6.0 (2014-10-27)

  • Add missing variants of place (PlaceLocation, place anywhere) for python interface
  • Python wrapper for getEndEffectorTips()
  • Contributors: Dave Coleman, Sachin Chitta, corot

0.5.19 (2014-06-23)

  • Add check for planning scene monitor connection, with 5 sec delay
  • Contributors: Dave Coleman

0.5.18 (2014-03-23)

0.5.17 (2014-03-22)

  • update build system for ROS indigo
  • added move_group python interface bindings to move group interface function: void setPathConstraints(const moveit_msgs::Constraint &constraint) in order to be able to set path constraints from python scripts directly and no need to use the DB.
  • Use member NodeHandle in action clients. Currently services and topics are already using the member NodeHandle instance, but not the action clients. This is relevant for two reasons:

    • Consistency in the resulting ROS API namespace (everything in the same namespace).

    - Consistency in the spinning policy. All services, topics and actions will be spinned by the same NodeHandle, and whatever custom (or not) spinners and callback queues it has associated.

  • adding error code returns to relevant functions

  • Contributors: Adolfo Rodriguez Tsouroukdissian, Emili Boronat, Ioan A Sucan, Sachin Chitta

0.5.16 (2014-02-27)

  • adding node handle to options in move_group_interface
  • adding get for active joints
  • Contributors: Sachin Chitta

0.5.14 (2014-02-06)

0.5.13 (2014-02-06)

  • add API for setting the number of motion plans to be evaluated via the MoveGroupInterface
  • move_group_interface: improve documentation
  • Contributors: Acorn Pooley, Ioan Sucan

0.5.12 (2014-01-03)

0.5.11 (2014-01-03)

  • Fixed bug in computeCartesianPathPython.
  • Adding collision object interface to planning_scene interface.
  • Contributors: Acorn Pooley, Sachin Chitta

0.5.10 (2013-12-08)

0.5.9 (2013-12-03)

  • Fixed doxygen function-grouping.
  • Added planning feedback to gui, refactored states tab

0.5.8 (2013-10-11)

  • add function to start state monitor in move_group_interface::MoveGroup

0.5.7 (2013-10-01)

0.5.6 (2013-09-26)

  • update planning options

0.5.5 (2013-09-23)

  • add support for setting joint targets from approximate IK
  • specifies python version 2.7 for linking (fixes #302)
  • use new messages for pick & place
  • expand functionality of MoveGroupInterface
  • porting to new RobotState API

0.5.4 (2013-08-14)

  • make pick more general
  • use message serialization for python bindings
  • remove CollisionMap, expose topic names in PlanningSceneMonitor, implement detach / attach operations as requested by #280
  • make headers and author definitions aligned the same way; white space fixes

0.5.2 (2013-07-15)

  • move msgs to common_msgs

0.5.1 (2013-07-14)

0.5.0 (2013-07-12)

  • white space fixes (tabs are now spaces)

0.4.5 (2013-07-03)

0.4.4 (2013-06-26)

  • some refactoring

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Dependant Packages

Name Repo Deps
choreo_core github-yijiangh-Choreo
choreo_process_planning github-yijiangh-Choreo
choreo_task_sequence_planner github-yijiangh-Choreo
cob_obstacle_distance_moveit github-ipa320-cob_manipulation
fanuc_grinding_path_planning gitlab-InstitutMaupertuis-fanuc_grinding
fanuc_grinding_scanning gitlab-InstitutMaupertuis-fanuc_grinding
force_torque_sensor_calib github-kth-ros-pkg-force_torque_tools
iiwa_moveit github-ipa-rwu-iiwa_stack
industrial_extrinsic_cal github-ros-industrial-industrial_calibration
jog_arm github-UTNuclearRoboticsPublic-jog_arm
move_base_to_manip github-UTNuclearRoboticsPublic-move_base_to_manip
moveit_commander github-ros-planning-moveit
moveit_commander github-ros-planning-moveit_commander
moveit_planners_chomp github-ros-planning-moveit
moveit_ros github-ros-planning-moveit
moveit_ros github-ros-planning-moveit_ros
moveit_ros_visualization github-ros-planning-moveit
moveit_ros_visualization github-ros-planning-moveit_ros
moveit_runtime github-ros-planning-moveit
moveit_tutorials github-ros-planning-moveit_tutorials
open_manipulator_controller github-ROBOTIS-GIT-open_manipulator
open_manipulator_with_tb3_tools github-ROBOTIS-GIT-open_manipulator_with_tb3
pilz_trajectory_generation github-PilzDE-pilz_industrial_motion
play_motion github-pal-robotics-play_motion
nextage_moveit_config github-tork-a-rtmros_nextage
sr_robot_commander github-shadow-robot-sr_interface
turtlebot_arm_block_manipulation github-turtlebot-turtlebot_arm
turtlebot_arm_object_manipulation github-turtlebot-turtlebot_arm
webots_ros github-cyberbotics-webots_ros
xarm_planner github-xArm-Developer-xarm_ros
bwi_manipulation github-utexas-bwi-bwi_common
bwi_moveit_utils github-utexas-bwi-bwi_common
kinova_arm_moveit_demo github-Kinovarobotics-jaco-ros
moveit_simple_grasps github-davetcoleman-moveit_simple_grasps
segbot_arm_manipulation github-utexas-bwi-segbot
aubo_trajectory github-auboliuxin-aubo_robot
romeo_moveit_actions github-ros-aldebaran-romeo_moveit_actions
moveit_z_client github-robosoft-ai-smacc
turtlebot3_manipulation_gui github-ROBOTIS-GIT-turtlebot3_manipulation
turtlebot3_manipulation_slam github-ROBOTIS-GIT-turtlebot3_manipulation

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged moveit_ros_planning_interface at answers.ros.org