Skip to content

Commit

Permalink
Remove L1
Browse files Browse the repository at this point in the history
  • Loading branch information
Abishalini committed Jul 7, 2023
1 parent b573b39 commit 2c9afca
Showing 1 changed file with 1 addition and 1 deletion.
2 changes: 1 addition & 1 deletion core/src/stages/connect.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -60,7 +60,7 @@ Connect::Connect(const std::string& name, const GroupPlannerVector& planners) :
p.declare<moveit_msgs::msg::Constraints>("path_constraints", moveit_msgs::msg::Constraints(),
"constraints to maintain during trajectory");
p.declare<float>("goal_tolerance", 0.02,
"L1 distance between goal state and end of trajectory state should be within this tolerance");
"Distance between goal state and end of trajectory state should be within this tolerance");
properties().declare<TimeParameterizationPtr>("merge_time_parameterization",
std::make_shared<TimeOptimalTrajectoryGeneration>());

Expand Down

0 comments on commit 2c9afca

Please sign in to comment.