dual_mode_controller.cpp
Go to the documentation of this file.
1 /*********************************************************************
2  *
3  * Software License Agreement
4  *
5  * Copyright (c) 2020,
6  * TU Dortmund - Institute of Control Theory and Systems Engineering.
7  * All rights reserved.
8  *
9  * This program is free software: you can redistribute it and/or modify
10  * it under the terms of the GNU General Public License as published by
11  * the Free Software Foundation, either version 3 of the License, or
12  * (at your option) any later version.
13  *
14  * This program is distributed in the hope that it will be useful,
15  * but WITHOUT ANY WARRANTY; without even the implied warranty of
16  * MERCHANTABILITY or FITNESS FOR A PARTICULAR PURPOSE. See the
17  * GNU General Public License for more details.
18  *
19  * You should have received a copy of the GNU General Public License
20  * along with this program. If not, see <https://www.gnu.org/licenses/>.
21  *
22  * Authors: Christoph Rösmann
23  *********************************************************************/
24 
26 
28 #include <corbo-core/console.h>
30 
31 namespace corbo {
32 
33 bool DualModeController::initialize(const StateVector& x, ReferenceTrajectoryInterface& expected_xref, ReferenceTrajectoryInterface& expected_uref,
34  const Duration& expected_dt, const Time& t, ReferenceTrajectoryInterface* sref)
35 {
36  if (!_pred_controller.initialize(x, expected_xref, expected_uref, expected_dt, t, sref))
37  {
38  PRINT_ERROR("DualModeController::initialize(): predictive controller initialization failed.");
39  return false;
40  }
41  if (!_local_controller->initialize(x, expected_xref, expected_uref, expected_dt, t, sref))
42  {
43  PRINT_ERROR("DualModeController::initialize(): LQR controller initialization failed.");
44  return false;
45  }
46 
48  {
49  PRINT_WARNING("DualModeController::initialize(): no switch condition specified.");
50  }
51 
52  _initialized = true;
53  return true;
54 }
55 
57  const Duration& dt, const Time& t, TimeSeries::Ptr u_sequence, TimeSeries::Ptr x_sequence,
59  ReferenceTrajectoryInterface* uinit, const std::string& ns)
60 {
61  if (!_initialized)
62  {
63  if (!initialize(x, xref, uref, dt, t, sref)) return false;
64  }
65  if (!_local_controller)
66  {
67  PRINT_ERROR_NAMED("No local controller provided.");
68  return false;
69  }
70 
71  Eigen::VectorXd xf(x.size());
72  xref.getReference(t, xf);
73  // for dualmode, assume we have only static references.... // xref.getNextSteadyState(t); // TODO(roesmann): this might not be good?!
74 
75  bool success = false;
76 
77  Time t_pre = Time::now();
78 
80 
81  if (!_first_run && _switch_dt)
82  {
83  _local_ctrl_active = (_pred_controller.getControlDuration() <= _min_dt); // this is from the last run!
84  }
85 
87  {
88  success = _local_controller->step(x, xref, uref, dt, t, u_sequence, x_sequence);
89  }
90  else
91  {
92  success = _pred_controller.step(x, xref, uref, dt, t, u_sequence, x_sequence);
93  }
94 
95  _statistics.step_time = Time::now() - t_pre;
96 
97  _first_run = false;
98  return success;
99 }
100 
102 {
103  Eigen::VectorXd xd = xf - x0;
104  return (xd.transpose() * _S * xd <= _gamma);
105 }
106 
107 void DualModeController::getAvailableSignals(SignalTargetInterface& signal_target, const std::string& ns) const
108 {
109  _pred_controller.getAvailableSignals(signal_target, ns + "pred_ctrl/");
110  _local_controller->getAvailableSignals(signal_target, ns + "local_ctrl/");
111  signal_target.registerMeasurement(ns + "cpu_time", 1);
112  signal_target.registerMeasurement(ns + "local_active", 1);
113 }
114 
116 {
118  _local_controller.reset();
119  _local_ctrl_active = false;
120  _first_run = true;
121 }
122 
123 void DualModeController::sendSignals(double t, SignalTargetInterface& signal_target, const std::string& ns) const
124 {
125  if (_local_ctrl_active)
126  _local_controller->sendSignals(t, signal_target, ns + "local_ctrl/");
127  else
128  _pred_controller.sendSignals(t, signal_target, ns + "pred_ctrl/");
129 
130  signal_target.sendMeasurement(ns + "cpu_time", t, {_statistics.step_time.toSec()});
131  signal_target.sendMeasurement(ns + "local_active", t, {(double)_local_ctrl_active});
132 }
133 
135 {
136  _S = S;
137  return true;
138 }
139 
140 #ifdef MESSAGE_SUPPORT
141 void DualModeController::toMessage(corbo::messages::DualModeController& message) const
142 {
143  _pred_controller.toMessage(*message.mutable_predictive_controller());
144  _local_controller->toMessage(*message.mutable_local_controller());
145 
146  message.set_switch_dt(_switch_dt);
147  message.set_min_dt(_min_dt);
148  message.set_switch_terminal_ball(_switch_terminal_ball);
149 
150  // Terminal Ball
151  // weight matrix S
152  if (_S.isDiagonal())
153  {
154  Eigen::VectorXd Sdiag = _S.diagonal();
155  message.mutable_ball_s()->Resize(Sdiag.size(), 0);
156  Eigen::Map<Eigen::VectorXd>(message.mutable_ball_s()->mutable_data(), Sdiag.size()) = Sdiag;
157 
158  message.set_ball_s_diagonal_only(true);
159  }
160  else
161  {
162  message.mutable_ball_s()->Resize(_S.rows() * _S.cols(), 0);
163  Eigen::Map<Eigen::Matrix<double, -1, -1, Eigen::RowMajor>>(message.mutable_ball_s()->mutable_data(), _S.rows(), _S.cols()) = _S;
164 
165  message.set_ball_s_diagonal_only(false);
166  }
167 
168  // gamma
169  message.set_ball_gamma(_gamma);
170 }
171 void DualModeController::fromMessage(const corbo::messages::DualModeController& message, std::stringstream* issues)
172 {
173  _pred_controller.fromMessage(message.predictive_controller(), issues);
174 
175  // construct local controller
176  std::string type;
177  util::get_oneof_field_type_expand_isolated(message.local_controller(), "controller", type, false, 1);
179  // import parameters
180  if (local_controller)
181  {
182  local_controller->fromMessage(message.local_controller(), issues);
183  setLocalController(local_controller);
184  }
185  else
186  {
187  if (issues) *issues << "Cannot load local controller.\n";
188  return;
189  }
190 
191  int dim_x_pred = _pred_controller.getStateDimension();
192  int dim_x_local = _local_controller->getStateDimension();
193 
194  if (dim_x_pred != dim_x_local)
195  {
196  if (issues) *issues << "DualModeController: state dimension mismatch (lqr: " << dim_x_local << ", pred: " << dim_x_pred << ")." << std::endl;
197  }
198 
199  int dim_u_pred = _pred_controller.getControlInputDimension();
200  int dim_u_local = _local_controller->getControlInputDimension();
201 
202  if (dim_u_pred != dim_u_local)
203  {
204  if (issues)
205  *issues << "DualModeController: control input dimension mismatch (lqr: " << dim_u_local << ", pred: " << dim_u_pred << ")." << std::endl;
206  }
207 
208  _switch_dt = message.switch_dt();
209  _min_dt = message.min_dt();
210  _switch_terminal_ball = message.switch_terminal_ball();
211 
212  // terminal ball
214  {
215  if (message.ball_s_diagonal_only())
216  {
217  Eigen::MatrixXd S = Eigen::Map<const Eigen::Matrix<double, -1, 1>>(message.ball_s().data(), message.ball_s_size()).asDiagonal();
218  if (!setWeightS(S))
219  {
220  *issues << "DualModeController: cannot set diagonal weight matrix S.\n";
221  return;
222  }
223  }
224  else
225  {
226  if (!is_square(message.ball_s_size()))
227  {
228  *issues << "DualModeController: weight matrix S is not square.\n";
229  return;
230  }
231  int p = std::sqrt(message.ball_s_size());
232 
233  if (p != dim_x_pred)
234  {
235  if (issues)
236  *issues << "DualModeController: state dimension mismatch for terminal ball (dim_x_pred " << dim_x_pred << ", matrix S: " << p
237  << ")." << std::endl;
238  }
239 
240  if (!setWeightS(Eigen::Map<const Eigen::Matrix<double, -1, -1, Eigen::RowMajor>>(message.ball_s().data(), p, p)) && issues)
241  {
242  *issues << "DualModeController: cannot set weight matrix S.\n";
243  return;
244  }
245  }
246  }
247 
248  // gamma
249  _gamma = message.ball_gamma();
250 }
251 #endif
252 
253 } // namespace corbo
corbo::Time::now
static Time now()
Retrieve current system time.
Definition: time.h:297
corbo::DualModeController::_local_ctrl_active
bool _local_ctrl_active
Definition: dual_mode_controller.h:183
sqrt
const EIGEN_DEVICE_FUNC SqrtReturnType sqrt() const
Definition: ArrayCwiseUnaryOps.h:152
corbo::SignalTargetInterface
Interface class for signal targets.
Definition: signal_target_interface.h:84
PRINT_WARNING
#define PRINT_WARNING(msg)
Print msg-stream.
Definition: console.h:145
PRINT_ERROR_NAMED
#define PRINT_ERROR_NAMED(msg)
Definition: console.h:260
corbo::PredictiveController::getAvailableSignals
void getAvailableSignals(SignalTargetInterface &signal_target, const std::string &ns="") const override
Retrieve available signals from the controller.
Definition: predictive_controller.cpp:103
corbo::DualModeController::_local_controller
ControllerInterface::Ptr _local_controller
Definition: dual_mode_controller.h:178
corbo::ReferenceTrajectoryInterface
Interface class for reference trajectories.
Definition: reference_trajectory.h:82
corbo
Definition: communication/include/corbo-communication/utilities.h:37
corbo::DualModeController::step
bool step(const StateVector &x, ReferenceTrajectoryInterface &xref, ReferenceTrajectoryInterface &uref, const Duration &dt, const Time &t, TimeSeries::Ptr u_sequence, TimeSeries::Ptr x_sequence, SignalTargetInterface *signal_target=nullptr, ReferenceTrajectoryInterface *sref=nullptr, ReferenceTrajectoryInterface *xinit=nullptr, ReferenceTrajectoryInterface *uinit=nullptr, const std::string &ns="") override
Definition: dual_mode_controller.cpp:78
corbo::DualModeController::_pred_controller
PredictiveController _pred_controller
Definition: dual_mode_controller.h:177
corbo::ControllerStatistics::step_time
Duration step_time
Definition: controllers/include/corbo-controllers/statistics.h:83
corbo::DualModeController::_switch_terminal_ball
bool _switch_terminal_ball
Definition: dual_mode_controller.h:181
corbo::PredictiveController::getControlInputDimension
int getControlInputDimension() const override
Return the control input dimension.
Definition: predictive_controller.h:102
corbo::PredictiveController::initialize
bool initialize(const StateVector &x, ReferenceTrajectoryInterface &expected_xref, ReferenceTrajectoryInterface &expected_uref, const Duration &expected_dt, const Time &t, ReferenceTrajectoryInterface *sref=nullptr) override
Initialize the controller.
Definition: predictive_controller.cpp:56
Eigen::RowMajor
@ RowMajor
Definition: Constants.h:322
corbo::PredictiveController::getControlDuration
double getControlDuration() const override
Return the duration for which the control u obtained from step() is valid (useful for asynchronous co...
Definition: predictive_controller.h:130
console.h
corbo::DualModeController::_gamma
double _gamma
Definition: dual_mode_controller.h:186
corbo::DualModeController::_initialized
bool _initialized
Definition: dual_mode_controller.h:192
dual_mode_controller.h
corbo::DualModeController::_S
Eigen::MatrixXd _S
Definition: dual_mode_controller.h:185
corbo::DualModeController::_min_dt
double _min_dt
Definition: dual_mode_controller.h:188
corbo::PredictiveController::step
bool step(const StateVector &x, ReferenceTrajectoryInterface &xref, ReferenceTrajectoryInterface &uref, const Duration &dt, const Time &t, TimeSeries::Ptr u_sequence, TimeSeries::Ptr x_sequence, SignalTargetInterface *signal_target=nullptr, ReferenceTrajectoryInterface *sref=nullptr, ReferenceTrajectoryInterface *xinit=nullptr, ReferenceTrajectoryInterface *uinit=nullptr, const std::string &ns="") override
Definition: predictive_controller.cpp:68
corbo::is_square
bool is_square(const Eigen::MatrixBase< Derived > &matrix)
Determine if a given matrix is square.
Definition: matrix_utilities.h:65
corbo::DualModeController::initialize
bool initialize(const StateVector &x, ReferenceTrajectoryInterface &expected_xref, ReferenceTrajectoryInterface &expected_uref, const Duration &expected_dt, const Time &t, ReferenceTrajectoryInterface *sref=nullptr) override
Initialize the controller.
Definition: dual_mode_controller.cpp:55
corbo::Factory::instance
static Factory & instance()
< Retrieve static instance of the factory
Definition: factory.h:116
corbo::SignalTargetInterface::sendMeasurement
virtual void sendMeasurement(Measurement::ConstPtr measurement)=0
Send a measurement to the target.
corbo::Duration
Representation of time durations.
Definition: time.h:128
corbo::DualModeController::getAvailableSignals
void getAvailableSignals(SignalTargetInterface &signal_target, const std::string &ns="") const override
Retrieve available signals from the controller.
Definition: dual_mode_controller.cpp:129
x
Scalar * x
Definition: level1_cplx_impl.h:89
matrix_utilities.h
corbo::ControllerInterface::Ptr
std::shared_ptr< ControllerInterface > Ptr
Definition: controller_interface.h:105
Eigen::Map
A matrix or vector expression mapping an existing array of data.
Definition: Map.h:94
corbo::DualModeController::reset
void reset() override
Reset internal controller state and caches.
Definition: dual_mode_controller.cpp:137
corbo::DualModeController::_first_run
bool _first_run
Definition: dual_mode_controller.h:190
corbo::DualModeController::setWeightS
bool setWeightS(const Eigen::Ref< const Eigen::MatrixXd > &S)
Definition: dual_mode_controller.cpp:156
corbo::ReferenceTrajectoryInterface::getReference
virtual void getReference(const Time &t, OutputVector &ref) const =0
corbo::DualModeController::_switch_dt
bool _switch_dt
Definition: dual_mode_controller.h:180
corbo::PredictiveController::getStateDimension
int getStateDimension() const override
Return the dimension of the required plant state/output.
Definition: predictive_controller.h:104
utilities.h
Eigen::Ref
A matrix or vector expression mapping an existing expression.
Definition: Ref.h:192
corbo::Factory::create
std::shared_ptr< Derived > create(const std::string &name, bool print_error=true) const
Create a shared instance of the desired object.
Definition: factory.h:137
corbo::PredictiveController::reset
void reset() override
Reset internal controller state and caches.
Definition: predictive_controller.cpp:116
corbo::Duration::toSec
double toSec() const
Return duration in seconds.
Definition: time.h:160
corbo::DualModeController::sendSignals
void sendSignals(double t, SignalTargetInterface &signal_target, const std::string &ns="") const override
Definition: dual_mode_controller.cpp:145
corbo::Time
Representation of time stamps.
Definition: time.h:273
corbo::PredictiveController::sendSignals
void sendSignals(double t, SignalTargetInterface &signal_target, const std::string &ns="") const override
Definition: predictive_controller.cpp:121
Eigen::Matrix
The matrix class, also used for vectors and row-vectors.
Definition: Matrix.h:178
corbo::DualModeController::isInsideInTerminalBall
bool isInsideInTerminalBall(const Eigen::Ref< const Eigen::VectorXd > &x0, const Eigen::Ref< const Eigen::VectorXd > &xf) const
Definition: dual_mode_controller.cpp:123
corbo::ControllerInterface::StateVector
Eigen::VectorXd StateVector
Definition: controller_interface.h:107
corbo::TimeSeries::Ptr
std::shared_ptr< TimeSeries > Ptr
Definition: time_series.h:108
corbo::DualModeController::setLocalController
void setLocalController(ControllerInterface::Ptr local_controller)
Definition: dual_mode_controller.h:140
corbo::DualModeController::_statistics
ControllerStatistics _statistics
Definition: dual_mode_controller.h:175
PRINT_ERROR
#define PRINT_ERROR(msg)
Print msg-stream as error msg.
Definition: console.h:173


control_box_rst
Author(s): Christoph Rösmann
autogenerated on Wed Mar 2 2022 00:05:45