Skip to content

Commit 819e560

Browse files
authored
Improve description of max_distance property of Connect stage (moveit#564)
1 parent 6b0f2c8 commit 819e560

File tree

1 file changed

+2
-1
lines changed

1 file changed

+2
-1
lines changed

core/src/stages/connect.cpp

Lines changed: 2 additions & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -55,7 +55,8 @@ Connect::Connect(const std::string& name, const GroupPlannerVector& planners) :
5555

5656
auto& p = properties();
5757
p.declare<MergeMode>("merge_mode", WAYPOINTS, "merge mode");
58-
p.declare<double>("max_distance", 1e-4, "maximally accepted distance between end and goal sate");
58+
p.declare<double>("max_distance", 1e-4,
59+
"maximally accepted joint configuration distance between trajectory endpoint and goal state");
5960
p.declare<moveit_msgs::Constraints>("path_constraints", moveit_msgs::Constraints(),
6061
"constraints to maintain during trajectory");
6162
properties().declare<TimeParameterizationPtr>("merge_time_parameterization",

0 commit comments

Comments
 (0)