final_state_conditions_se2.cpp
Go to the documentation of this file.
1 /*********************************************************************
2  *
3  * Software License Agreement
4  *
5  * Copyright (c) 2020, Christoph Rösmann, All rights reserved.
6  *
7  * This program is free software: you can redistribute it and/or modify
8  * it under the terms of the GNU General Public License as published by
9  * the Free Software Foundation, either version 3 of the License, or
10  * (at your option) any later version.
11  *
12  * This program is distributed in the hope that it will be useful,
13  * but WITHOUT ANY WARRANTY; without even the implied warranty of
14  * MERCHANTABILITY or FITNESS FOR A PARTICULAR PURPOSE. See the
15  * GNU General Public License for more details.
16  *
17  * You should have received a copy of the GNU General Public License
18  * along with this program. If not, see <https://www.gnu.org/licenses/>.
19  *
20  * Authors: Christoph Rösmann
21  *********************************************************************/
22 
24 
26 
27 #include <cmath>
28 
29 namespace mpc_local_planner {
30 
32  Eigen::Ref<Eigen::VectorXd> cost) const
33 {
34  assert(cost.size() == getNonIntegralStateTermDimension(k));
35 
36  Eigen::VectorXd xd = x_k - _x_ref->getReferenceCached(k);
37  xd[2] = normalize_theta(xd[2]);
38  if (_lsq_form)
39  {
40  if (_diagonal_mode)
41  cost.noalias() = _Qf_diag_sqrt * xd;
42  else
43  cost.noalias() = _Qf_sqrt * xd;
44  }
45  else
46  {
47  if (_diagonal_mode)
48  cost.noalias() = xd.transpose() * _Qf_diag * xd;
49  else
50  cost.noalias() = xd.transpose() * _Qf * xd;
51  }
52 }
53 
55 {
56  assert(cost.size() == getNonIntegralStateTermDimension(k));
57 
58  Eigen::VectorXd xd = x_k - _x_ref->getReferenceCached(k);
59  xd[2] = normalize_theta(xd[2]);
60  if (_diagonal_mode)
61  cost[0] = xd.transpose() * _S_diag * xd - _gamma;
62  else
63  cost[0] = xd.transpose() * _S * xd - _gamma;
64 }
65 
66 } // namespace mpc_local_planner
void computeNonIntegralStateTerm(int k, const Eigen::Ref< const Eigen::VectorXd > &x_k, Eigen::Ref< Eigen::VectorXd > cost) const override
virtual const OutputVector & getReferenceCached(int k) const=0
int getNonIntegralStateTermDimension(int k) const override
const ReferenceTrajectoryInterface * _x_ref
void computeNonIntegralStateTerm(int k, const Eigen::Ref< const Eigen::VectorXd > &x_k, Eigen::Ref< Eigen::VectorXd > cost) const override
double normalize_theta(double theta)
normalize angle to interval [-pi, pi)
Definition: math_utils.h:81
Eigen::DiagonalMatrix< double, -1 > _Qf_diag
Eigen::DiagonalMatrix< double, -1 > _Qf_diag_sqrt


mpc_local_planner
Author(s): Christoph Rösmann
autogenerated on Mon Feb 28 2022 22:53:18