diff --git a/msg/CartesianPoint.msg b/msg/CartesianPoint.msg index 3c83676..d320e38 100644 --- a/msg/CartesianPoint.msg +++ b/msg/CartesianPoint.msg @@ -1,4 +1,4 @@ # This message defines a point in a cartesian trajectory geometry_msgs/Pose pose geometry_msgs/Twist velocity -geometry_msgs/Accel acceleration \ No newline at end of file +geometry_msgs/Accel acceleration diff --git a/msg/JointConstraint.msg b/msg/JointConstraint.msg index 8beaa16..ebd59c5 100644 --- a/msg/JointConstraint.msg +++ b/msg/JointConstraint.msg @@ -7,4 +7,4 @@ float64 tolerance_above float64 tolerance_below # A weighting factor for this constraint (denotes relative importance to other constraints. Closer to zero means less important) -float64 weight \ No newline at end of file +float64 weight diff --git a/msg/PositionIKRequest.msg b/msg/PositionIKRequest.msg index 559e020..942044c 100644 --- a/msg/PositionIKRequest.msg +++ b/msg/PositionIKRequest.msg @@ -45,4 +45,3 @@ geometry_msgs/PoseStamped[] pose_stamped_vector # Maximum allowed time for IK calculation duration timeout - diff --git a/srv/LoadMap.srv b/srv/LoadMap.srv index f87f11d..536602a 100644 --- a/srv/LoadMap.srv +++ b/srv/LoadMap.srv @@ -1,3 +1,3 @@ string filename --- -bool success \ No newline at end of file +bool success diff --git a/srv/SaveMap.srv b/srv/SaveMap.srv index ce824d9..f68a58b 100644 --- a/srv/SaveMap.srv +++ b/srv/SaveMap.srv @@ -3,5 +3,3 @@ string filename --- bool success - - diff --git a/srv/SetPlannerParams.srv b/srv/SetPlannerParams.srv index 9b863f2..7c57e23 100644 --- a/srv/SetPlannerParams.srv +++ b/srv/SetPlannerParams.srv @@ -14,4 +14,3 @@ PlannerParams params bool replace --- -