Skip to content

Commit b1481a1

Browse files
style(pre-commit): autofix
1 parent 20ea6f8 commit b1481a1

File tree

8 files changed

+8
-11
lines changed

8 files changed

+8
-11
lines changed

planning/autoware_path_optimizer/include/autoware/path_optimizer/mpt_optimizer.hpp

+2-4
Original file line numberDiff line numberDiff line change
@@ -111,7 +111,6 @@ struct ReferencePoint
111111

112112
double getYaw() const { return tf2::getYaw(pose.orientation); }
113113

114-
115114
friend std::ostream & operator<<(std::ostream & os, const ReferencePoint & ref_point)
116115
{
117116
os << "ReferencePoint: {\n";
@@ -144,8 +143,7 @@ struct ReferencePoint
144143
os << "nullopt";
145144
}
146145
os << ",\n";
147-
os << "\toptimized_kinematic_state: " << ref_point.optimized_kinematic_state
148-
<< ",\n";
146+
os << "\toptimized_kinematic_state: " << ref_point.optimized_kinematic_state << ",\n";
149147
os << "\toptimized_input: " << ref_point.optimized_input << ",\n";
150148
os << "\tslack_variables: ";
151149
if (ref_point.slack_variables) {
@@ -227,7 +225,7 @@ class MPTOptimizer
227225
Eigen::MatrixXd linear;
228226
Eigen::VectorXd lower_bound;
229227
Eigen::VectorXd upper_bound;
230-
228+
231229
friend std::ostream & operator<<(std::ostream & os, const ConstraintMatrix & matrix)
232230
{
233231
os << "ConstraintMatrix: {\n";

planning/autoware_path_optimizer/include/autoware/path_optimizer/node.hpp

+1-1
Original file line numberDiff line numberDiff line change
@@ -150,7 +150,7 @@ class PathOptimizer : public rclcpp::Node
150150
std::unique_ptr<autoware_utils::PublishedTimePublisher> published_time_publisher_;
151151

152152
autoware_utils::StopWatch<std::chrono::milliseconds> stop_watch_;
153-
153+
154154
// diag
155155
diagnostic_updater::Updater updater_{this};
156156
};

planning/autoware_path_optimizer/include/autoware/path_optimizer/state_equation_generator.hpp

+1-1
Original file line numberDiff line numberDiff line change
@@ -46,7 +46,7 @@ class StateEquationGenerator
4646
os << "}\n";
4747
return os;
4848
}
49-
49+
5050
StateEquationGenerator() = default;
5151
StateEquationGenerator(
5252
const double wheel_base, const double max_steer_rad,

planning/autoware_path_optimizer/include/autoware/path_optimizer/utils/conditional_timer.hpp

+1-1
Original file line numberDiff line numberDiff line change
@@ -45,4 +45,4 @@ class ConditionalTimer
4545
private:
4646
std::optional<std::chrono::time_point<std::chrono::high_resolution_clock>> start_time_{
4747
std::nullopt};
48-
};
48+
};

planning/autoware_path_optimizer/src/mpt_optimizer.cpp

+1-1
Original file line numberDiff line numberDiff line change
@@ -505,7 +505,7 @@ std::pair<std::vector<TrajectoryPoint>, int> MPTOptimizer::optimizeTrajectory(
505505
"but this failure also. Then return path_smoother output.");
506506
return traj_points;
507507
};
508-
508+
509509
conditional_timer_->update(true);
510510

511511
const double elapsed_time = conditional_timer_->getElapsedTime().count();

planning/autoware_path_optimizer/src/node.cpp

-1
Original file line numberDiff line numberDiff line change
@@ -142,7 +142,6 @@ PathOptimizer::PathOptimizer(const rclcpp::NodeOptions & node_options)
142142
updater_.add(
143143
"path_optimizer_emergency_stop", this, &PathOptimizer::onCheckPathOptimizationValid);
144144
}
145-
146145
}
147146

148147
time_keeper_ = std::make_shared<autoware_utils::TimeKeeper>(debug_processing_time_detail_pub_);

planning/motion_velocity_planner/autoware_motion_velocity_obstacle_cruise_module/src/optimization_based_planner/velocity_optimizer.cpp

+1-1
Original file line numberDiff line numberDiff line change
@@ -249,7 +249,7 @@ VelocityOptimizer::OptimizationResult VelocityOptimizer::optimize(const Optimiza
249249

250250
// execute optimization
251251
const autoware::osqp_interface::OSQPResult result =
252-
qp_solver_.optimize(P, A, q, lower_bound, upper_bound);
252+
qp_solver_.optimize(P, A, q, lower_bound, upper_bound);
253253
const std::vector<double> optval = result.primal_solution;
254254

255255
const int status_val = result.solution_status;

system/autoware_system_diagnostic_monitor/config/planning.yaml

+1-1
Original file line numberDiff line numberDiff line change
@@ -104,4 +104,4 @@ units:
104104
type: diag
105105
node: path_optimizer
106106
name: path_optimizer_emergency_stop
107-
timeout: 1.0
107+
timeout: 1.0

0 commit comments

Comments
 (0)