quadratic_state_cost.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 
29 #include <cmath>
30 
31 namespace corbo {
32 
34 {
36 
37  if (!is_square(Q)) return false;
38 
39  // check if we have a diagonal matrix
40  if (Q.isDiagonal(1e-10)) return setWeightQ(Q.diagonal().asDiagonal());
41 
42  _diagonal_mode = false;
43 
44  _Q = Q; // also store original Q
45  if (Q.isZero())
46  {
47  _Q_sqrt.setZero();
48  return true;
49  }
51  if (cholesky.info() == Eigen::NumericalIssue) return false;
52  _Q_sqrt = cholesky.matrixU();
53  return true;
54 }
55 
57 {
59  _diagonal_mode = true;
60  _Q_diag = Q;
61  _Q_diag_sqrt = Q.diagonal().cwiseSqrt().asDiagonal();
62  return true;
63 }
64 
66 {
67  assert(!_integral_form);
68  assert(cost.size() == getNonIntegralStateTermDimension(k));
69 
70  if (_lsq_form)
71  {
72  if (_zero_x_ref)
73  {
74  if (_diagonal_mode)
75  cost.noalias() = _Q_diag_sqrt * x_k;
76  else
77  cost.noalias() = _Q_sqrt * x_k;
78  }
79  else
80  {
81  Eigen::VectorXd xd = x_k - _x_ref->getReferenceCached(k);
82  if (_diagonal_mode)
83  cost.noalias() = _Q_diag_sqrt * xd;
84  else
85  cost.noalias() = _Q_sqrt * xd;
86  }
87  }
88  else
89  {
90  if (_zero_x_ref)
91  {
92  if (_diagonal_mode)
93  cost.noalias() = x_k.transpose() * _Q_diag * x_k;
94  else
95  cost.noalias() = x_k.transpose() * _Q * x_k;
96  }
97  else
98  {
99  Eigen::VectorXd xd = x_k - _x_ref->getReferenceCached(k);
100  if (_diagonal_mode)
101  cost.noalias() = xd.transpose() * _Q_diag * xd;
102  else
103  cost.noalias() = xd.transpose() * _Q * xd;
104  }
105  }
106 }
107 
110 {
111  assert(_integral_form);
112  assert(cost.size() == 1);
113 
114  cost[0] = 0;
115 
116  if (_zero_x_ref)
117  {
118  if (_diagonal_mode)
119  cost[0] += x_k.transpose() * _Q_diag * x_k;
120  else
121  cost[0] += x_k.transpose() * _Q * x_k;
122  }
123  else
124  {
125  Eigen::VectorXd xd = x_k - _x_ref->getReferenceCached(k);
126  if (_diagonal_mode)
127  cost[0] += xd.transpose() * _Q_diag * xd;
128  else
129  cost[0] += xd.transpose() * _Q * xd;
130  }
131 }
132 
133 bool QuadraticStateCost::checkParameters(int state_dim, int control_dim, std::stringstream* issues) const
134 {
135  bool success = true;
136 
138  {
139  if (_Q_diag.diagonal().size() != state_dim)
140  {
141  if (issues)
142  *issues << "QuadraticStateCost: Diagonal matrix dimension of Q (" << _Q_diag.diagonal().size()
143  << ") does not match state vector dimension (" << state_dim << "); Please specify diagonal elements only." << std::endl;
144  success = false;
145  }
146  }
147  else
148  {
149  if (_Q.rows() != state_dim || _Q.cols() != state_dim)
150  {
151  if (issues)
152  *issues << "QuadraticStateCost: Matrix dimension of Q (" << _Q.rows() << "x" << _Q.cols()
153  << ") does not match state vector dimension (" << state_dim << "); Please specify " << (state_dim * state_dim)
154  << " elements (Row-Major)." << std::endl;
155  success = false;
156  }
157  }
158 
159  return success;
160 }
161 
162 #ifdef MESSAGE_SUPPORT
163 bool QuadraticStateCost::fromMessage(const messages::QuadraticStateCost& message, std::stringstream* issues)
164 {
165  _diagonal_mode = message.diagonal_only();
166 
167  if (_diagonal_mode)
168  {
169  if (!setWeightQ(
170  Eigen::Map<const Eigen::Matrix<double, -1, 1>>(message.q().data(), message.q_size()).asDiagonal()))
171  {
172  *issues << "QuadraticStateCost: cannot set diagonal weight matrix Q.\n";
173  return false;
174  }
175  }
176  else
177  {
178  int p = std::sqrt(message.q_size());
179 
180  if (p * p != message.q_size())
181  {
182  *issues << "QuadraticStateCost: weight matrix Q is not square.\n";
183  return false;
184  }
185 
186  // weight matrix Q
187  // if (p * p == message.full_discretization_ocp().q_size())
188  //{
189  if (!setWeightQ(Eigen::Map<const Eigen::Matrix<double, -1, -1, Eigen::RowMajor>>(message.q().data(), p, p)) && issues)
190  {
191  *issues << "QuadraticStateCost: weight matrix Q is not positive definite.\n";
192  return false;
193  }
194  //}
195  // else if (issues)
196  // *issues << "QuadraticStateCost: invalid size of weight matrix Q: it shout be [" << p << " x " << p << "].\n";
197  }
198 
199  // others
200  _lsq_form = message.lsq_form();
201  _integral_form = message.integral_form();
202  return true;
203 }
204 
205 void QuadraticStateCost::toMessage(messages::QuadraticStateCost& message) const
206 {
207  // weight matrix Q
209  {
210  Eigen::VectorXd Qdiag = _Q_diag.diagonal();
211  message.mutable_q()->Resize(Qdiag.size(), 0);
212  Eigen::Map<Eigen::VectorXd>(message.mutable_q()->mutable_data(), Qdiag.size()) = Qdiag;
213 
214  message.set_diagonal_only(true);
215  }
216  else
217  {
218  Eigen::MatrixXd Q = _Q; // Q = _Q_sqrt.adjoint() * _Q_sqrt;
219  message.mutable_q()->Resize(Q.rows() * Q.cols(), 0);
220  Eigen::Map<Eigen::Matrix<double, -1, -1, Eigen::RowMajor>>(message.mutable_q()->mutable_data(), Q.rows(), Q.cols()) = Q;
221 
222  message.set_diagonal_only(false);
223  }
224  // others
225  message.set_lsq_form(_lsq_form);
226  message.set_integral_form(_integral_form);
227 }
228 #endif
229 
230 } // namespace corbo
Eigen::NumericalIssue
@ NumericalIssue
Definition: Constants.h:434
sqrt
const EIGEN_DEVICE_FUNC SqrtReturnType sqrt() const
Definition: ArrayCwiseUnaryOps.h:152
corbo::QuadraticStateCost::setWeightQ
bool setWeightQ(const Eigen::Ref< const Eigen::MatrixXd > &Q)
Definition: quadratic_state_cost.cpp:55
Eigen::DiagonalMatrix< double, -1 >
corbo
Definition: communication/include/corbo-communication/utilities.h:37
corbo::ReferenceTrajectoryInterface::getReferenceCached
virtual const OutputVector & getReferenceCached(int k) const =0
corbo::QuadraticStateCost::getNonIntegralStateTermDimension
int getNonIntegralStateTermDimension(int k) const override
Definition: quadratic_state_cost.h:95
corbo::QuadraticStateCost::_Q_diag
Eigen::DiagonalMatrix< double, -1 > _Q_diag
Definition: quadratic_state_cost.h:137
Eigen::RowMajor
@ RowMajor
Definition: Constants.h:322
corbo::QuadraticStateCost::_lsq_form
bool _lsq_form
Definition: quadratic_state_cost.h:140
corbo::QuadraticStateCost::_diagonal_mode
bool _diagonal_mode
Definition: quadratic_state_cost.h:138
corbo::QuadraticStateCost::_x_ref
const ReferenceTrajectoryInterface * _x_ref
Definition: quadratic_state_cost.h:143
Eigen::DiagonalMatrix::diagonal
const EIGEN_DEVICE_FUNC DiagonalVectorType & diagonal() const
Definition: DiagonalMatrix.h:136
corbo::is_square
bool is_square(const Eigen::MatrixBase< Derived > &matrix)
Determine if a given matrix is square.
Definition: matrix_utilities.h:65
corbo::QuadraticStateCost::_Q_sqrt
Eigen::MatrixXd _Q_sqrt
Definition: quadratic_state_cost.h:134
corbo::QuadraticStateCost::_integral_form
bool _integral_form
Definition: quadratic_state_cost.h:141
matrix_utilities.h
corbo::QuadraticStateCost::computeNonIntegralStateTerm
void computeNonIntegralStateTerm(int k, const Eigen::Ref< const Eigen::VectorXd > &x_k, Eigen::Ref< Eigen::VectorXd > cost) const override
Definition: quadratic_state_cost.cpp:87
Eigen::Map
A matrix or vector expression mapping an existing array of data.
Definition: Map.h:94
Eigen::LLT
Standard Cholesky decomposition (LL^T) of a matrix and associated features.
Definition: LLT.h:56
Eigen::Ref
A matrix or vector expression mapping an existing expression.
Definition: Ref.h:192
corbo::QuadraticStateCost::checkParameters
bool checkParameters(int state_dim, int control_dim, std::stringstream *issues) const override
Definition: quadratic_state_cost.cpp:155
quadratic_state_cost.h
corbo::QuadraticStateCost::_Q_diag_sqrt
Eigen::DiagonalMatrix< double, -1 > _Q_diag_sqrt
Definition: quadratic_state_cost.h:136
Eigen::Matrix
The matrix class, also used for vectors and row-vectors.
Definition: Matrix.h:178
corbo::QuadraticStateCost::_diagonal_mode_intentionally
bool _diagonal_mode_intentionally
Definition: quadratic_state_cost.h:139
corbo::QuadraticStateCost::_zero_x_ref
bool _zero_x_ref
Definition: quadratic_state_cost.h:144
corbo::QuadraticStateCost::_Q
Eigen::MatrixXd _Q
Definition: quadratic_state_cost.h:135
corbo::QuadraticStateCost::computeIntegralStateControlTerm
void computeIntegralStateControlTerm(int k, const Eigen::Ref< const Eigen::VectorXd > &x_k, const Eigen::Ref< const Eigen::VectorXd > &u_k, Eigen::Ref< Eigen::VectorXd > cost) const override
Definition: quadratic_state_cost.cpp:130


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