You signed in with another tab or window. Reload to refresh your session.You signed out in another tab or window. Reload to refresh your session.You switched accounts on another tab or window. Reload to refresh your session.Dismiss alert
CHOMP does not respect the joint constraints (moveit_msgs::msg::JointConstraint) when planning a motion.
ROS Distro
Humble
OS and version
Ubuntu 22.04.
Source or binary build?
Binary
If binary, which release version?
2.5.5.
If source, which branch?
No response
Which RMW are you using?
None
Steps to Reproduce
Get a working robot arm simulation in Moveit2, created using Moveit Setup Assistant. Doesn't matter which robot in particular is in use.
If it is possible plan and execute motions using this simulation - the step succeeded.
Description
CHOMP does not respect the joint constraints (
moveit_msgs::msg::JointConstraint
) when planning a motion.ROS Distro
Humble
OS and version
Ubuntu 22.04.
Source or binary build?
Binary
If binary, which release version?
2.5.5.
If source, which branch?
No response
Which RMW are you using?
None
Steps to Reproduce
Get a working robot arm simulation in Moveit2, created using Moveit Setup Assistant. Doesn't matter which robot in particular is in use.
If it is possible plan and execute motions using this simulation - the step succeeded.
Install CHOMP motion planner
sudo apt-get install ros-humble-moveit-planners-chomp
.Create and add CHOMP config file
chomp_planning.yaml
at<robot>_moveit_config/config
.File content in my case:
Here is the code that I used for it:
To make sure that joint constraints impact the motion planning, I advice to:
Expected behavior
CHOMP takes into account added joint constraints when planning a motion.
Actual behavior
CHOMP plans a "valid" motion, which gets rejected by Moveit due to joint constraints violation.
Backtrace or Console output
Can somebody confirm or deny this behavior, please?
The text was updated successfully, but these errors were encountered: