Skip to content

Commit 3a1ae3b

Browse files
authored
feat(mpc_lateral_controller): suppress rclcpp_warning/error (#9382)
* feat(mpc_lateral_controller): suppress rclcpp_warning/error Signed-off-by: Takayuki Murooka <takayuki5168@gmail.com> * fix Signed-off-by: Takayuki Murooka <takayuki5168@gmail.com> * fix test Signed-off-by: Takayuki Murooka <takayuki5168@gmail.com> --------- Signed-off-by: Takayuki Murooka <takayuki5168@gmail.com>
1 parent de9d9cb commit 3a1ae3b

File tree

7 files changed

+86
-66
lines changed

7 files changed

+86
-66
lines changed

control/autoware_mpc_lateral_controller/CMakeLists.txt

+2
Original file line numberDiff line numberDiff line change
@@ -4,6 +4,8 @@ project(autoware_mpc_lateral_controller)
44
find_package(autoware_cmake REQUIRED)
55
autoware_package()
66

7+
find_package(fmt REQUIRED)
8+
79
ament_auto_add_library(steering_offset_lib SHARED
810
src/steering_offset/steering_offset.cpp
911
)

control/autoware_mpc_lateral_controller/include/autoware/mpc_lateral_controller/mpc.hpp

+10-4
Original file line numberDiff line numberDiff line change
@@ -191,6 +191,12 @@ struct MPCMatrix
191191
MPCMatrix() = default;
192192
};
193193

194+
struct ResultWithReason
195+
{
196+
bool result{false};
197+
std::string reason{""};
198+
};
199+
194200
/**
195201
* MPC-based waypoints follower class
196202
* @brief calculate control command to follow reference waypoints
@@ -232,7 +238,7 @@ class MPC
232238
* @param current_kinematics The current vehicle kinematics.
233239
* @return A pair of a boolean flag indicating success and the MPC data.
234240
*/
235-
std::pair<bool, MPCData> getData(
241+
std::pair<ResultWithReason, MPCData> getData(
236242
const MPCTrajectory & trajectory, const SteeringReport & current_steer,
237243
const Odometry & current_kinematics);
238244

@@ -272,7 +278,7 @@ class MPC
272278
* @param [in] current_velocity current ego velocity
273279
* @return A pair of a boolean flag indicating success and the optimized input vector.
274280
*/
275-
std::pair<bool, VectorXd> executeOptimization(
281+
std::pair<ResultWithReason, VectorXd> executeOptimization(
276282
const MPCMatrix & mpc_matrix, const VectorXd & x0, const double prediction_dt,
277283
const MPCTrajectory & trajectory, const double current_velocity);
278284

@@ -283,7 +289,7 @@ class MPC
283289
* @param input The input trajectory.
284290
* @return A pair of a boolean flag indicating success and the resampled trajectory.
285291
*/
286-
std::pair<bool, MPCTrajectory> resampleMPCTrajectoryByTime(
292+
std::pair<ResultWithReason, MPCTrajectory> resampleMPCTrajectoryByTime(
287293
const double start_time, const double prediction_dt, const MPCTrajectory & input) const;
288294

289295
/**
@@ -450,7 +456,7 @@ class MPC
450456
* @param diagnostic Diagnostic data for debugging purposes.
451457
* @return True if the MPC calculation is successful, false otherwise.
452458
*/
453-
bool calculateMPC(
459+
ResultWithReason calculateMPC(
454460
const SteeringReport & current_steer, const Odometry & current_kinematics, Lateral & ctrl_cmd,
455461
Trajectory & predicted_trajectory, Float32MultiArrayStamped & diagnostic,
456462
LateralHorizon & ctrl_cmd_horizon);

control/autoware_mpc_lateral_controller/include/autoware/mpc_lateral_controller/mpc_lateral_controller.hpp

+1-1
Original file line numberDiff line numberDiff line change
@@ -96,7 +96,7 @@ class MpcLateralController : public trajectory_follower::LateralControllerBase
9696
bool m_keep_steer_control_until_converged;
9797

9898
// MPC solver checker.
99-
bool m_is_mpc_solved{true};
99+
ResultWithReason m_mpc_solved_status{true};
100100

101101
// trajectory buffer for detecting new trajectory
102102
std::deque<Trajectory> m_trajectory_buffer;

control/autoware_mpc_lateral_controller/src/mpc.cpp

+29-34
Original file line numberDiff line numberDiff line change
@@ -20,6 +20,8 @@
2020
#include "autoware/universe_utils/math/unit_conversion.hpp"
2121
#include "rclcpp/rclcpp.hpp"
2222

23+
#include <fmt/format.h>
24+
2325
#include <algorithm>
2426
#include <limits>
2527

@@ -37,7 +39,7 @@ MPC::MPC(rclcpp::Node & node)
3739
node.create_publisher<Trajectory>("~/debug/resampled_reference_trajectory", rclcpp::QoS(1));
3840
}
3941

40-
bool MPC::calculateMPC(
42+
ResultWithReason MPC::calculateMPC(
4143
const SteeringReport & current_steer, const Odometry & current_kinematics, Lateral & ctrl_cmd,
4244
Trajectory & predicted_trajectory, Float32MultiArrayStamped & diagnostic,
4345
LateralHorizon & ctrl_cmd_horizon)
@@ -48,10 +50,10 @@ bool MPC::calculateMPC(
4850
applyVelocityDynamicsFilter(m_reference_trajectory, current_kinematics);
4951

5052
// get the necessary data
51-
const auto [success_data, mpc_data] =
53+
const auto [get_data_result, mpc_data] =
5254
getData(reference_trajectory, current_steer, current_kinematics);
53-
if (!success_data) {
54-
return fail_warn_throttle("fail to get MPC Data. Stop MPC.");
55+
if (!get_data_result.result) {
56+
return ResultWithReason{false, fmt::format("getting MPC Data ({}).", get_data_result.reason)};
5557
}
5658

5759
// calculate initial state of the error dynamics
@@ -61,29 +63,30 @@ bool MPC::calculateMPC(
6163
const auto [success_delay, x0_delayed] =
6264
updateStateForDelayCompensation(reference_trajectory, mpc_data.nearest_time, x0);
6365
if (!success_delay) {
64-
return fail_warn_throttle("delay compensation failed. Stop MPC.");
66+
return ResultWithReason{false, "delay compensation."};
6567
}
6668

6769
// resample reference trajectory with mpc sampling time
6870
const double mpc_start_time = mpc_data.nearest_time + m_param.input_delay;
6971
const double prediction_dt =
7072
getPredictionDeltaTime(mpc_start_time, reference_trajectory, current_kinematics);
7173

72-
const auto [success_resample, mpc_resampled_ref_trajectory] =
74+
const auto [resample_result, mpc_resampled_ref_trajectory] =
7375
resampleMPCTrajectoryByTime(mpc_start_time, prediction_dt, reference_trajectory);
74-
if (!success_resample) {
75-
return fail_warn_throttle("trajectory resampling failed. Stop MPC.");
76+
if (!resample_result.result) {
77+
return ResultWithReason{
78+
false, fmt::format("trajectory resampling ({}).", resample_result.reason)};
7679
}
7780

7881
// generate mpc matrix : predict equation Xec = Aex * x0 + Bex * Uex + Wex
7982
const auto mpc_matrix = generateMPCMatrix(mpc_resampled_ref_trajectory, prediction_dt);
8083

8184
// solve Optimization problem
82-
const auto [success_opt, Uex] = executeOptimization(
85+
const auto [opt_result, Uex] = executeOptimization(
8386
mpc_matrix, x0_delayed, prediction_dt, mpc_resampled_ref_trajectory,
8487
current_kinematics.twist.twist.linear.x);
85-
if (!success_opt) {
86-
return fail_warn_throttle("optimization failed. Stop MPC.");
88+
if (!opt_result.result) {
89+
return ResultWithReason{false, fmt::format("optimization failure ({}).", opt_result.reason)};
8790
}
8891

8992
// apply filters for the input limitation and low pass filter
@@ -138,7 +141,7 @@ bool MPC::calculateMPC(
138141
ctrl_cmd_horizon.controls.push_back(lateral);
139142
}
140143

141-
return true;
144+
return ResultWithReason{true};
142145
}
143146

144147
Float32MultiArrayStamped MPC::generateDiagData(
@@ -278,7 +281,7 @@ void MPC::resetPrevResult(const SteeringReport & current_steer)
278281
m_raw_steer_cmd_pprev = std::clamp(current_steer.steering_tire_angle, -steer_lim_f, steer_lim_f);
279282
}
280283

281-
std::pair<bool, MPCData> MPC::getData(
284+
std::pair<ResultWithReason, MPCData> MPC::getData(
282285
const MPCTrajectory & traj, const SteeringReport & current_steer,
283286
const Odometry & current_kinematics)
284287
{
@@ -288,8 +291,7 @@ std::pair<bool, MPCData> MPC::getData(
288291
if (!MPCUtils::calcNearestPoseInterp(
289292
traj, current_pose, &(data.nearest_pose), &(data.nearest_idx), &(data.nearest_time),
290293
ego_nearest_dist_threshold, ego_nearest_yaw_threshold)) {
291-
warn_throttle("calculateMPC: error in calculating nearest pose. stop mpc.");
292-
return {false, MPCData{}};
294+
return {ResultWithReason{false, "error in calculating nearest pose"}, MPCData{}};
293295
}
294296

295297
// get data
@@ -304,28 +306,25 @@ std::pair<bool, MPCData> MPC::getData(
304306
// check error limit
305307
const double dist_err = calcDistance2d(current_pose, data.nearest_pose);
306308
if (dist_err > m_admissible_position_error) {
307-
warn_throttle("Too large position error: %fm > %fm", dist_err, m_admissible_position_error);
308-
return {false, MPCData{}};
309+
return {ResultWithReason{false, "too large position error"}, MPCData{}};
309310
}
310311

311312
// check yaw error limit
312313
if (std::fabs(data.yaw_err) > m_admissible_yaw_error_rad) {
313-
warn_throttle("Too large yaw error: %f > %f", data.yaw_err, m_admissible_yaw_error_rad);
314-
return {false, MPCData{}};
314+
return {ResultWithReason{false, "too large yaw error"}, MPCData{}};
315315
}
316316

317317
// check trajectory time length
318318
const double max_prediction_time =
319319
m_param.min_prediction_length / static_cast<double>(m_param.prediction_horizon - 1);
320320
auto end_time = data.nearest_time + m_param.input_delay + m_ctrl_period + max_prediction_time;
321321
if (end_time > traj.relative_time.back()) {
322-
warn_throttle("path is too short for prediction.");
323-
return {false, MPCData{}};
322+
return {ResultWithReason{false, "path is too short for prediction."}, MPCData{}};
324323
}
325-
return {true, data};
324+
return {ResultWithReason{true}, data};
326325
}
327326

328-
std::pair<bool, MPCTrajectory> MPC::resampleMPCTrajectoryByTime(
327+
std::pair<ResultWithReason, MPCTrajectory> MPC::resampleMPCTrajectoryByTime(
329328
const double ts, const double prediction_dt, const MPCTrajectory & input) const
330329
{
331330
MPCTrajectory output;
@@ -334,8 +333,7 @@ std::pair<bool, MPCTrajectory> MPC::resampleMPCTrajectoryByTime(
334333
mpc_time_v.push_back(ts + i * prediction_dt);
335334
}
336335
if (!MPCUtils::linearInterpMPCTrajectory(input.relative_time, input, mpc_time_v, output)) {
337-
warn_throttle("calculateMPC: mpc resample error. stop mpc calculation. check code!");
338-
return {false, {}};
336+
return {ResultWithReason{false, "mpc resample error"}, {}};
339337
}
340338
// Publish resampled reference trajectory for debug purpose.
341339
if (m_publish_debug_trajectories) {
@@ -344,7 +342,7 @@ std::pair<bool, MPCTrajectory> MPC::resampleMPCTrajectoryByTime(
344342
converted_output.header.frame_id = "map";
345343
m_debug_resampled_reference_trajectory_pub->publish(converted_output);
346344
}
347-
return {true, output};
345+
return {ResultWithReason{true}, output};
348346
}
349347

350348
VectorXd MPC::getInitialState(const MPCData & data)
@@ -577,15 +575,14 @@ MPCMatrix MPC::generateMPCMatrix(
577575
* ~~~
578576
* [ -au_lim * dt ] < [uN-uN-1] < [ au_lim * dt ] (*N... DIM_U)
579577
*/
580-
std::pair<bool, VectorXd> MPC::executeOptimization(
578+
std::pair<ResultWithReason, VectorXd> MPC::executeOptimization(
581579
const MPCMatrix & m, const VectorXd & x0, const double prediction_dt, const MPCTrajectory & traj,
582580
const double current_velocity)
583581
{
584582
VectorXd Uex;
585583

586584
if (!isValid(m)) {
587-
warn_throttle("model matrix is invalid. stop MPC.");
588-
return {false, {}};
585+
return {ResultWithReason{false, "invalid model matrix"}, {}};
589586
}
590587

591588
const int DIM_U_N = m_param.prediction_horizon * m_vehicle_model_ptr->getDimU();
@@ -622,8 +619,7 @@ std::pair<bool, VectorXd> MPC::executeOptimization(
622619
bool solve_result = m_qpsolver_ptr->solve(H, f.transpose(), A, lb, ub, lbA, ubA, Uex);
623620
auto t_end = std::chrono::system_clock::now();
624621
if (!solve_result) {
625-
warn_throttle("qp solver error");
626-
return {false, {}};
622+
return {ResultWithReason{false, "qp solver error"}, {}};
627623
}
628624

629625
{
@@ -632,10 +628,9 @@ std::pair<bool, VectorXd> MPC::executeOptimization(
632628
}
633629

634630
if (Uex.array().isNaN().any()) {
635-
warn_throttle("model Uex includes NaN, stop MPC.");
636-
return {false, {}};
631+
return {ResultWithReason{false, "model Uex including NaN"}, {}};
637632
}
638-
return {true, Uex};
633+
return {ResultWithReason{true}, Uex};
639634
}
640635

641636
void MPC::addSteerWeightR(const double prediction_dt, MatrixXd & R) const

control/autoware_mpc_lateral_controller/src/mpc_lateral_controller.cpp

+13-12
Original file line numberDiff line numberDiff line change
@@ -235,20 +235,17 @@ std::shared_ptr<SteeringOffsetEstimator> MpcLateralController::createSteerOffset
235235

236236
void MpcLateralController::setStatus(diagnostic_updater::DiagnosticStatusWrapper & stat)
237237
{
238-
if (m_is_mpc_solved) {
238+
if (m_mpc_solved_status.result) {
239239
stat.summary(diagnostic_msgs::msg::DiagnosticStatus::OK, "MPC succeeded.");
240240
} else {
241-
const std::string error_msg = "The MPC solver failed. Call MRM to stop the car.";
241+
const std::string error_msg = "MPC failed due to " + m_mpc_solved_status.reason;
242242
stat.summary(diagnostic_msgs::msg::DiagnosticStatus::ERROR, error_msg);
243243
}
244244
}
245245

246246
void MpcLateralController::setupDiag()
247247
{
248-
auto & d = diag_updater_;
249-
d->setHardwareID("mpc_lateral_controller");
250-
251-
d->add("MPC_solve_checker", [&](auto & stat) { setStatus(stat); });
248+
diag_updater_->add("MPC_solve_checker", [&](auto & stat) { setStatus(stat); });
252249
}
253250

254251
trajectory_follower::LateralOutput MpcLateralController::run(
@@ -277,11 +274,16 @@ trajectory_follower::LateralOutput MpcLateralController::run(
277274
}
278275

279276
trajectory_follower::LateralHorizon ctrl_cmd_horizon{};
280-
const bool is_mpc_solved = m_mpc->calculateMPC(
277+
const auto mpc_solved_status = m_mpc->calculateMPC(
281278
m_current_steering, m_current_kinematic_state, ctrl_cmd, predicted_traj, debug_values,
282279
ctrl_cmd_horizon);
283280

284-
m_is_mpc_solved = is_mpc_solved; // for diagnostic updater
281+
if (
282+
(m_mpc_solved_status.result == true && mpc_solved_status.result == false) ||
283+
(!mpc_solved_status.result && mpc_solved_status.reason != m_mpc_solved_status.reason)) {
284+
RCLCPP_ERROR(logger_, "MPC failed due to %s", mpc_solved_status.reason.c_str());
285+
}
286+
m_mpc_solved_status = mpc_solved_status; // for diagnostic updater
285287

286288
diag_updater_->force_update();
287289

@@ -290,7 +292,7 @@ trajectory_follower::LateralOutput MpcLateralController::run(
290292
// the vehicle will return to the path by re-planning the trajectory or external operation.
291293
// After the recovery, the previous value of the optimization may deviate greatly from
292294
// the actual steer angle, and it may make the optimization result unstable.
293-
if (!is_mpc_solved || !is_under_control) {
295+
if (!mpc_solved_status.result || !is_under_control) {
294296
m_mpc->resetPrevResult(m_current_steering);
295297
} else {
296298
setSteeringToHistory(ctrl_cmd);
@@ -334,13 +336,12 @@ trajectory_follower::LateralOutput MpcLateralController::run(
334336
return createLateralOutput(m_ctrl_cmd_prev, false, ctrl_cmd_horizon);
335337
}
336338

337-
if (!is_mpc_solved) {
338-
warn_throttle("MPC is not solved. publish 0 velocity.");
339+
if (!mpc_solved_status.result) {
339340
ctrl_cmd = getStopControlCommand();
340341
}
341342

342343
m_ctrl_cmd_prev = ctrl_cmd;
343-
return createLateralOutput(ctrl_cmd, is_mpc_solved, ctrl_cmd_horizon);
344+
return createLateralOutput(ctrl_cmd, mpc_solved_status.result, ctrl_cmd_horizon);
344345
}
345346

346347
bool MpcLateralController::isSteerConverged(const Lateral & cmd) const

0 commit comments

Comments
 (0)