Package Summary

Tags No category tags.
Version 2.14.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 2025-06-14
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

Core libraries used by MoveIt

Additional Links

Maintainers

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

Authors

  • Ioan Sucan
  • Sachin Chitta
  • Acorn Pooley
  • Dave Coleman

MoveIt Core

This repository includes core libraries used by MoveIt:

  • representation of kinematic models
  • collision detection interfaces and implementations
  • interfaces for kinematic solver plugins
  • interfaces for motion planning plugins
  • interfaces for controllers and sensors

These libraries do not depend on ROS (except ROS messages) and can be used independently.

CHANGELOG

Changelog for package moveit_core

2.14.0 (2025-06-13)

  • Fix seg fault with attached objects during motion execution (#3466)
  • Contributors: Marq Rasmussen

2.13.2 (2025-04-16)

2.13.1 (2025-04-15)

  • Make the destructors of the base classes of planning adapters virtual and close move_group gracefully (#3435)
  • fix: ensure attached objects update during motion execution (#3327)
  • Contributors: Cihat Kurtuluş Altıparmak, Marco Magri

2.13.0 (2025-02-15)

  • Reverts #2985, Ports moveit #3388 #3470 #3539 (#3284)
  • Add missing target dependencies to eigen_stl_containers (#3295)
  • Support including the names of other attached objects in [touch_link]{.title-ref} (#3276)
  • Fix: misleading error logs in RobotState::setFromIKSubgroups() (#3263)
  • Update includes for generate_parameter_library 0.4.0 (#3255)
  • Remove plugins from export set (#3227)
  • [Issue-879] Add const specifier to moveit_core (#3202)
  • Don't destroy objects on attach (#3205)
  • Update deprecated tf2 imports from .h to .hpp (#3197)
  • Remove ACM entries when removing collision objects (#3183)
  • handle continuous joints in getLowerAndUpperLimits (#3153)
  • Contributors: Aleksey Nogin, Jafar Uruç, Mario Prats, Mark Johnson, Marq Rasmussen, Michael Görner, Paul Gesel, Sebastian Castro, Robert Haschke, Zhong Jin, gayar

2.12.0 (2024-11-29)

  • Enhancement/use hpp for headers (#3113)
  • Removes unused deprecation.h file (#3128)
  • Add use_padding flag + deprecate checkCollisionUnpadded() functions (#3088)
  • Fixes flaky RobotState test (#3105)
  • Allow RobotState::setFromIK to work with subframes (#3077)
  • Fix jacobian calculation (#3069)
  • Port fixes for handling orientation constraints (#3052)
  • Fix createTrajectoryMessage (#3064)
  • Fix flipped comments in [joint_model.h]{.title-ref} (#3047)
  • add helper function to load robot from package name + urdf + srdf (#3039)
  • Fix Cartesian interpolation (#3020)
  • Update urdf/model.h -> urdf/model.hpp (#3003)
  • Contributors: Mario Prats, Paul Gesel, Robert Haschke, Sebastian Castro, Sebastian Jahr, Tom Noble

2.11.0 (2024-09-16)

  • Fix RobotState::getRigidlyConnectedParentLinkModel() (#2985)
  • Implement realtime Ruckig jerk-limited smoothing (#2956)
  • New implementation for computeCartesianPath() (#2916)
  • Don't set reset observer callback & set CB after world_ is initialized (#2950)
  • Deduplicate joint trajectory points in Pilz Move Group Sequence capability (#2943)
  • Optimize MOVE_SHAPE operations for FCL (#3601)
  • Allow moving of all shapes of an object in one go (#3599)
  • Silent "empty quaternion" warning from poseMsgToEigen() (#3435)
  • Propagate "clear octomap" actions to monitoring planning scenes

File truncated at 100 lines see the full file

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged moveit_core at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 2.14.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 2025-06-14
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

Core libraries used by MoveIt

Additional Links

Maintainers

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

Authors

  • Ioan Sucan
  • Sachin Chitta
  • Acorn Pooley
  • Dave Coleman

MoveIt Core

This repository includes core libraries used by MoveIt:

  • representation of kinematic models
  • collision detection interfaces and implementations
  • interfaces for kinematic solver plugins
  • interfaces for motion planning plugins
  • interfaces for controllers and sensors

These libraries do not depend on ROS (except ROS messages) and can be used independently.

CHANGELOG

Changelog for package moveit_core

2.14.0 (2025-06-13)

  • Fix seg fault with attached objects during motion execution (#3466)
  • Contributors: Marq Rasmussen

2.13.2 (2025-04-16)

2.13.1 (2025-04-15)

  • Make the destructors of the base classes of planning adapters virtual and close move_group gracefully (#3435)
  • fix: ensure attached objects update during motion execution (#3327)
  • Contributors: Cihat Kurtuluş Altıparmak, Marco Magri

2.13.0 (2025-02-15)

  • Reverts #2985, Ports moveit #3388 #3470 #3539 (#3284)
  • Add missing target dependencies to eigen_stl_containers (#3295)
  • Support including the names of other attached objects in [touch_link]{.title-ref} (#3276)
  • Fix: misleading error logs in RobotState::setFromIKSubgroups() (#3263)
  • Update includes for generate_parameter_library 0.4.0 (#3255)
  • Remove plugins from export set (#3227)
  • [Issue-879] Add const specifier to moveit_core (#3202)
  • Don't destroy objects on attach (#3205)
  • Update deprecated tf2 imports from .h to .hpp (#3197)
  • Remove ACM entries when removing collision objects (#3183)
  • handle continuous joints in getLowerAndUpperLimits (#3153)
  • Contributors: Aleksey Nogin, Jafar Uruç, Mario Prats, Mark Johnson, Marq Rasmussen, Michael Görner, Paul Gesel, Sebastian Castro, Robert Haschke, Zhong Jin, gayar

2.12.0 (2024-11-29)

  • Enhancement/use hpp for headers (#3113)
  • Removes unused deprecation.h file (#3128)
  • Add use_padding flag + deprecate checkCollisionUnpadded() functions (#3088)
  • Fixes flaky RobotState test (#3105)
  • Allow RobotState::setFromIK to work with subframes (#3077)
  • Fix jacobian calculation (#3069)
  • Port fixes for handling orientation constraints (#3052)
  • Fix createTrajectoryMessage (#3064)
  • Fix flipped comments in [joint_model.h]{.title-ref} (#3047)
  • add helper function to load robot from package name + urdf + srdf (#3039)
  • Fix Cartesian interpolation (#3020)
  • Update urdf/model.h -> urdf/model.hpp (#3003)
  • Contributors: Mario Prats, Paul Gesel, Robert Haschke, Sebastian Castro, Sebastian Jahr, Tom Noble

2.11.0 (2024-09-16)

  • Fix RobotState::getRigidlyConnectedParentLinkModel() (#2985)
  • Implement realtime Ruckig jerk-limited smoothing (#2956)
  • New implementation for computeCartesianPath() (#2916)
  • Don't set reset observer callback & set CB after world_ is initialized (#2950)
  • Deduplicate joint trajectory points in Pilz Move Group Sequence capability (#2943)
  • Optimize MOVE_SHAPE operations for FCL (#3601)
  • Allow moving of all shapes of an object in one go (#3599)
  • Silent "empty quaternion" warning from poseMsgToEigen() (#3435)
  • Propagate "clear octomap" actions to monitoring planning scenes

File truncated at 100 lines see the full file

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged moveit_core at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 2.14.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 2025-06-14
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

Core libraries used by MoveIt

Additional Links

Maintainers

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

Authors

  • Ioan Sucan
  • Sachin Chitta
  • Acorn Pooley
  • Dave Coleman

MoveIt Core

This repository includes core libraries used by MoveIt:

  • representation of kinematic models
  • collision detection interfaces and implementations
  • interfaces for kinematic solver plugins
  • interfaces for motion planning plugins
  • interfaces for controllers and sensors

These libraries do not depend on ROS (except ROS messages) and can be used independently.

CHANGELOG

Changelog for package moveit_core

2.14.0 (2025-06-13)

  • Fix seg fault with attached objects during motion execution (#3466)
  • Contributors: Marq Rasmussen

2.13.2 (2025-04-16)

2.13.1 (2025-04-15)

  • Make the destructors of the base classes of planning adapters virtual and close move_group gracefully (#3435)
  • fix: ensure attached objects update during motion execution (#3327)
  • Contributors: Cihat Kurtuluş Altıparmak, Marco Magri

2.13.0 (2025-02-15)

  • Reverts #2985, Ports moveit #3388 #3470 #3539 (#3284)
  • Add missing target dependencies to eigen_stl_containers (#3295)
  • Support including the names of other attached objects in [touch_link]{.title-ref} (#3276)
  • Fix: misleading error logs in RobotState::setFromIKSubgroups() (#3263)
  • Update includes for generate_parameter_library 0.4.0 (#3255)
  • Remove plugins from export set (#3227)
  • [Issue-879] Add const specifier to moveit_core (#3202)
  • Don't destroy objects on attach (#3205)
  • Update deprecated tf2 imports from .h to .hpp (#3197)
  • Remove ACM entries when removing collision objects (#3183)
  • handle continuous joints in getLowerAndUpperLimits (#3153)
  • Contributors: Aleksey Nogin, Jafar Uruç, Mario Prats, Mark Johnson, Marq Rasmussen, Michael Görner, Paul Gesel, Sebastian Castro, Robert Haschke, Zhong Jin, gayar

2.12.0 (2024-11-29)

  • Enhancement/use hpp for headers (#3113)
  • Removes unused deprecation.h file (#3128)
  • Add use_padding flag + deprecate checkCollisionUnpadded() functions (#3088)
  • Fixes flaky RobotState test (#3105)
  • Allow RobotState::setFromIK to work with subframes (#3077)
  • Fix jacobian calculation (#3069)
  • Port fixes for handling orientation constraints (#3052)
  • Fix createTrajectoryMessage (#3064)
  • Fix flipped comments in [joint_model.h]{.title-ref} (#3047)
  • add helper function to load robot from package name + urdf + srdf (#3039)
  • Fix Cartesian interpolation (#3020)
  • Update urdf/model.h -> urdf/model.hpp (#3003)
  • Contributors: Mario Prats, Paul Gesel, Robert Haschke, Sebastian Castro, Sebastian Jahr, Tom Noble

2.11.0 (2024-09-16)

  • Fix RobotState::getRigidlyConnectedParentLinkModel() (#2985)
  • Implement realtime Ruckig jerk-limited smoothing (#2956)
  • New implementation for computeCartesianPath() (#2916)
  • Don't set reset observer callback & set CB after world_ is initialized (#2950)
  • Deduplicate joint trajectory points in Pilz Move Group Sequence capability (#2943)
  • Optimize MOVE_SHAPE operations for FCL (#3601)
  • Allow moving of all shapes of an object in one go (#3599)
  • Silent "empty quaternion" warning from poseMsgToEigen() (#3435)
  • Propagate "clear octomap" actions to monitoring planning scenes

File truncated at 100 lines see the full file

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged moveit_core at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 2.14.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 2025-06-14
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

Core libraries used by MoveIt

Additional Links

Maintainers

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

Authors

  • Ioan Sucan
  • Sachin Chitta
  • Acorn Pooley
  • Dave Coleman

MoveIt Core

This repository includes core libraries used by MoveIt:

  • representation of kinematic models
  • collision detection interfaces and implementations
  • interfaces for kinematic solver plugins
  • interfaces for motion planning plugins
  • interfaces for controllers and sensors

These libraries do not depend on ROS (except ROS messages) and can be used independently.

CHANGELOG

Changelog for package moveit_core

2.14.0 (2025-06-13)

  • Fix seg fault with attached objects during motion execution (#3466)
  • Contributors: Marq Rasmussen

2.13.2 (2025-04-16)

2.13.1 (2025-04-15)

  • Make the destructors of the base classes of planning adapters virtual and close move_group gracefully (#3435)
  • fix: ensure attached objects update during motion execution (#3327)
  • Contributors: Cihat Kurtuluş Altıparmak, Marco Magri

2.13.0 (2025-02-15)

  • Reverts #2985, Ports moveit #3388 #3470 #3539 (#3284)
  • Add missing target dependencies to eigen_stl_containers (#3295)
  • Support including the names of other attached objects in [touch_link]{.title-ref} (#3276)
  • Fix: misleading error logs in RobotState::setFromIKSubgroups() (#3263)
  • Update includes for generate_parameter_library 0.4.0 (#3255)
  • Remove plugins from export set (#3227)
  • [Issue-879] Add const specifier to moveit_core (#3202)
  • Don't destroy objects on attach (#3205)
  • Update deprecated tf2 imports from .h to .hpp (#3197)
  • Remove ACM entries when removing collision objects (#3183)
  • handle continuous joints in getLowerAndUpperLimits (#3153)
  • Contributors: Aleksey Nogin, Jafar Uruç, Mario Prats, Mark Johnson, Marq Rasmussen, Michael Görner, Paul Gesel, Sebastian Castro, Robert Haschke, Zhong Jin, gayar

2.12.0 (2024-11-29)

  • Enhancement/use hpp for headers (#3113)
  • Removes unused deprecation.h file (#3128)
  • Add use_padding flag + deprecate checkCollisionUnpadded() functions (#3088)
  • Fixes flaky RobotState test (#3105)
  • Allow RobotState::setFromIK to work with subframes (#3077)
  • Fix jacobian calculation (#3069)
  • Port fixes for handling orientation constraints (#3052)
  • Fix createTrajectoryMessage (#3064)
  • Fix flipped comments in [joint_model.h]{.title-ref} (#3047)
  • add helper function to load robot from package name + urdf + srdf (#3039)
  • Fix Cartesian interpolation (#3020)
  • Update urdf/model.h -> urdf/model.hpp (#3003)
  • Contributors: Mario Prats, Paul Gesel, Robert Haschke, Sebastian Castro, Sebastian Jahr, Tom Noble

2.11.0 (2024-09-16)

  • Fix RobotState::getRigidlyConnectedParentLinkModel() (#2985)
  • Implement realtime Ruckig jerk-limited smoothing (#2956)
  • New implementation for computeCartesianPath() (#2916)
  • Don't set reset observer callback & set CB after world_ is initialized (#2950)
  • Deduplicate joint trajectory points in Pilz Move Group Sequence capability (#2943)
  • Optimize MOVE_SHAPE operations for FCL (#3601)
  • Allow moving of all shapes of an object in one go (#3599)
  • Silent "empty quaternion" warning from poseMsgToEigen() (#3435)
  • Propagate "clear octomap" actions to monitoring planning scenes

File truncated at 100 lines see the full file

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged moveit_core at Robotics Stack Exchange

No version for distro ardent showing humble. Known supported distros are highlighted in the buttons above.

Package Summary

Tags No category tags.
Version 2.14.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 2025-06-14
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

Core libraries used by MoveIt

Additional Links

Maintainers

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

Authors

  • Ioan Sucan
  • Sachin Chitta
  • Acorn Pooley
  • Dave Coleman

MoveIt Core

This repository includes core libraries used by MoveIt:

  • representation of kinematic models
  • collision detection interfaces and implementations
  • interfaces for kinematic solver plugins
  • interfaces for motion planning plugins
  • interfaces for controllers and sensors

These libraries do not depend on ROS (except ROS messages) and can be used independently.

CHANGELOG

Changelog for package moveit_core

2.14.0 (2025-06-13)

  • Fix seg fault with attached objects during motion execution (#3466)
  • Contributors: Marq Rasmussen

2.13.2 (2025-04-16)

2.13.1 (2025-04-15)

  • Make the destructors of the base classes of planning adapters virtual and close move_group gracefully (#3435)
  • fix: ensure attached objects update during motion execution (#3327)
  • Contributors: Cihat Kurtuluş Altıparmak, Marco Magri

2.13.0 (2025-02-15)

  • Reverts #2985, Ports moveit #3388 #3470 #3539 (#3284)
  • Add missing target dependencies to eigen_stl_containers (#3295)
  • Support including the names of other attached objects in [touch_link]{.title-ref} (#3276)
  • Fix: misleading error logs in RobotState::setFromIKSubgroups() (#3263)
  • Update includes for generate_parameter_library 0.4.0 (#3255)
  • Remove plugins from export set (#3227)
  • [Issue-879] Add const specifier to moveit_core (#3202)
  • Don't destroy objects on attach (#3205)
  • Update deprecated tf2 imports from .h to .hpp (#3197)
  • Remove ACM entries when removing collision objects (#3183)
  • handle continuous joints in getLowerAndUpperLimits (#3153)
  • Contributors: Aleksey Nogin, Jafar Uruç, Mario Prats, Mark Johnson, Marq Rasmussen, Michael Görner, Paul Gesel, Sebastian Castro, Robert Haschke, Zhong Jin, gayar

2.12.0 (2024-11-29)

  • Enhancement/use hpp for headers (#3113)
  • Removes unused deprecation.h file (#3128)
  • Add use_padding flag + deprecate checkCollisionUnpadded() functions (#3088)
  • Fixes flaky RobotState test (#3105)
  • Allow RobotState::setFromIK to work with subframes (#3077)
  • Fix jacobian calculation (#3069)
  • Port fixes for handling orientation constraints (#3052)
  • Fix createTrajectoryMessage (#3064)
  • Fix flipped comments in [joint_model.h]{.title-ref} (#3047)
  • add helper function to load robot from package name + urdf + srdf (#3039)
  • Fix Cartesian interpolation (#3020)
  • Update urdf/model.h -> urdf/model.hpp (#3003)
  • Contributors: Mario Prats, Paul Gesel, Robert Haschke, Sebastian Castro, Sebastian Jahr, Tom Noble

2.11.0 (2024-09-16)

  • Fix RobotState::getRigidlyConnectedParentLinkModel() (#2985)
  • Implement realtime Ruckig jerk-limited smoothing (#2956)
  • New implementation for computeCartesianPath() (#2916)
  • Don't set reset observer callback & set CB after world_ is initialized (#2950)
  • Deduplicate joint trajectory points in Pilz Move Group Sequence capability (#2943)
  • Optimize MOVE_SHAPE operations for FCL (#3601)
  • Allow moving of all shapes of an object in one go (#3599)
  • Silent "empty quaternion" warning from poseMsgToEigen() (#3435)
  • Propagate "clear octomap" actions to monitoring planning scenes

File truncated at 100 lines see the full file

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged moveit_core at Robotics Stack Exchange

No version for distro bouncy showing humble. Known supported distros are highlighted in the buttons above.

Package Summary

Tags No category tags.
Version 2.14.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 2025-06-14
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

Core libraries used by MoveIt

Additional Links

Maintainers

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

Authors

  • Ioan Sucan
  • Sachin Chitta
  • Acorn Pooley
  • Dave Coleman

MoveIt Core

This repository includes core libraries used by MoveIt:

  • representation of kinematic models
  • collision detection interfaces and implementations
  • interfaces for kinematic solver plugins
  • interfaces for motion planning plugins
  • interfaces for controllers and sensors

These libraries do not depend on ROS (except ROS messages) and can be used independently.

CHANGELOG

Changelog for package moveit_core

2.14.0 (2025-06-13)

  • Fix seg fault with attached objects during motion execution (#3466)
  • Contributors: Marq Rasmussen

2.13.2 (2025-04-16)

2.13.1 (2025-04-15)

  • Make the destructors of the base classes of planning adapters virtual and close move_group gracefully (#3435)
  • fix: ensure attached objects update during motion execution (#3327)
  • Contributors: Cihat Kurtuluş Altıparmak, Marco Magri

2.13.0 (2025-02-15)

  • Reverts #2985, Ports moveit #3388 #3470 #3539 (#3284)
  • Add missing target dependencies to eigen_stl_containers (#3295)
  • Support including the names of other attached objects in [touch_link]{.title-ref} (#3276)
  • Fix: misleading error logs in RobotState::setFromIKSubgroups() (#3263)
  • Update includes for generate_parameter_library 0.4.0 (#3255)
  • Remove plugins from export set (#3227)
  • [Issue-879] Add const specifier to moveit_core (#3202)
  • Don't destroy objects on attach (#3205)
  • Update deprecated tf2 imports from .h to .hpp (#3197)
  • Remove ACM entries when removing collision objects (#3183)
  • handle continuous joints in getLowerAndUpperLimits (#3153)
  • Contributors: Aleksey Nogin, Jafar Uruç, Mario Prats, Mark Johnson, Marq Rasmussen, Michael Görner, Paul Gesel, Sebastian Castro, Robert Haschke, Zhong Jin, gayar

2.12.0 (2024-11-29)

  • Enhancement/use hpp for headers (#3113)
  • Removes unused deprecation.h file (#3128)
  • Add use_padding flag + deprecate checkCollisionUnpadded() functions (#3088)
  • Fixes flaky RobotState test (#3105)
  • Allow RobotState::setFromIK to work with subframes (#3077)
  • Fix jacobian calculation (#3069)
  • Port fixes for handling orientation constraints (#3052)
  • Fix createTrajectoryMessage (#3064)
  • Fix flipped comments in [joint_model.h]{.title-ref} (#3047)
  • add helper function to load robot from package name + urdf + srdf (#3039)
  • Fix Cartesian interpolation (#3020)
  • Update urdf/model.h -> urdf/model.hpp (#3003)
  • Contributors: Mario Prats, Paul Gesel, Robert Haschke, Sebastian Castro, Sebastian Jahr, Tom Noble

2.11.0 (2024-09-16)

  • Fix RobotState::getRigidlyConnectedParentLinkModel() (#2985)
  • Implement realtime Ruckig jerk-limited smoothing (#2956)
  • New implementation for computeCartesianPath() (#2916)
  • Don't set reset observer callback & set CB after world_ is initialized (#2950)
  • Deduplicate joint trajectory points in Pilz Move Group Sequence capability (#2943)
  • Optimize MOVE_SHAPE operations for FCL (#3601)
  • Allow moving of all shapes of an object in one go (#3599)
  • Silent "empty quaternion" warning from poseMsgToEigen() (#3435)
  • Propagate "clear octomap" actions to monitoring planning scenes

File truncated at 100 lines see the full file

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged moveit_core at Robotics Stack Exchange

No version for distro crystal showing humble. Known supported distros are highlighted in the buttons above.

Package Summary

Tags No category tags.
Version 2.14.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 2025-06-14
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

Core libraries used by MoveIt

Additional Links

Maintainers

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

Authors

  • Ioan Sucan
  • Sachin Chitta
  • Acorn Pooley
  • Dave Coleman

MoveIt Core

This repository includes core libraries used by MoveIt:

  • representation of kinematic models
  • collision detection interfaces and implementations
  • interfaces for kinematic solver plugins
  • interfaces for motion planning plugins
  • interfaces for controllers and sensors

These libraries do not depend on ROS (except ROS messages) and can be used independently.

CHANGELOG

Changelog for package moveit_core

2.14.0 (2025-06-13)

  • Fix seg fault with attached objects during motion execution (#3466)
  • Contributors: Marq Rasmussen

2.13.2 (2025-04-16)

2.13.1 (2025-04-15)

  • Make the destructors of the base classes of planning adapters virtual and close move_group gracefully (#3435)
  • fix: ensure attached objects update during motion execution (#3327)
  • Contributors: Cihat Kurtuluş Altıparmak, Marco Magri

2.13.0 (2025-02-15)

  • Reverts #2985, Ports moveit #3388 #3470 #3539 (#3284)
  • Add missing target dependencies to eigen_stl_containers (#3295)
  • Support including the names of other attached objects in [touch_link]{.title-ref} (#3276)
  • Fix: misleading error logs in RobotState::setFromIKSubgroups() (#3263)
  • Update includes for generate_parameter_library 0.4.0 (#3255)
  • Remove plugins from export set (#3227)
  • [Issue-879] Add const specifier to moveit_core (#3202)
  • Don't destroy objects on attach (#3205)
  • Update deprecated tf2 imports from .h to .hpp (#3197)
  • Remove ACM entries when removing collision objects (#3183)
  • handle continuous joints in getLowerAndUpperLimits (#3153)
  • Contributors: Aleksey Nogin, Jafar Uruç, Mario Prats, Mark Johnson, Marq Rasmussen, Michael Görner, Paul Gesel, Sebastian Castro, Robert Haschke, Zhong Jin, gayar

2.12.0 (2024-11-29)

  • Enhancement/use hpp for headers (#3113)
  • Removes unused deprecation.h file (#3128)
  • Add use_padding flag + deprecate checkCollisionUnpadded() functions (#3088)
  • Fixes flaky RobotState test (#3105)
  • Allow RobotState::setFromIK to work with subframes (#3077)
  • Fix jacobian calculation (#3069)
  • Port fixes for handling orientation constraints (#3052)
  • Fix createTrajectoryMessage (#3064)
  • Fix flipped comments in [joint_model.h]{.title-ref} (#3047)
  • add helper function to load robot from package name + urdf + srdf (#3039)
  • Fix Cartesian interpolation (#3020)
  • Update urdf/model.h -> urdf/model.hpp (#3003)
  • Contributors: Mario Prats, Paul Gesel, Robert Haschke, Sebastian Castro, Sebastian Jahr, Tom Noble

2.11.0 (2024-09-16)

  • Fix RobotState::getRigidlyConnectedParentLinkModel() (#2985)
  • Implement realtime Ruckig jerk-limited smoothing (#2956)
  • New implementation for computeCartesianPath() (#2916)
  • Don't set reset observer callback & set CB after world_ is initialized (#2950)
  • Deduplicate joint trajectory points in Pilz Move Group Sequence capability (#2943)
  • Optimize MOVE_SHAPE operations for FCL (#3601)
  • Allow moving of all shapes of an object in one go (#3599)
  • Silent "empty quaternion" warning from poseMsgToEigen() (#3435)
  • Propagate "clear octomap" actions to monitoring planning scenes

File truncated at 100 lines see the full file

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged moveit_core at Robotics Stack Exchange

No version for distro eloquent showing humble. Known supported distros are highlighted in the buttons above.

Package Summary

Tags No category tags.
Version 2.14.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 2025-06-14
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

Core libraries used by MoveIt

Additional Links

Maintainers

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

Authors

  • Ioan Sucan
  • Sachin Chitta
  • Acorn Pooley
  • Dave Coleman

MoveIt Core

This repository includes core libraries used by MoveIt:

  • representation of kinematic models
  • collision detection interfaces and implementations
  • interfaces for kinematic solver plugins
  • interfaces for motion planning plugins
  • interfaces for controllers and sensors

These libraries do not depend on ROS (except ROS messages) and can be used independently.

CHANGELOG

Changelog for package moveit_core

2.14.0 (2025-06-13)

  • Fix seg fault with attached objects during motion execution (#3466)
  • Contributors: Marq Rasmussen

2.13.2 (2025-04-16)

2.13.1 (2025-04-15)

  • Make the destructors of the base classes of planning adapters virtual and close move_group gracefully (#3435)
  • fix: ensure attached objects update during motion execution (#3327)
  • Contributors: Cihat Kurtuluş Altıparmak, Marco Magri

2.13.0 (2025-02-15)

  • Reverts #2985, Ports moveit #3388 #3470 #3539 (#3284)
  • Add missing target dependencies to eigen_stl_containers (#3295)
  • Support including the names of other attached objects in [touch_link]{.title-ref} (#3276)
  • Fix: misleading error logs in RobotState::setFromIKSubgroups() (#3263)
  • Update includes for generate_parameter_library 0.4.0 (#3255)
  • Remove plugins from export set (#3227)
  • [Issue-879] Add const specifier to moveit_core (#3202)
  • Don't destroy objects on attach (#3205)
  • Update deprecated tf2 imports from .h to .hpp (#3197)
  • Remove ACM entries when removing collision objects (#3183)
  • handle continuous joints in getLowerAndUpperLimits (#3153)
  • Contributors: Aleksey Nogin, Jafar Uruç, Mario Prats, Mark Johnson, Marq Rasmussen, Michael Görner, Paul Gesel, Sebastian Castro, Robert Haschke, Zhong Jin, gayar

2.12.0 (2024-11-29)

  • Enhancement/use hpp for headers (#3113)
  • Removes unused deprecation.h file (#3128)
  • Add use_padding flag + deprecate checkCollisionUnpadded() functions (#3088)
  • Fixes flaky RobotState test (#3105)
  • Allow RobotState::setFromIK to work with subframes (#3077)
  • Fix jacobian calculation (#3069)
  • Port fixes for handling orientation constraints (#3052)
  • Fix createTrajectoryMessage (#3064)
  • Fix flipped comments in [joint_model.h]{.title-ref} (#3047)
  • add helper function to load robot from package name + urdf + srdf (#3039)
  • Fix Cartesian interpolation (#3020)
  • Update urdf/model.h -> urdf/model.hpp (#3003)
  • Contributors: Mario Prats, Paul Gesel, Robert Haschke, Sebastian Castro, Sebastian Jahr, Tom Noble

2.11.0 (2024-09-16)

  • Fix RobotState::getRigidlyConnectedParentLinkModel() (#2985)
  • Implement realtime Ruckig jerk-limited smoothing (#2956)
  • New implementation for computeCartesianPath() (#2916)
  • Don't set reset observer callback & set CB after world_ is initialized (#2950)
  • Deduplicate joint trajectory points in Pilz Move Group Sequence capability (#2943)
  • Optimize MOVE_SHAPE operations for FCL (#3601)
  • Allow moving of all shapes of an object in one go (#3599)
  • Silent "empty quaternion" warning from poseMsgToEigen() (#3435)
  • Propagate "clear octomap" actions to monitoring planning scenes

File truncated at 100 lines see the full file

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged moveit_core at Robotics Stack Exchange

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

Package Summary

Tags No category tags.
Version 2.14.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 2025-06-14
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

Core libraries used by MoveIt

Additional Links

Maintainers

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

Authors

  • Ioan Sucan
  • Sachin Chitta
  • Acorn Pooley
  • Dave Coleman

MoveIt Core

This repository includes core libraries used by MoveIt:

  • representation of kinematic models
  • collision detection interfaces and implementations
  • interfaces for kinematic solver plugins
  • interfaces for motion planning plugins
  • interfaces for controllers and sensors

These libraries do not depend on ROS (except ROS messages) and can be used independently.

CHANGELOG

Changelog for package moveit_core

2.14.0 (2025-06-13)

  • Fix seg fault with attached objects during motion execution (#3466)
  • Contributors: Marq Rasmussen

2.13.2 (2025-04-16)

2.13.1 (2025-04-15)

  • Make the destructors of the base classes of planning adapters virtual and close move_group gracefully (#3435)
  • fix: ensure attached objects update during motion execution (#3327)
  • Contributors: Cihat Kurtuluş Altıparmak, Marco Magri

2.13.0 (2025-02-15)

  • Reverts #2985, Ports moveit #3388 #3470 #3539 (#3284)
  • Add missing target dependencies to eigen_stl_containers (#3295)
  • Support including the names of other attached objects in [touch_link]{.title-ref} (#3276)
  • Fix: misleading error logs in RobotState::setFromIKSubgroups() (#3263)
  • Update includes for generate_parameter_library 0.4.0 (#3255)
  • Remove plugins from export set (#3227)
  • [Issue-879] Add const specifier to moveit_core (#3202)
  • Don't destroy objects on attach (#3205)
  • Update deprecated tf2 imports from .h to .hpp (#3197)
  • Remove ACM entries when removing collision objects (#3183)
  • handle continuous joints in getLowerAndUpperLimits (#3153)
  • Contributors: Aleksey Nogin, Jafar Uruç, Mario Prats, Mark Johnson, Marq Rasmussen, Michael Görner, Paul Gesel, Sebastian Castro, Robert Haschke, Zhong Jin, gayar

2.12.0 (2024-11-29)

  • Enhancement/use hpp for headers (#3113)
  • Removes unused deprecation.h file (#3128)
  • Add use_padding flag + deprecate checkCollisionUnpadded() functions (#3088)
  • Fixes flaky RobotState test (#3105)
  • Allow RobotState::setFromIK to work with subframes (#3077)
  • Fix jacobian calculation (#3069)
  • Port fixes for handling orientation constraints (#3052)
  • Fix createTrajectoryMessage (#3064)
  • Fix flipped comments in [joint_model.h]{.title-ref} (#3047)
  • add helper function to load robot from package name + urdf + srdf (#3039)
  • Fix Cartesian interpolation (#3020)
  • Update urdf/model.h -> urdf/model.hpp (#3003)
  • Contributors: Mario Prats, Paul Gesel, Robert Haschke, Sebastian Castro, Sebastian Jahr, Tom Noble

2.11.0 (2024-09-16)

  • Fix RobotState::getRigidlyConnectedParentLinkModel() (#2985)
  • Implement realtime Ruckig jerk-limited smoothing (#2956)
  • New implementation for computeCartesianPath() (#2916)
  • Don't set reset observer callback & set CB after world_ is initialized (#2950)
  • Deduplicate joint trajectory points in Pilz Move Group Sequence capability (#2943)
  • Optimize MOVE_SHAPE operations for FCL (#3601)
  • Allow moving of all shapes of an object in one go (#3599)
  • Silent "empty quaternion" warning from poseMsgToEigen() (#3435)
  • Propagate "clear octomap" actions to monitoring planning scenes

File truncated at 100 lines see the full file

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged moveit_core at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 2.14.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 2025-06-14
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

Core libraries used by MoveIt

Additional Links

Maintainers

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

Authors

  • Ioan Sucan
  • Sachin Chitta
  • Acorn Pooley
  • Dave Coleman

MoveIt Core

This repository includes core libraries used by MoveIt:

  • representation of kinematic models
  • collision detection interfaces and implementations
  • interfaces for kinematic solver plugins
  • interfaces for motion planning plugins
  • interfaces for controllers and sensors

These libraries do not depend on ROS (except ROS messages) and can be used independently.

CHANGELOG

Changelog for package moveit_core

2.14.0 (2025-06-13)

  • Fix seg fault with attached objects during motion execution (#3466)
  • Contributors: Marq Rasmussen

2.13.2 (2025-04-16)

2.13.1 (2025-04-15)

  • Make the destructors of the base classes of planning adapters virtual and close move_group gracefully (#3435)
  • fix: ensure attached objects update during motion execution (#3327)
  • Contributors: Cihat Kurtuluş Altıparmak, Marco Magri

2.13.0 (2025-02-15)

  • Reverts #2985, Ports moveit #3388 #3470 #3539 (#3284)
  • Add missing target dependencies to eigen_stl_containers (#3295)
  • Support including the names of other attached objects in [touch_link]{.title-ref} (#3276)
  • Fix: misleading error logs in RobotState::setFromIKSubgroups() (#3263)
  • Update includes for generate_parameter_library 0.4.0 (#3255)
  • Remove plugins from export set (#3227)
  • [Issue-879] Add const specifier to moveit_core (#3202)
  • Don't destroy objects on attach (#3205)
  • Update deprecated tf2 imports from .h to .hpp (#3197)
  • Remove ACM entries when removing collision objects (#3183)
  • handle continuous joints in getLowerAndUpperLimits (#3153)
  • Contributors: Aleksey Nogin, Jafar Uruç, Mario Prats, Mark Johnson, Marq Rasmussen, Michael Görner, Paul Gesel, Sebastian Castro, Robert Haschke, Zhong Jin, gayar

2.12.0 (2024-11-29)

  • Enhancement/use hpp for headers (#3113)
  • Removes unused deprecation.h file (#3128)
  • Add use_padding flag + deprecate checkCollisionUnpadded() functions (#3088)
  • Fixes flaky RobotState test (#3105)
  • Allow RobotState::setFromIK to work with subframes (#3077)
  • Fix jacobian calculation (#3069)
  • Port fixes for handling orientation constraints (#3052)
  • Fix createTrajectoryMessage (#3064)
  • Fix flipped comments in [joint_model.h]{.title-ref} (#3047)
  • add helper function to load robot from package name + urdf + srdf (#3039)
  • Fix Cartesian interpolation (#3020)
  • Update urdf/model.h -> urdf/model.hpp (#3003)
  • Contributors: Mario Prats, Paul Gesel, Robert Haschke, Sebastian Castro, Sebastian Jahr, Tom Noble

2.11.0 (2024-09-16)

  • Fix RobotState::getRigidlyConnectedParentLinkModel() (#2985)
  • Implement realtime Ruckig jerk-limited smoothing (#2956)
  • New implementation for computeCartesianPath() (#2916)
  • Don't set reset observer callback & set CB after world_ is initialized (#2950)
  • Deduplicate joint trajectory points in Pilz Move Group Sequence capability (#2943)
  • Optimize MOVE_SHAPE operations for FCL (#3601)
  • Allow moving of all shapes of an object in one go (#3599)
  • Silent "empty quaternion" warning from poseMsgToEigen() (#3435)
  • Propagate "clear octomap" actions to monitoring planning scenes

File truncated at 100 lines see the full file

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged moveit_core at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 2.14.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 2025-06-14
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

Core libraries used by MoveIt

Additional Links

Maintainers

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

Authors

  • Ioan Sucan
  • Sachin Chitta
  • Acorn Pooley
  • Dave Coleman

MoveIt Core

This repository includes core libraries used by MoveIt:

  • representation of kinematic models
  • collision detection interfaces and implementations
  • interfaces for kinematic solver plugins
  • interfaces for motion planning plugins
  • interfaces for controllers and sensors

These libraries do not depend on ROS (except ROS messages) and can be used independently.

CHANGELOG

Changelog for package moveit_core

2.14.0 (2025-06-13)

  • Fix seg fault with attached objects during motion execution (#3466)
  • Contributors: Marq Rasmussen

2.13.2 (2025-04-16)

2.13.1 (2025-04-15)

  • Make the destructors of the base classes of planning adapters virtual and close move_group gracefully (#3435)
  • fix: ensure attached objects update during motion execution (#3327)
  • Contributors: Cihat Kurtuluş Altıparmak, Marco Magri

2.13.0 (2025-02-15)

  • Reverts #2985, Ports moveit #3388 #3470 #3539 (#3284)
  • Add missing target dependencies to eigen_stl_containers (#3295)
  • Support including the names of other attached objects in [touch_link]{.title-ref} (#3276)
  • Fix: misleading error logs in RobotState::setFromIKSubgroups() (#3263)
  • Update includes for generate_parameter_library 0.4.0 (#3255)
  • Remove plugins from export set (#3227)
  • [Issue-879] Add const specifier to moveit_core (#3202)
  • Don't destroy objects on attach (#3205)
  • Update deprecated tf2 imports from .h to .hpp (#3197)
  • Remove ACM entries when removing collision objects (#3183)
  • handle continuous joints in getLowerAndUpperLimits (#3153)
  • Contributors: Aleksey Nogin, Jafar Uruç, Mario Prats, Mark Johnson, Marq Rasmussen, Michael Görner, Paul Gesel, Sebastian Castro, Robert Haschke, Zhong Jin, gayar

2.12.0 (2024-11-29)

  • Enhancement/use hpp for headers (#3113)
  • Removes unused deprecation.h file (#3128)
  • Add use_padding flag + deprecate checkCollisionUnpadded() functions (#3088)
  • Fixes flaky RobotState test (#3105)
  • Allow RobotState::setFromIK to work with subframes (#3077)
  • Fix jacobian calculation (#3069)
  • Port fixes for handling orientation constraints (#3052)
  • Fix createTrajectoryMessage (#3064)
  • Fix flipped comments in [joint_model.h]{.title-ref} (#3047)
  • add helper function to load robot from package name + urdf + srdf (#3039)
  • Fix Cartesian interpolation (#3020)
  • Update urdf/model.h -> urdf/model.hpp (#3003)
  • Contributors: Mario Prats, Paul Gesel, Robert Haschke, Sebastian Castro, Sebastian Jahr, Tom Noble

2.11.0 (2024-09-16)

  • Fix RobotState::getRigidlyConnectedParentLinkModel() (#2985)
  • Implement realtime Ruckig jerk-limited smoothing (#2956)
  • New implementation for computeCartesianPath() (#2916)
  • Don't set reset observer callback & set CB after world_ is initialized (#2950)
  • Deduplicate joint trajectory points in Pilz Move Group Sequence capability (#2943)
  • Optimize MOVE_SHAPE operations for FCL (#3601)
  • Allow moving of all shapes of an object in one go (#3599)
  • Silent "empty quaternion" warning from poseMsgToEigen() (#3435)
  • Propagate "clear octomap" actions to monitoring planning scenes

File truncated at 100 lines see the full file

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged moveit_core at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 2.14.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 2025-06-14
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

Core libraries used by MoveIt

Additional Links

Maintainers

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

Authors

  • Ioan Sucan
  • Sachin Chitta
  • Acorn Pooley
  • Dave Coleman

MoveIt Core

This repository includes core libraries used by MoveIt:

  • representation of kinematic models
  • collision detection interfaces and implementations
  • interfaces for kinematic solver plugins
  • interfaces for motion planning plugins
  • interfaces for controllers and sensors

These libraries do not depend on ROS (except ROS messages) and can be used independently.

CHANGELOG

Changelog for package moveit_core

2.14.0 (2025-06-13)

  • Fix seg fault with attached objects during motion execution (#3466)
  • Contributors: Marq Rasmussen

2.13.2 (2025-04-16)

2.13.1 (2025-04-15)

  • Make the destructors of the base classes of planning adapters virtual and close move_group gracefully (#3435)
  • fix: ensure attached objects update during motion execution (#3327)
  • Contributors: Cihat Kurtuluş Altıparmak, Marco Magri

2.13.0 (2025-02-15)

  • Reverts #2985, Ports moveit #3388 #3470 #3539 (#3284)
  • Add missing target dependencies to eigen_stl_containers (#3295)
  • Support including the names of other attached objects in [touch_link]{.title-ref} (#3276)
  • Fix: misleading error logs in RobotState::setFromIKSubgroups() (#3263)
  • Update includes for generate_parameter_library 0.4.0 (#3255)
  • Remove plugins from export set (#3227)
  • [Issue-879] Add const specifier to moveit_core (#3202)
  • Don't destroy objects on attach (#3205)
  • Update deprecated tf2 imports from .h to .hpp (#3197)
  • Remove ACM entries when removing collision objects (#3183)
  • handle continuous joints in getLowerAndUpperLimits (#3153)
  • Contributors: Aleksey Nogin, Jafar Uruç, Mario Prats, Mark Johnson, Marq Rasmussen, Michael Görner, Paul Gesel, Sebastian Castro, Robert Haschke, Zhong Jin, gayar

2.12.0 (2024-11-29)

  • Enhancement/use hpp for headers (#3113)
  • Removes unused deprecation.h file (#3128)
  • Add use_padding flag + deprecate checkCollisionUnpadded() functions (#3088)
  • Fixes flaky RobotState test (#3105)
  • Allow RobotState::setFromIK to work with subframes (#3077)
  • Fix jacobian calculation (#3069)
  • Port fixes for handling orientation constraints (#3052)
  • Fix createTrajectoryMessage (#3064)
  • Fix flipped comments in [joint_model.h]{.title-ref} (#3047)
  • add helper function to load robot from package name + urdf + srdf (#3039)
  • Fix Cartesian interpolation (#3020)
  • Update urdf/model.h -> urdf/model.hpp (#3003)
  • Contributors: Mario Prats, Paul Gesel, Robert Haschke, Sebastian Castro, Sebastian Jahr, Tom Noble

2.11.0 (2024-09-16)

  • Fix RobotState::getRigidlyConnectedParentLinkModel() (#2985)
  • Implement realtime Ruckig jerk-limited smoothing (#2956)
  • New implementation for computeCartesianPath() (#2916)
  • Don't set reset observer callback & set CB after world_ is initialized (#2950)
  • Deduplicate joint trajectory points in Pilz Move Group Sequence capability (#2943)
  • Optimize MOVE_SHAPE operations for FCL (#3601)
  • Allow moving of all shapes of an object in one go (#3599)
  • Silent "empty quaternion" warning from poseMsgToEigen() (#3435)
  • Propagate "clear octomap" actions to monitoring planning scenes

File truncated at 100 lines see the full file

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged moveit_core at Robotics Stack Exchange

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

Package Description

Core libraries used by MoveIt!

Additional Links

Maintainers

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

Authors

  • Ioan Sucan
  • Sachin Chitta
  • Acorn Pooley

MoveIt! Core

This repository includes core libraries used by MoveIt:

  • representation of kinematic models
  • collision detection interfaces and implementations
  • interfaces for kinematic solver plugins
  • interfaces for motion planning plugins
  • interfaces for controllers and sensors

These libraries do not depend on ROS (except ROS messages) and can be used independently.

CHANGELOG

Changelog for package moveit_core

0.9.18 (2020-01-24)

  • [maintanance] Removed dependency moveit_core -> moveit_experimental again
  • Contributors: Robert Haschke

0.9.17 (2019-07-09)

0.9.16 (2019-06-29)

  • [fix] Invert waypoint velocities on reverse (#1335)

  • [fix] Added missing robot state update to iterative spline parameterization (#1298)

  • [fix] Fix race condition when world object was removed (#1306)

  • [fix] Fixed calculation of Jacobian for prismatic joints (#1192)

  • [maintanance] Improve code quality (#1340)

  • [maintanance] Resolve catkin lint issues (#1137)

  • [maintanance] Cleanup Chomp packages (#1282)

    Moved collision_distance_field to moveit_core Add dependency moveit_core -> moveit_experimental

  • [maintanance] Add (manual) coverage analysis (#1133)

  • [maintanance] ConstraintSampler cleanup (#1247)

  • [maintanance] Fix clang issues (#1233, #1214)

  • [feature] Helper function to construct constraints from ROS params (#1253)

  • [feature] Allow appending of only a part of a trajectory (#1213)

  • Contributors: Alexander Gutenkunst, Ludovic Delval, Martin Oehler, Michael Görner, Mike Lautman, Milutin Nikolic, Robert Haschke

0.9.15 (2018-10-29)

  • [improvement] Exploit the fact that our transforms are isometries (instead of general affine transformations). #1091
  • [code] cleanup, improvements (#1099, #1108)
  • Contributors: Robert Haschke, Simon Schmeisser

0.9.14 (2018-10-24)

0.9.13 (2018-10-24)

  • [fix] TFs in subgroups of rigidly-connected links (#912)
  • [fix] Chomp package handling issue #1086 that was introduced in ubi-agni/hotfix-#1012
  • [fix] CurrentStateMonitor update callback for floating joints to handle non-identity joint origins #984
  • [fix] Eigen alignment issuses due to missing aligned allocation (#1039)
  • [fix] illegal pointer access (#989)
  • [fix] reset moveit_msgs::RobotState.is_diff to false (#968) This fixes a regression introduced in #939.
  • [fix] continous joint limits are always satisfied (#729)
  • [maintenance] using LOGNAME variable rather than strings (#1079)
  • [capability][chomp] Addition of CHOMP planning adapter for optimizing result of other planners (#1012)
  • [enhancement] Add missing distance check functions to allValid collision checker (#986)
  • [enhancement] Allow chains to have only one active joint (#983)

File truncated at 100 lines see the full file

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged moveit_core at Robotics Stack Exchange

Package Summary

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

Repository Summary

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

Package Description

Core libraries used by MoveIt!

Additional Links

Maintainers

  • Sachin Chitta
  • Ioan Sucan
  • Acorn Pooley
  • Michael Ferguson

Authors

  • Ioan Sucan
  • Sachin Chitta
  • Acorn Pooley

MoveIt! Core

This repository includes core libraries used by MoveIt:

  • representation of kinematic models
  • collision detection interfaces and implementations
  • interfaces for kinematic solver plugins
  • interfaces for motion planning plugins
  • interfaces for controllers and sensors

These libraries do not depend on ROS (except ROS messages) and can be used independently.

CHANGELOG

Changelog for package moveit_core

0.8.7 (2017-04-03)

  • Fix PlanarJointModel::getVariableRandomPositionsNearBy (#464)
  • Contributors: Dave Coleman, Tamaki Nishino

0.8.6 (2017-03-08)

0.8.4 (2017-02-06)

  • [fix] update link transforms in UnionConstraintSampler::project (#384)
  • [capability Addition of Set Joint Model Group Velocities and Accelerations Functions (#402)
  • [capability] time parameterization: use constants (#380)
  • [enhancement] multiple shapes in an attached collision object #421
  • [maintenance] Use static_cast to cast to const. (#433)
  • [fix] Replace unused service dependency with msg dep (#361)
  • [enhancement] Improved RobotState feedback for setFromIK() (#342)
  • Contributors: Dave Coleman, Maarten de Vries, Michael Goerner, Mike Lautman, Ruben, Ian McMahon, Robert Haschke

0.8.3 (2016-08-19)

  • 1st release after repository consolidation
  • [fix] Add object types when requesting attached bodies in planning scene msg. pushDiff also pushes attached bodies' types and colors
  • [improve] Cache robot FCL objects to avoid fcl::CollisionObject's being created every time a request is made ros-planning/moveit_core#295
  • [feat] Added maximum acceleration scaling factor ros-planning/moveit_core#273
  • Contributors: Levi Armstrong, Dave Coleman, Christian Dornhege, hemes, Michael Goerner, Robert Haschke, Maarten de Vries

0.8.2 (2016-06-17)

  • [feat] planning_scene updates: expose success state to caller. This is required to get the information back for the ApplyPlanningSceneService. #296
  • [sys] replaced cmake_modules dependency with eigen
  • Contributors: Michael Ferguson, Robert Haschke, Michael Goerner, Isaac I. Y. Saito

0.8.1 (2016-05-19)

  • Corrected check in getStateAtDurationFromStart (cherry-picking #291 from indigo-devel)
  • Contributors: Hamal Marino

0.8.0 (2016-05-18)

  • [feat] Added file and trajectory_msg to RobotState conversion functions #267
  • [feat] Added setJointVelocity and setJointEffort functions #261
  • [feat] KinematicsBase changes #248
  • [feat] added an ik_seed_state argument to the new getPositionIK(...) method
  • [feat] added new interface method for computing multiple ik solutions for a single pose
  • [fix] RevoluteJointModel::computeVariablePositions #282
  • [fix] getStateAtDurationFromStart would never execute as the check for number of waypoints was inverted #289
  • [fix] Revert "Use libfcl-dev rosdep key in kinetic" #287
  • [fix] memory leak in RobotState::attachBody #276. Fixing #275
  • [fix] New getOnlyOneEndEffectorTip() function #262
  • [fix] issue #258 in jade-devel #266
  • [fix] Segfault in parenthesis operator #254
  • [fix] API Change of shape_tools #242
  • [fix] Fixed bug in KinematicConstraintSet::decide that makes it evaluate only joint_constraints. #250
  • [fix] Prevent divide by zero #246
  • [fix] removed the 'f' float specifiers and corrected misspelled

File truncated at 100 lines see the full file

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged moveit_core at Robotics Stack Exchange

Package Summary

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

Repository Summary

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

Package Description

Core libraries used by MoveIt!

Additional Links

Maintainers

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

Authors

  • Ioan Sucan
  • Sachin Chitta
  • Acorn Pooley

MoveIt! Core

This repository includes core libraries used by MoveIt:

  • representation of kinematic models
  • collision detection interfaces and implementations
  • interfaces for kinematic solver plugins
  • interfaces for motion planning plugins
  • interfaces for controllers and sensors

These libraries do not depend on ROS (except ROS messages) and can be used independently.

CHANGELOG

Changelog for package moveit_core

0.7.14 (2018-10-20)

  • [fix] computation of shape_extents of links w/o shapes #766
  • [capability][revert] Revert "Improved IPTP by fitting a cubic spline (#382)"
  • Contributors: Dave Coleman, Martin Pecka, Robert Haschke

0.7.13 (2017-12-25)

  • [fix] Add missing logWarn argument (#707)
  • [fix] IKConstraintSampler: Fixed transform from end-effector to ik chain tip. #582
  • [fix] robotStateMsgToRobotState: is_diff==true => not empty #589
  • [capability] Multi DOF Trajectory only providing translation not velocity (#555)
  • [capability] Adds parameter lookup function for kinematics plugins (#701)
  • [improve] Make operator bool() explicit #696
  • [improve] Get msgs from Planning Scene #663
  • [improve] moveit_core: export DEPENDS on LIBFCL #632 https://github.com/ros-planning/moveit/pull/632>
  • [improve] RobotState: Changed multi-waypoint version of computeCartesianPath to test joint space jumps after all waypoints are generated. (#576)
  • [improve] Better debug output for IK tip frames (#603)
  • [improve] New debug console colors YELLOW PURPLE (#604)
  • Contributors: Dave Coleman, Dennis Hartmann, Henning Kayser, Isaac I.Y. Saito, Jorge Nicho, Michael Görner, Phil, Sarah Elliott, Simon Schmeisser, TroyCordie, v4hn

0.7.12 (2017-08-06)

  • [fix] segfault due to missing string format parameter. (#547)
  • [fix] doc-comment for robot_state::computeAABB (#516) The docstring says the format of the vector is [(minx, miny, minz, maxx, maxy, maxz)]{.title-ref}, but according to both the method's implementation and use in moveit, the format is rather [(minx, maxx, miny, maxy, minz, maxz)]{.title-ref}.
  • Contributors: Martin Pecka, henhenhen

0.7.11 (2017-06-21)

0.7.10 (2017-06-07)

  • [fix] checks for empty name arrays messages before parsing the robot state message data (#499) (#518)
  • Contributors: Jorge Nicho, Isaac I.Y. Saito

0.7.9 (2017-04-03)

  • [fix][moveit_core] PlanarJointModel::getVariableRandomPositionsNearBy (#464)
  • Contributors: Tamaki Nishino

0.7.8 (2017-03-08)

  • [fix][moveit_ros_warehouse] gcc6 build error #423
  • Contributors: Dmitry Rozhkov

0.7.7 (2017-02-06)

  • [enhancement] Handle multiple shapes in an attached collision object #421
  • [enhancement] Improved IPTP by fitting a cubic spline (#382)
  • [maintenance] Use static_cast to cast to const. (#434)
  • [capability] Handle multiple shapes in an attached collision object (#421)
  • [capability] Addition of Set Joint Model Group Velocities and Accelerations Functions (#402)
  • Contributors: Dave Coleman, G.A. vd. Hoorn, Isaac I.Y. Saito, Maarten de Vries, Mike Lautman, Ruben Burger, Michael Goerner

0.7.6 (2016-12-30)

0.7.5 (2016-12-25)

  • [enhancement] update link transforms in UnionConstraintSampler::project (#384). This extends #186 (0119d584bd77a754ed5108d0b222cbcb76326863).

File truncated at 100 lines see the full file

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Dependant Packages

Name Deps
abb_irb2400_moveit_plugins
cob_kinematics
cob_obstacle_distance_moveit
fanuc_lrmate200i_moveit_plugins
fanuc_lrmate200ib_moveit_plugins
fanuc_lrmate200ic_moveit_plugins
fanuc_m10ia_moveit_plugins
fanuc_m16ib_moveit_plugins
fanuc_m20ia_moveit_plugins
fanuc_m20ib_moveit_plugins
fanuc_m430ia_moveit_plugins
fanuc_m6ib_moveit_plugins
fanuc_r1000ia_moveit_plugins
fetch_ikfast_plugin
industrial_trajectory_filters
jsk_pcl_ros
jsk_pcl_ros_utils
moveit
moveit_experimental
moveit_kinematics
moveit_planners_chomp
chomp_motion_planner
moveit_planners_ompl
moveit_controller_manager_example
moveit_fake_controller_manager
moveit_ros_control_interface
moveit_simple_controller_manager
moveit_ros_manipulation
moveit_ros_move_group
moveit_ros_perception
moveit_ros_planning
moveit_runtime
moveit_setup_assistant
moveit_resources_prbt_ikfast_manipulator_plugin
moveit_sim_controller
moveit_visual_tools
pr2_arm_kinematics
trac_ik_kinematics_plugin
ur_kinematics
fanuc_lrmate200id_moveit_plugins
pr2_moveit_plugins
pr2_moveit_tests
moveit_tutorials
nextage_ik_plugin
staubli_rx160_moveit_plugins
force_torque_sensor_calib
katana_moveit_ikfast_plugin
turtlebot_arm_block_manipulation
turtlebot_arm_ikfast_plugin
descartes_core
descartes_moveit
descartes_planner
descartes_trajectory
baxter_ikfast_left_arm_plugin
baxter_ikfast_right_arm_plugin
moveit_simple_grasps
moveit_eus_ik_plugin
aubo_kinematics
aubo_trajectory
aubo_trajectory_filters
constrained_ik
industrial_collision_detection
industrial_moveit_benchmarking
stomp_moveit
stomp_plugins
moveit_controller_multidof
object_recognition_tabletop
ompl_visual_tools
rapid_pbd
romeo_moveit_actions

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged moveit_core at Robotics Stack Exchange

Package symbol

moveit_core package from moveit_core repo

moveit_core

ROS Distro
hydro

Package Summary

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

Repository Summary

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

Package Description

Core libraries used by MoveIt!

Additional Links

Maintainers

  • Sachin Chitta
  • Ioan Sucan
  • Acorn Pooley

Authors

  • Ioan Sucan
  • Sachin Chitta
  • Acorn Pooley

MoveIt Core

This repository includes core libraries used by MoveIt:

  • representation of kinematic models
  • collision detection interfaces and implementations
  • interfaces for kinematic solver plugins
  • interfaces for motion planning plugins
  • interfaces for controllers and sensors

These libraries do not depend on ROS and can be used independently.

Build Status

Build Status

CHANGELOG

Changelog for package moveit_core

0.5.11 (2015-01-21)

  • Added missing parameter to logWarn in planning_scene.
  • Contributors: Christian Dornhege, Ioan A Sucan

0.5.10 (2014-12-09)

  • Fix Manipulability Index Error for few DOF
  • Removed problematic assertion from default_constraint_samplers.cpp
  • Fixed missing test depends for tf_conversions
  • Allow setFromIK() with multiple poses to single IK solver
  • Added necessary const to recently added function
  • Added const where needed
  • Improved debug output
  • Removed duplicate functionality poseToMsg function
  • New setToRandomPositions function with custom rand num generator
  • Include angles' variables
  • Getter for all tips (links) of every end effector in a joint model group
  • New robot state to (file) stream conversion functions, documentation improvements
  • Added default values for iostream in print statements
  • Change PlanningScene constructor to RobotModelConstPtr
  • Documentation and made printTransform() public
  • Removed duplicate getSubgroups() function, added prefixes for changed log messages
  • Addressed consistency_limits issue
  • Reduced unnecessary joint position copying
  • Added getSubgroups() helper function to joint model groups
  • Maintain ordering of poses in order that IK solver expects
  • Added new setToRandomPositions function that allows custom random number generator to be specified
  • Split setToIKSolverFrame() into two functions
  • Add check for correct solver type
  • Allowed setFromIK to do whole body IK solving with multiple tips
  • Added angles as test dependency of constraint sampler
  • Contributors: Dave Coleman, Dave Hershberger, Ioan A Sucan, Sachin Chitta, costashatz, hersh

0.5.9 (2014-06-23)

  • Fixed bug in RevoluteJointModel::distance() giving large negative numbers.
  • kinematics_base: added an optional RobotState for context.
  • fix pick/place approach/retreat on indigo/14.04
  • Fixed bug in RevoluteJointModel::distance() giving large negative numbers.
  • IterativeParabolicTimeParameterization now ignores virtual joints.
  • kinematics_base: added an optional RobotState for context.
  • Removed check for multi-dof joints in iterative_time_parameterization.cpp.
  • fix pick/place approach/retreat on indigo/14.04
  • IterativeParabolicTimeParameterization now ignores virtual joints. When checking if all joints are single-DOF, it accepts multi-DOF joints only if they are also virtual.
  • Fix compiler warnings
  • Address [cppcheck: unreadVariable] warning.
  • Address [cppcheck: postfixOperator] warning.
  • Address [cppcheck: stlSize] warning.
  • Address [-Wunused-value] warning.
  • Address [-Wunused-variable] warning.
  • Address [-Wreturn-type] warning.
  • Address [-Wsign-compare] warning.
  • Address [-Wreorder] warning.
  • Allow joint model group to have use IK solvers with multiple tip frames
  • KinematicsBase support for multiple tip frames and IK requests with multiple poses
  • dynamics_solver: fix crashbug Ignore joint that does not exist (including the virtual joint if it is part of the group).
  • Changed KinematicsBase::supportsGroup() to use a more standard call signature.
  • Merged with hydro-devel
  • Removed unnecessary error output
  • Removed todo
  • Added support for legacy IK calls without solution_callback
  • Merge branch 'hydro-devel' into kinematic_base
  • Changed KinematicsBase::supportsGroup() to use a more standard call signature.
  • Added empty check.
  • computeCartesianPath waypoints double-up fix computeCartesianPath appends full trajectories between waypoints when given a vector of waypoints. As trajectories include their endpoints, this leads to the combined trajectory being generated with duplicate points at waypoints, which can lead to pauses or stuttering. This change skips the first point in trajectories generated between waypoints.
  • avoid unnecessary calculations
  • Created supportsGroup() test for IK solvers
  • from ros-planning/more-travis-tests More Travis test fixes.
  • Commented out failing test. run_tests_moveit_ros_perception requires glut library, and thus a video card or X server, but I haven't had any luck making such things work on Travis.
  • avoid unnecessary calculations If we are not going to use the missing vector then we should not create it (avoid an expensive operation).
  • Code cleanup
  • Allow joint model group to have use IK solvers with multiple tip

File truncated at 100 lines see the full file

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged moveit_core at Robotics Stack Exchange

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

Package Description

Core libraries used by MoveIt!

Additional Links

Maintainers

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

Authors

  • Ioan Sucan
  • Sachin Chitta
  • Acorn Pooley

MoveIt! Core

This repository includes core libraries used by MoveIt:

  • representation of kinematic models
  • collision detection interfaces and implementations
  • interfaces for kinematic solver plugins
  • interfaces for motion planning plugins
  • interfaces for controllers and sensors

These libraries do not depend on ROS (except ROS messages) and can be used independently.

CHANGELOG

Changelog for package moveit_core

0.9.18 (2020-01-24)

  • [maintanance] Removed dependency moveit_core -> moveit_experimental again
  • Contributors: Robert Haschke

0.9.17 (2019-07-09)

0.9.16 (2019-06-29)

  • [fix] Invert waypoint velocities on reverse (#1335)

  • [fix] Added missing robot state update to iterative spline parameterization (#1298)

  • [fix] Fix race condition when world object was removed (#1306)

  • [fix] Fixed calculation of Jacobian for prismatic joints (#1192)

  • [maintanance] Improve code quality (#1340)

  • [maintanance] Resolve catkin lint issues (#1137)

  • [maintanance] Cleanup Chomp packages (#1282)

    Moved collision_distance_field to moveit_core Add dependency moveit_core -> moveit_experimental

  • [maintanance] Add (manual) coverage analysis (#1133)

  • [maintanance] ConstraintSampler cleanup (#1247)

  • [maintanance] Fix clang issues (#1233, #1214)

  • [feature] Helper function to construct constraints from ROS params (#1253)

  • [feature] Allow appending of only a part of a trajectory (#1213)

  • Contributors: Alexander Gutenkunst, Ludovic Delval, Martin Oehler, Michael Görner, Mike Lautman, Milutin Nikolic, Robert Haschke

0.9.15 (2018-10-29)

  • [improvement] Exploit the fact that our transforms are isometries (instead of general affine transformations). #1091
  • [code] cleanup, improvements (#1099, #1108)
  • Contributors: Robert Haschke, Simon Schmeisser

0.9.14 (2018-10-24)

0.9.13 (2018-10-24)

  • [fix] TFs in subgroups of rigidly-connected links (#912)
  • [fix] Chomp package handling issue #1086 that was introduced in ubi-agni/hotfix-#1012
  • [fix] CurrentStateMonitor update callback for floating joints to handle non-identity joint origins #984
  • [fix] Eigen alignment issuses due to missing aligned allocation (#1039)
  • [fix] illegal pointer access (#989)
  • [fix] reset moveit_msgs::RobotState.is_diff to false (#968) This fixes a regression introduced in #939.
  • [fix] continous joint limits are always satisfied (#729)
  • [maintenance] using LOGNAME variable rather than strings (#1079)
  • [capability][chomp] Addition of CHOMP planning adapter for optimizing result of other planners (#1012)
  • [enhancement] Add missing distance check functions to allValid collision checker (#986)
  • [enhancement] Allow chains to have only one active joint (#983)

File truncated at 100 lines see the full file

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Dependant Packages

Name Deps
abb_irb2400_moveit_plugins
cob_obstacle_distance_moveit
exotica_core
fanuc_lrmate200i_moveit_plugins
fanuc_lrmate200ib_moveit_plugins
fanuc_lrmate200ic_moveit_plugins
fanuc_m10ia_moveit_plugins
fanuc_m16ib_moveit_plugins
fanuc_m20ia_moveit_plugins
fanuc_m20ib_moveit_plugins
fanuc_m430ia_moveit_plugins
fanuc_m6ib_moveit_plugins
fanuc_r1000ia_moveit_plugins
fetch_ikfast_plugin
industrial_trajectory_filters
jsk_pcl_ros
jsk_pcl_ros_utils
khi_duaro_ikfast_plugin
khi_rs_ikfast_plugin
moveit
moveit_kinematics
moveit_planners_chomp
chomp_motion_planner
moveit_chomp_optimizer_adapter
moveit_planners_ompl
moveit_controller_manager_example
moveit_fake_controller_manager
moveit_ros_control_interface
moveit_simple_controller_manager
moveit_ros_manipulation
moveit_ros_move_group
moveit_ros_perception
moveit_ros_planning
moveit_runtime
moveit_setup_assistant
moveit_opw_kinematics_plugin
moveit_resources_prbt_ikfast_manipulator_plugin
moveit_sim_controller
moveit_visual_tools
pilz_industrial_motion_testutils
pilz_trajectory_generation
prbt_ikfast_manipulator_plugin
prbt_support
pr2_arm_kinematics
trac_ik_kinematics_plugin
ur_kinematics
fanuc_lrmate200id_moveit_plugins
fsrobo_r_trajectory_filters
pr2_moveit_plugins
pr2_moveit_tests
moveit_tutorials
open_manipulator_with_tb3_tools
nextage_ik_plugin
hand_kinematics
sr_robot_commander
staubli_rx160_moveit_plugins
choreo_descartes_planner
choreo_process_planning
framefab_irb6600_workspace_ikfast_rail_robot_manipulator_plugin
choreo_kr150_2_workspace_ikfast_rail_robot_manipulator_plugin
choreo_kr5_arc_workspace_ikfast_rail_robot_manipulator_plugin
kr6_r900_workspace_ikfast_manipulator_plugin
choreo_visual_tools
doosan_robotics
force_torque_sensor_calib
jog_controller
katana_moveit_ikfast_plugin
motoman_mh5_ikfast_manipulator_plugin
move_base_to_manip
stomp_moveit
stomp_plugins
turtlebot_arm_block_manipulation
turtlebot_arm_ikfast_plugin
turtlebot_arm_object_manipulation
xarm_planner

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged moveit_core at Robotics Stack Exchange

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 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

Core libraries used by MoveIt!

Additional Links

Maintainers

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

Authors

  • Ioan Sucan
  • Sachin Chitta
  • Acorn Pooley

MoveIt! Core

This repository includes core libraries used by MoveIt:

  • representation of kinematic models
  • collision detection interfaces and implementations
  • interfaces for kinematic solver plugins
  • interfaces for motion planning plugins
  • interfaces for controllers and sensors

These libraries do not depend on ROS (except ROS messages) and can be used independently.

CHANGELOG

Changelog for package moveit_core

1.0.11 (2022-09-13)

1.0.10 (2022-03-06)

  • Add Ptr definitions for TimeParameterization classes (#3078)
  • Contributors: Michael Görner

1.0.9 (2022-01-09)

  • Use moveit-resources@master (#2951)
    • Simplify launch files to use the test_environment.launch files from moveit_resources@master
    • 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.
  • Make TimeParameterization classes polymorphic (#3023)
  • Move MoveItErrorCode class to moveit_core (#3009)
  • Provide MOVEIT_VERSION_CHECK macro (#2997)
  • Fix padding collision attached objects (#2721)
  • Contributors: Michael Görner, Robert Haschke, Toru Kuga, Andrea Pupa

1.0.8 (2021-05-23)

  • RobotState interpolation: warn if interpolation parameter is out of range [0, 1] (#2664)
  • Python bindings for moveit_core (#2547 / #2651)
  • New function setJointGroupActivePositions sets the position of active joints (#2456)
  • Set rotation value of Cartesian MaxEEFStep by default (#2614)
  • Make setToIKSolverFrame accessible again (#2580)
  • Add get_active_joint_names() (#2533)
  • Update doxygen comments for distance() and interpolate() (#2528)
  • Clean up collision-related log statements (#2480)
  • Fix RobotState::dropAccelerations/dropEffort to not drop velocities (#2478)
  • Fix doxygen documentation for setToIKSolverFrame (#2461)
  • Fix validation of orientation constraints (#2434)
  • Fix OrientationConstraint::decide (#2414)
  • Changed processing_thread_ spin to use std::make_unique instead of new (#2412)
  • RobotModelBuilder: Add parameter to specify the joint rotation axis
  • RobotModelBuilder: Allow adding end effectors (#2454)
  • Contributors: AndyZe, JafarAbdi, Michael Görner, Peter Mitrano, Robert Haschke, Simon Schmeisser, Stuart Anderson, Thomas G, Tyler Weaver, sevangelatos, John Stechschulte

1.0.7 (2020-11-20)

  • [feature] Handle multiple link libraries for FCL (#2325)
  • [feature] Add comment to MOVEIT_CLASS_FORWARD (#2315)
  • [feature] Add a utility to print collision pairs (#2278) (#2275)
  • [maint] Move constraint representation dox to moveit_tutorials (#2147)
  • [maint] Update collision-related comments (#2382)
  • Contributors: AndyZe, Dave Coleman, Felix von Drigalski, Ghenohenomohe, Robert Haschke

1.0.6 (2020-08-19)

  • [maint] Adapt repository for splitted moveit_resources layout (#2199)
  • [maint] Migrate to clang-format-10, Fix warnings
  • [maint] Optimize includes (#2229)
  • [maint] Fix docs in robot_state.h (#2215)
  • Contributors: Jeroen, Markus Vieth, Michael Görner, Robert Haschke

1.0.5 (2020-07-08)

  • [fix] Fix memory leaks related to geometric shapes usage (#2138)
  • [fix] Prevent collision checking segfault if octomap has NULL root

File truncated at 100 lines see the full file

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Dependant Packages

Name Deps
abb_irb2400_moveit_plugins
cob_obstacle_distance_moveit
exotica_core
fanuc_lrmate200i_moveit_plugins
fanuc_lrmate200ib_moveit_plugins
fanuc_lrmate200ic_moveit_plugins
fanuc_m10ia_moveit_plugins
fanuc_m16ib_moveit_plugins
fanuc_m20ia_moveit_plugins
fanuc_m20ib_moveit_plugins
fanuc_m430ia_moveit_plugins
fanuc_m6ib_moveit_plugins
fanuc_r1000ia_moveit_plugins
fetch_ikfast_plugin
industrial_trajectory_filters
jsk_pcl_ros
jsk_pcl_ros_utils
khi_duaro_ikfast_plugin
khi_rs_ikfast_plugin
moveit
moveit_kinematics
moveit_planners_chomp
chomp_motion_planner
moveit_chomp_optimizer_adapter
moveit_planners_ompl
pilz_industrial_motion_planner
pilz_industrial_motion_planner_testutils
moveit_controller_manager_example
moveit_fake_controller_manager
moveit_ros_control_interface
moveit_simple_controller_manager
moveit_ros_manipulation
moveit_ros_move_group
moveit_ros_occupancy_map_monitor
moveit_ros_perception
moveit_ros_planning
moveit_runtime
moveit_setup_assistant
moveit_opw_kinematics_plugin
moveit_resources_prbt_ikfast_manipulator_plugin
moveit_sim_controller
moveit_visual_tools
pilz_industrial_motion_testutils
pilz_trajectory_generation
pilz_control
prbt_ikfast_manipulator_plugin
prbt_moveit_config
prbt_support
pincher_arm_ikfast_plugin
pincher_arm_moveit_demos
pr2_arm_kinematics
robot_body_filter
trac_ik_kinematics_plugin
ur_kinematics
fanuc_lrmate200id_moveit_plugins
fsrobo_r_trajectory_filters
pr2_moveit_plugins
pr2_moveit_tests
moveit_tutorials
open_manipulator_with_tb3_tools
nextage_ik_plugin
sr_error_reporter
hand_kinematics
sr_robot_commander
staubli_rx160_moveit_plugins

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

Recent questions tagged moveit_core at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 1.1.16
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 2025-04-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

Core libraries used by MoveIt

Additional Links

Maintainers

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

Authors

  • Ioan Sucan
  • Sachin Chitta
  • Acorn Pooley

MoveIt Core

This repository includes core libraries used by MoveIt:

  • representation of kinematic models
  • collision detection interfaces and implementations
  • interfaces for kinematic solver plugins
  • interfaces for motion planning plugins
  • interfaces for controllers and sensors

These libraries do not depend on ROS (except ROS messages) and can be used independently.

CHANGELOG

Changelog for package moveit_core

1.1.16 (2024-10-07)

  • Fix Cartesian interpolation: for multiple waypoints continue from latest RobotState (#3652)
  • Contributors: Robert Haschke

1.1.15 (2024-09-09)

  • Disable ruckig's webclient support in MoveIt build (#3636)
  • New implementation for computeCartesianPath (#3618)
  • Optimize MOVE_SHAPE operations for FCL (#3601)
  • Provide violated bounds for a JointConstraint
  • PSM: Correctly handle full planning scene message (#3610)
  • Contributors: Captain Yoshi, Michael Görner, Robert Haschke

1.1.14 (2024-05-27)

  • Allow moving of all shapes of an object in one go (#3599)
  • Add benchmark dependency in moveit_core's package.xml
  • Benchmarking with Google benchmark (#3565)
  • Cleanup const-ref arguments to double+int (#3560)
  • Use min instead of multiplication to combine relative and absolute check (#3556)
  • Find pybind11_catkin early (#3552)
  • Allow links with slashes again (#3539)
  • Support ompl::ompl cmake target (#3549)
  • RobotState: Initialize joint transforms of fixed joints (#3541)
  • Pass more distance information out from FCL collision check (#3531)
  • Fix segfault when planning with differential drive planar joints (#3457)
  • Consider distance field padding for spheres (#3506)
  • Remove unused variables (#3507)
  • Gracefully handle zero-size bodies in determineCollisionSpheres() (#3504)
  • Use new API for providing RNG to make some test results more consistant (#3501)
  • More URDF validation (#3499)
  • PlanningRequestAdapterChain: Fix added_path_index vector (#3464)
  • Constrain orocos_kdl to ROS melodic
  • moveit_core: make angles a build_depend rather than a test_depend (#3483)
  • Contributors: Ben Wolsieffer, Captain Yoshi, Hugal31, Lucas Walter, Michael Görner, Robert Haschke, SchneiderC1, Scott Chow, Simon Schmeisser, Stephanie Eng

1.1.13 (2023-07-28)

  • Avoid global transforms in getRigidlyConnectedParentLinkModel() (#3470)
    • RobotState::setFromIK: ensure up-to-date state before calling IK solver
    • Remove unimplemented RobotState::getSubframeTransformInLinkFrame()
  • Add missing include (#3451)
  • Fix Jacobian calculation for planar joint (#3439)
  • Silent "empty quaternion" warning from poseMsgToEigen() (#3435)
  • Contributors: Cong Liu, Ivo Vatavuk, Robert Haschke

1.1.12 (2023-05-13)

  • Generalize RobotState::setFromIK() (https://github.com/ros-planning/moveit/issues/3388)
  • Time parameterization with torque limits, based on TOTG (#3412, #3427)
  • Make XmlRpcValue arguments const references (#3419)
  • Differential drive for planar Joints (#3359)
  • Fix deprecation warnings in Debian bookworm (#3397)
  • Add JointModel::satisfiesAccelerationBounds() (#3396)
  • Add CSM tests (#3395)
  • Fix TOTG: could return vels/accels greater than the limits (#3394)

File truncated at 100 lines see the full file

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Recent questions tagged moveit_core at Robotics Stack Exchange