20
20
#include " autoware/universe_utils/math/unit_conversion.hpp"
21
21
#include " rclcpp/rclcpp.hpp"
22
22
23
+ #include < fmt/format.h>
24
+
23
25
#include < algorithm>
24
26
#include < limits>
25
27
@@ -37,7 +39,7 @@ MPC::MPC(rclcpp::Node & node)
37
39
node.create_publisher <Trajectory>(" ~/debug/resampled_reference_trajectory" , rclcpp::QoS (1 ));
38
40
}
39
41
40
- bool MPC::calculateMPC (
42
+ ResultWithReason MPC::calculateMPC (
41
43
const SteeringReport & current_steer, const Odometry & current_kinematics, Lateral & ctrl_cmd,
42
44
Trajectory & predicted_trajectory, Float32MultiArrayStamped & diagnostic,
43
45
LateralHorizon & ctrl_cmd_horizon)
@@ -48,10 +50,10 @@ bool MPC::calculateMPC(
48
50
applyVelocityDynamicsFilter (m_reference_trajectory, current_kinematics);
49
51
50
52
// get the necessary data
51
- const auto [success_data , mpc_data] =
53
+ const auto [get_data_result , mpc_data] =
52
54
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 )} ;
55
57
}
56
58
57
59
// calculate initial state of the error dynamics
@@ -61,29 +63,30 @@ bool MPC::calculateMPC(
61
63
const auto [success_delay, x0_delayed] =
62
64
updateStateForDelayCompensation (reference_trajectory, mpc_data.nearest_time , x0);
63
65
if (!success_delay) {
64
- return fail_warn_throttle ( " delay compensation failed. Stop MPC. " ) ;
66
+ return ResultWithReason{ false , " delay compensation. " } ;
65
67
}
66
68
67
69
// resample reference trajectory with mpc sampling time
68
70
const double mpc_start_time = mpc_data.nearest_time + m_param.input_delay ;
69
71
const double prediction_dt =
70
72
getPredictionDeltaTime (mpc_start_time, reference_trajectory, current_kinematics);
71
73
72
- const auto [success_resample , mpc_resampled_ref_trajectory] =
74
+ const auto [resample_result , mpc_resampled_ref_trajectory] =
73
75
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 )};
76
79
}
77
80
78
81
// generate mpc matrix : predict equation Xec = Aex * x0 + Bex * Uex + Wex
79
82
const auto mpc_matrix = generateMPCMatrix (mpc_resampled_ref_trajectory, prediction_dt);
80
83
81
84
// solve Optimization problem
82
- const auto [success_opt , Uex] = executeOptimization (
85
+ const auto [opt_result , Uex] = executeOptimization (
83
86
mpc_matrix, x0_delayed, prediction_dt, mpc_resampled_ref_trajectory,
84
87
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 )} ;
87
90
}
88
91
89
92
// apply filters for the input limitation and low pass filter
@@ -138,7 +141,7 @@ bool MPC::calculateMPC(
138
141
ctrl_cmd_horizon.controls .push_back (lateral);
139
142
}
140
143
141
- return true ;
144
+ return ResultWithReason{ true } ;
142
145
}
143
146
144
147
Float32MultiArrayStamped MPC::generateDiagData (
@@ -278,7 +281,7 @@ void MPC::resetPrevResult(const SteeringReport & current_steer)
278
281
m_raw_steer_cmd_pprev = std::clamp (current_steer.steering_tire_angle , -steer_lim_f, steer_lim_f);
279
282
}
280
283
281
- std::pair<bool , MPCData> MPC::getData (
284
+ std::pair<ResultWithReason , MPCData> MPC::getData (
282
285
const MPCTrajectory & traj, const SteeringReport & current_steer,
283
286
const Odometry & current_kinematics)
284
287
{
@@ -288,8 +291,7 @@ std::pair<bool, MPCData> MPC::getData(
288
291
if (!MPCUtils::calcNearestPoseInterp (
289
292
traj, current_pose, &(data.nearest_pose ), &(data.nearest_idx ), &(data.nearest_time ),
290
293
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{}};
293
295
}
294
296
295
297
// get data
@@ -304,28 +306,25 @@ std::pair<bool, MPCData> MPC::getData(
304
306
// check error limit
305
307
const double dist_err = calcDistance2d (current_pose, data.nearest_pose );
306
308
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{}};
309
310
}
310
311
311
312
// check yaw error limit
312
313
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{}};
315
315
}
316
316
317
317
// check trajectory time length
318
318
const double max_prediction_time =
319
319
m_param.min_prediction_length / static_cast <double >(m_param.prediction_horizon - 1 );
320
320
auto end_time = data.nearest_time + m_param.input_delay + m_ctrl_period + max_prediction_time;
321
321
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{}};
324
323
}
325
- return {true , data};
324
+ return {ResultWithReason{ true } , data};
326
325
}
327
326
328
- std::pair<bool , MPCTrajectory> MPC::resampleMPCTrajectoryByTime (
327
+ std::pair<ResultWithReason , MPCTrajectory> MPC::resampleMPCTrajectoryByTime (
329
328
const double ts, const double prediction_dt, const MPCTrajectory & input) const
330
329
{
331
330
MPCTrajectory output;
@@ -334,8 +333,7 @@ std::pair<bool, MPCTrajectory> MPC::resampleMPCTrajectoryByTime(
334
333
mpc_time_v.push_back (ts + i * prediction_dt);
335
334
}
336
335
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" }, {}};
339
337
}
340
338
// Publish resampled reference trajectory for debug purpose.
341
339
if (m_publish_debug_trajectories) {
@@ -344,7 +342,7 @@ std::pair<bool, MPCTrajectory> MPC::resampleMPCTrajectoryByTime(
344
342
converted_output.header .frame_id = " map" ;
345
343
m_debug_resampled_reference_trajectory_pub->publish (converted_output);
346
344
}
347
- return {true , output};
345
+ return {ResultWithReason{ true } , output};
348
346
}
349
347
350
348
VectorXd MPC::getInitialState (const MPCData & data)
@@ -577,15 +575,14 @@ MPCMatrix MPC::generateMPCMatrix(
577
575
* ~~~
578
576
* [ -au_lim * dt ] < [uN-uN-1] < [ au_lim * dt ] (*N... DIM_U)
579
577
*/
580
- std::pair<bool , VectorXd> MPC::executeOptimization (
578
+ std::pair<ResultWithReason , VectorXd> MPC::executeOptimization (
581
579
const MPCMatrix & m, const VectorXd & x0, const double prediction_dt, const MPCTrajectory & traj,
582
580
const double current_velocity)
583
581
{
584
582
VectorXd Uex;
585
583
586
584
if (!isValid (m)) {
587
- warn_throttle (" model matrix is invalid. stop MPC." );
588
- return {false , {}};
585
+ return {ResultWithReason{false , " invalid model matrix" }, {}};
589
586
}
590
587
591
588
const int DIM_U_N = m_param.prediction_horizon * m_vehicle_model_ptr->getDimU ();
@@ -622,8 +619,7 @@ std::pair<bool, VectorXd> MPC::executeOptimization(
622
619
bool solve_result = m_qpsolver_ptr->solve (H, f.transpose (), A, lb, ub, lbA, ubA, Uex);
623
620
auto t_end = std::chrono::system_clock::now ();
624
621
if (!solve_result) {
625
- warn_throttle (" qp solver error" );
626
- return {false , {}};
622
+ return {ResultWithReason{false , " qp solver error" }, {}};
627
623
}
628
624
629
625
{
@@ -632,10 +628,9 @@ std::pair<bool, VectorXd> MPC::executeOptimization(
632
628
}
633
629
634
630
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" }, {}};
637
632
}
638
- return {true , Uex};
633
+ return {ResultWithReason{ true } , Uex};
639
634
}
640
635
641
636
void MPC::addSteerWeightR (const double prediction_dt, MatrixXd & R) const
0 commit comments