Skip to content

Commit 4361fe0

Browse files
silanus23Copilot
andauthored
Update nav2_util/test/test_path_utils.cpp
Co-authored-by: Copilot <[email protected]> Signed-off-by: silanus <[email protected]>
1 parent 4a10fbb commit 4361fe0

File tree

1 file changed

+6
-2
lines changed

1 file changed

+6
-2
lines changed

nav2_util/test/test_path_utils.cpp

Lines changed: 6 additions & 2 deletions
Original file line numberDiff line numberDiff line change
@@ -156,8 +156,12 @@ class RetracingPathTest : public ::testing::Test
156156
{
157157
for (int i = 0; i <= 10; ++i) {target_path.poses.push_back(createPose(i, 0.0));}
158158
for (int i = 9; i >= 0; --i) {target_path.poses.push_back(createPose(i, 0.0));}
159-
for (int i = 0; i <= 10; ++i) {robot_trajectory.push_back(createPose(i, 0.5));}
160-
for (int i = 9; i >= 0; --i) {robot_trajectory.push_back(createPose(i, 0.5));}
159+
for (int i = 0; i <= 10; ++i) {
160+
robot_trajectory.push_back(createPose(i, 0.5));
161+
}
162+
for (int i = 9; i >= 0; --i) {
163+
robot_trajectory.push_back(createPose(i, 0.5));
164+
}
161165
}
162166
nav_msgs::msg::Path target_path;
163167
std::vector<geometry_msgs::msg::PoseStamped> robot_trajectory;

0 commit comments

Comments
 (0)