Skip to content

Commit

Permalink
Merge pull request #35 from captain-yoshi/fix-goal-tolerance
Browse files Browse the repository at this point in the history
Fix goal position tolerances from box primitive
  • Loading branch information
jrgnicho authored Oct 20, 2021
2 parents 599ccf8 + 2558300 commit 30bacd1
Showing 1 changed file with 6 additions and 6 deletions.
12 changes: 6 additions & 6 deletions stomp_moveit/src/utils/kinematics.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -366,9 +366,9 @@ bool decodeCartesianConstraint(moveit::core::RobotModelConstPtr model,const move
}

using SP = shape_msgs::SolidPrimitive;
tolerance[0] = bv.dimensions[SP::BOX_X];
tolerance[1] = bv.dimensions[SP::BOX_Y];
tolerance[2] = bv.dimensions[SP::BOX_Z];
tolerance[0] = bv.dimensions[SP::BOX_X] / 2.0;
tolerance[1] = bv.dimensions[SP::BOX_Y] / 2.0;
tolerance[2] = bv.dimensions[SP::BOX_Z] / 2.0;
}
break;

Expand Down Expand Up @@ -497,9 +497,9 @@ EigenSTL::vector_Affine3d sampleCartesianPoses(const moveit_msgs::Constraints& c
}

using SP = shape_msgs::SolidPrimitive;
tolerances[0] = bv.dimensions[SP::BOX_X];
tolerances[1] = bv.dimensions[SP::BOX_Y];
tolerances[2] = bv.dimensions[SP::BOX_Z];
tolerances[0] = bv.dimensions[SP::BOX_X] / 2.0;
tolerances[1] = bv.dimensions[SP::BOX_Y] / 2.0;
tolerances[2] = bv.dimensions[SP::BOX_Z] / 2.0;
}
break;

Expand Down

0 comments on commit 30bacd1

Please sign in to comment.