Skip to content

Commit

Permalink
ci(pre-commit): autofix
Browse files Browse the repository at this point in the history
  • Loading branch information
pre-commit-ci[bot] committed Jun 23, 2023
1 parent b2b15a2 commit 468a0bb
Show file tree
Hide file tree
Showing 3 changed files with 10 additions and 6 deletions.
Original file line number Diff line number Diff line change
Expand Up @@ -126,9 +126,10 @@ inline bool smoothPath(
}
// Resample trajectory with ego-velocity based interval distances
auto traj_resampled = smoother->resampleTrajectory(traj_with_ego_point_on_path, v0, nearest_idx);
const auto traj_resampled_closest = tier4_autoware_utils::findFirstNearestIndexWithSoftConstraints(
*traj_resampled, current_pose, planner_data->ego_nearest_dist_threshold,
planner_data->ego_nearest_yaw_threshold);
const auto traj_resampled_closest =
tier4_autoware_utils::findFirstNearestIndexWithSoftConstraints(
*traj_resampled, current_pose, planner_data->ego_nearest_dist_threshold,
planner_data->ego_nearest_yaw_threshold);
std::vector<TrajectoryPoints> debug_trajectories;
// Clip trajectory from closest point
TrajectoryPoints clipped;
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -109,7 +109,8 @@ size_t calcSegmentIndexFromPointIndex(
return 0;
}

const double offset_to_seg = tier4_autoware_utils::calcLongitudinalOffsetToSegment(points, idx, point);
const double offset_to_seg =
tier4_autoware_utils::calcLongitudinalOffsetToSegment(points, idx, point);
if (0 < offset_to_seg) {
return idx;
}
Expand Down
6 changes: 4 additions & 2 deletions planning/behavior_velocity_planner/src/utilization/util.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -596,7 +596,8 @@ boost::optional<geometry_msgs::msg::Pose> insertStopPoint(
const geometry_msgs::msg::Point & stop_point, PathWithLaneId & output)
{
const size_t base_idx = tier4_autoware_utils::findNearestSegmentIndex(output.points, stop_point);
const auto insert_idx = tier4_autoware_utils::insertStopPoint(base_idx, stop_point, output.points);
const auto insert_idx =
tier4_autoware_utils::insertStopPoint(base_idx, stop_point, output.points);

if (!insert_idx) {
return {};
Expand All @@ -608,7 +609,8 @@ boost::optional<geometry_msgs::msg::Pose> insertStopPoint(
boost::optional<geometry_msgs::msg::Pose> insertStopPoint(
const geometry_msgs::msg::Point & stop_point, const size_t stop_seg_idx, PathWithLaneId & output)
{
const auto insert_idx = tier4_autoware_utils::insertStopPoint(stop_seg_idx, stop_point, output.points);
const auto insert_idx =
tier4_autoware_utils::insertStopPoint(stop_seg_idx, stop_point, output.points);

if (!insert_idx) {
return {};
Expand Down

0 comments on commit 468a0bb

Please sign in to comment.