Skip to content

Commit 6ce67d1

Browse files
committed
Fix deprecated computeCartesianPath()
1 parent b694b64 commit 6ce67d1

File tree

1 file changed

+1
-2
lines changed

1 file changed

+1
-2
lines changed

doc/move_group_interface/src/move_group_interface_tutorial.cpp

Lines changed: 1 addition & 2 deletions
Original file line numberDiff line numberDiff line change
@@ -301,9 +301,8 @@ int main(int argc, char** argv)
301301
// Warning - disabling the jump threshold while operating real hardware can cause
302302
// large unpredictable motions of redundant joints and could be a safety issue
303303
moveit_msgs::RobotTrajectory trajectory;
304-
const double jump_threshold = 0.0;
305304
const double eef_step = 0.01;
306-
double fraction = move_group_interface.computeCartesianPath(waypoints, eef_step, jump_threshold, trajectory);
305+
double fraction = move_group_interface.computeCartesianPath(waypoints, eef_step, trajectory);
307306
ROS_INFO_NAMED("tutorial", "Visualizing plan 4 (Cartesian path) (%.2f%% achieved)", fraction * 100.0);
308307

309308
// Visualize the plan in RViz

0 commit comments

Comments
 (0)