Skip to content

Commit

Permalink
Edit comment
Browse files Browse the repository at this point in the history
Signed-off-by: mini-1235 <[email protected]>
  • Loading branch information
mini-1235 committed Jan 29, 2025
1 parent 342378e commit 2c510d9
Showing 1 changed file with 2 additions and 2 deletions.
4 changes: 2 additions & 2 deletions nav2_system_tests/src/planning/test_planner_is_path_valid.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -51,7 +51,7 @@ TEST(testIsPathValid, testIsPathValid)
is_path_valid = planner_tester->isPathValid(path, max_cost, consider_unknown_as_obstacle);
EXPECT_FALSE(is_path_valid);

// valid path, contains NO_INFORMATION(255)
// valid path
path.poses.clear();
for (float i = 0; i < 10; i += 1.0) {
geometry_msgs::msg::PoseStamped pose;
Expand All @@ -62,7 +62,7 @@ TEST(testIsPathValid, testIsPathValid)
is_path_valid = planner_tester->isPathValid(path, max_cost, consider_unknown_as_obstacle);
EXPECT_TRUE(is_path_valid);

// valid path, contains NO_INFORMATION(255)
// valid path, but contains NO_INFORMATION(255)
path.poses.clear();
consider_unknown_as_obstacle = true;
for (float i = 0; i < 10; i += 1.0) {
Expand Down

0 comments on commit 2c510d9

Please sign in to comment.