Skip to content

Commit bc977e0

Browse files
committed
Formatting
1 parent 62f107b commit bc977e0

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
@@ -57,7 +57,8 @@ Connect::Connect(const std::string& name, const GroupPlannerVector& planners) :
5757

5858
auto& p = properties();
5959
p.declare<MergeMode>("merge_mode", WAYPOINTS, "merge mode");
60-
p.declare<double>("max_distance", 1e-4, "maximally accepted joint configuration distance between trajectory endpoint and goal state");
60+
p.declare<double>("max_distance", 1e-4,
61+
"maximally accepted joint configuration distance between trajectory endpoint and goal state");
6162
p.declare<moveit_msgs::msg::Constraints>("path_constraints", moveit_msgs::msg::Constraints(),
6263
"constraints to maintain during trajectory");
6364
properties().declare<TimeParameterizationPtr>("merge_time_parameterization",

0 commit comments

Comments
 (0)