simple_state_controller.h
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 
25 #ifndef SRC_CONTROLLERS_INCLUDE_CORBO_CONTROLLERS_SIMPLE_STATE_CONTROLLER_H_
26 #define SRC_CONTROLLERS_INCLUDE_CORBO_CONTROLLERS_SIMPLE_STATE_CONTROLLER_H_
27 
29 #include <memory>
30 
31 namespace corbo {
32 
46 class SimpleStateController : public ControllerInterface
47 {
48  public:
49  SimpleStateController() = default;
50 
51  // implements interface method
52  int getControlInputDimension() const override { return _K.rows(); }
53  // implements interface method
54  int getStateDimension() const override { return _V.cols() > 0 ? _V.cols() : _K.cols(); }
55  // implements interface method
56  bool hasPiecewiseConstantControls() const override { return false; }
57  // implements interface method
58  bool providesFutureControls() const override { return false; }
59  // implements interface method
60  bool providesFutureStates() const override { return false; }
61 
62  // implements interface method
63  Ptr getInstance() const override { return std::make_shared<SimpleStateController>(); }
64 
67 
70 
71  // implements interface method
72  bool initialize(const StateVector& x, ReferenceTrajectoryInterface& expected_xref, ReferenceTrajectoryInterface& expected_uref,
73  const Duration& expected_dt, const Time& t, ReferenceTrajectoryInterface* sref = nullptr) override;
74 
75  // implements interface method
76  bool step(const StateVector& x, ReferenceTrajectoryInterface& xref, ReferenceTrajectoryInterface& uref, const Duration& dt, const Time& t,
77  TimeSeries::Ptr u_sequence, TimeSeries::Ptr x_sequence, SignalTargetInterface* signal_target = nullptr,
78  ReferenceTrajectoryInterface* sref = nullptr, ReferenceTrajectoryInterface* xinit = nullptr,
79  ReferenceTrajectoryInterface* uinit = nullptr, const std::string& ns = "") override;
80 
81  // implements interface method
82  void getAvailableSignals(SignalTargetInterface& signal_target, const std::string& ns = "") const override;
83 
84 #ifdef MESSAGE_SUPPORT
85  // implements interface method
86  void toMessage(corbo::messages::Controller& message) const override;
87  // implements interface method
88  void fromMessage(const corbo::messages::Controller& message, std::stringstream* issues = nullptr) override;
89 #endif
90 
91  // implements interface method
92  void reset() override;
93 
95  void setPublishError(bool publish) { _publish_error = publish; }
96 
97  private:
98  bool _publish_error = true;
99  Eigen::MatrixXd _K;
100  Eigen::MatrixXd _V;
101 };
102 
104 
105 } // namespace corbo
106 
107 #endif // SRC_CONTROLLERS_INCLUDE_CORBO_CONTROLLERS_SIMPLE_STATE_CONTROLLER_H_
corbo::SimpleStateController::getInstance
Ptr getInstance() const override
Return a newly created shared instance of the implemented class.
Definition: simple_state_controller.h:107
corbo
Definition: communication/include/corbo-communication/utilities.h:37
corbo::SimpleStateController::_publish_error
bool _publish_error
Definition: simple_state_controller.h:142
corbo::SimpleStateController::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: simple_state_controller.cpp:59
corbo::SimpleStateController::providesFutureStates
bool providesFutureStates() const override
Definition: simple_state_controller.h:104
corbo::SimpleStateController::SimpleStateController
SimpleStateController()=default
corbo::SimpleStateController::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: simple_state_controller.cpp:68
controller_interface.h
corbo::SimpleStateController::hasPiecewiseConstantControls
bool hasPiecewiseConstantControls() const override
Return true if the controller returns piecewise constant control pieces.
Definition: simple_state_controller.h:100
corbo::SimpleStateController::reset
void reset() override
Reset internal controller state and caches.
Definition: simple_state_controller.cpp:118
x
Scalar * x
Definition: level1_cplx_impl.h:89
corbo::SimpleStateController::_V
Eigen::MatrixXd _V
Definition: simple_state_controller.h:144
corbo::SimpleStateController::_K
Eigen::MatrixXd _K
Definition: simple_state_controller.h:143
corbo::ControllerInterface::Ptr
std::shared_ptr< ControllerInterface > Ptr
Definition: controller_interface.h:105
corbo::SimpleStateController::getStateDimension
int getStateDimension() const override
Return the dimension of the required plant state/output.
Definition: simple_state_controller.h:98
corbo::SimpleStateController::providesFutureControls
bool providesFutureControls() const override
Definition: simple_state_controller.h:102
Eigen::Ref
A matrix or vector expression mapping an existing expression.
Definition: Ref.h:192
corbo::SimpleStateController::getControlInputDimension
int getControlInputDimension() const override
Return the control input dimension.
Definition: simple_state_controller.h:96
corbo::SimpleStateController::getAvailableSignals
void getAvailableSignals(SignalTargetInterface &signal_target, const std::string &ns="") const override
Retrieve available signals from the controller.
Definition: simple_state_controller.cpp:110
corbo::SimpleStateController::setFilterMatrixV
void setFilterMatrixV(const Eigen::Ref< const Eigen::MatrixXd > &V)
Set reference filter matrix V [control input dimension x output dimension].
Definition: simple_state_controller.cpp:57
corbo::SimpleStateController
State feedback controller wigh feedback gain matrix K.
Definition: simple_state_controller.h:68
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::SimpleStateController::setPublishError
void setPublishError(bool publish)
Specify whether the state error should be published via signal.
Definition: simple_state_controller.h:139
corbo::SimpleStateController::setGainMatrixK
void setGainMatrixK(const Eigen::Ref< const Eigen::MatrixXd > &K)
Set feedback gain matrix K [control input dimension x state dimension].
Definition: simple_state_controller.cpp:55
FACTORY_REGISTER_CONTROLLER
#define FACTORY_REGISTER_CONTROLLER(type)
Definition: controller_interface.h:189


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