Skip to content

Commit 3f17ebf

Browse files
committed
fix lint
Signed-off-by: Maxime CLEMENT <maxime.clement@tier4.jp>
1 parent 7a9c4ad commit 3f17ebf

File tree

2 files changed

+2
-2
lines changed

2 files changed

+2
-2
lines changed

planning/behavior_velocity_out_of_lane_module/src/decisions.cpp

+1-1
Original file line numberDiff line numberDiff line change
@@ -79,7 +79,7 @@ std::optional<std::pair<double, double>> object_time_to_range(
7979

8080
for (const auto & predicted_path : object.kinematics.predicted_paths) {
8181
const auto unique_path_points = motion_utils::removeOverlapPoints(predicted_path.path);
82-
if(unique_path_points.size() < 2) continue;
82+
if (unique_path_points.size() < 2) continue;
8383
const auto time_step = rclcpp::Duration(predicted_path.time_step).seconds();
8484
const auto enter_point =
8585
geometry_msgs::msg::Point().set__x(range.entering_point.x()).set__y(range.entering_point.y());

planning/behavior_velocity_out_of_lane_module/src/filter_predicted_objects.hpp

+1-1
Original file line numberDiff line numberDiff line change
@@ -50,7 +50,7 @@ void cut_predicted_path_beyond_line(
5050
}
5151
path_segment.first = path_segment.second;
5252
}
53-
if(found) {
53+
if (found) {
5454
auto cut_idx = stop_line_idx;
5555
double arc_length = 0;
5656
while (cut_idx > 0 && arc_length < object_front_overhang) {

0 commit comments

Comments
 (0)