Go to the documentation of this file.
34 const Duration& expected_dt,
const Time& t, ReferenceTrajectoryInterface* sref)
38 PRINT_ERROR(
"DualModeController::initialize(): predictive controller initialization failed.");
41 if (!
_local_controller->initialize(
x, expected_xref, expected_uref, expected_dt, t, sref))
43 PRINT_ERROR(
"DualModeController::initialize(): LQR controller initialization failed.");
49 PRINT_WARNING(
"DualModeController::initialize(): no switch condition specified.");
63 if (!
initialize(
x, xref, uref, dt, t, sref))
return false;
71 Eigen::VectorXd xf(
x.size());
103 Eigen::VectorXd xd = xf - x0;
104 return (xd.transpose() *
_S * xd <=
_gamma);
111 signal_target.registerMeasurement(ns +
"cpu_time", 1);
112 signal_target.registerMeasurement(ns +
"local_active", 1);
140 #ifdef MESSAGE_SUPPORT
141 void DualModeController::toMessage(corbo::messages::DualModeController& message)
const
154 Eigen::VectorXd Sdiag =
_S.diagonal();
155 message.mutable_ball_s()->Resize(Sdiag.size(), 0);
158 message.set_ball_s_diagonal_only(
true);
162 message.mutable_ball_s()->Resize(
_S.rows() *
_S.cols(), 0);
165 message.set_ball_s_diagonal_only(
false);
169 message.set_ball_gamma(
_gamma);
171 void DualModeController::fromMessage(
const corbo::messages::DualModeController& message, std::stringstream* issues)
177 util::get_oneof_field_type_expand_isolated(message.local_controller(),
"controller", type,
false, 1);
180 if (local_controller)
182 local_controller->fromMessage(message.local_controller(), issues);
187 if (issues) *issues <<
"Cannot load local controller.\n";
194 if (dim_x_pred != dim_x_local)
196 if (issues) *issues <<
"DualModeController: state dimension mismatch (lqr: " << dim_x_local <<
", pred: " << dim_x_pred <<
")." << std::endl;
202 if (dim_u_pred != dim_u_local)
205 *issues <<
"DualModeController: control input dimension mismatch (lqr: " << dim_u_local <<
", pred: " << dim_u_pred <<
")." << std::endl;
215 if (message.ball_s_diagonal_only())
217 Eigen::MatrixXd S =
Eigen::Map<
const Eigen::Matrix<double, -1, 1>>(message.ball_s().data(), message.ball_s_size()).asDiagonal();
220 *issues <<
"DualModeController: cannot set diagonal weight matrix S.\n";
228 *issues <<
"DualModeController: weight matrix S is not square.\n";
231 int p =
std::sqrt(message.ball_s_size());
236 *issues <<
"DualModeController: state dimension mismatch for terminal ball (dim_x_pred " << dim_x_pred <<
", matrix S: " << p
237 <<
")." << std::endl;
242 *issues <<
"DualModeController: cannot set weight matrix S.\n";
249 _gamma = message.ball_gamma();
static Time now()
Retrieve current system time.
const EIGEN_DEVICE_FUNC SqrtReturnType sqrt() const
Interface class for signal targets.
#define PRINT_WARNING(msg)
Print msg-stream.
#define PRINT_ERROR_NAMED(msg)
void getAvailableSignals(SignalTargetInterface &signal_target, const std::string &ns="") const override
Retrieve available signals from the controller.
ControllerInterface::Ptr _local_controller
Interface class for reference trajectories.
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
PredictiveController _pred_controller
bool _switch_terminal_ball
int getControlInputDimension() const override
Return the control input dimension.
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.
double getControlDuration() const override
Return the duration for which the control u obtained from step() is valid (useful for asynchronous co...
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
bool is_square(const Eigen::MatrixBase< Derived > &matrix)
Determine if a given matrix is square.
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.
static Factory & instance()
< Retrieve static instance of the factory
virtual void sendMeasurement(Measurement::ConstPtr measurement)=0
Send a measurement to the target.
Representation of time durations.
void getAvailableSignals(SignalTargetInterface &signal_target, const std::string &ns="") const override
Retrieve available signals from the controller.
std::shared_ptr< ControllerInterface > Ptr
A matrix or vector expression mapping an existing array of data.
void reset() override
Reset internal controller state and caches.
bool setWeightS(const Eigen::Ref< const Eigen::MatrixXd > &S)
virtual void getReference(const Time &t, OutputVector &ref) const =0
int getStateDimension() const override
Return the dimension of the required plant state/output.
A matrix or vector expression mapping an existing expression.
std::shared_ptr< Derived > create(const std::string &name, bool print_error=true) const
Create a shared instance of the desired object.
void reset() override
Reset internal controller state and caches.
double toSec() const
Return duration in seconds.
void sendSignals(double t, SignalTargetInterface &signal_target, const std::string &ns="") const override
Representation of time stamps.
void sendSignals(double t, SignalTargetInterface &signal_target, const std::string &ns="") const override
The matrix class, also used for vectors and row-vectors.
bool isInsideInTerminalBall(const Eigen::Ref< const Eigen::VectorXd > &x0, const Eigen::Ref< const Eigen::VectorXd > &xf) const
Eigen::VectorXd StateVector
std::shared_ptr< TimeSeries > Ptr
void setLocalController(ControllerInterface::Ptr local_controller)
ControllerStatistics _statistics
#define PRINT_ERROR(msg)
Print msg-stream as error msg.
control_box_rst
Author(s): Christoph Rösmann
autogenerated on Wed Mar 2 2022 00:05:45