Go to the documentation of this file.
23 #ifndef MIN_TIME_VIA_POINTS_COSTS_H_
24 #define MIN_TIME_VIA_POINTS_COSTS_H_
53 using Ptr = std::shared_ptr<MinTimeViaPointsCost>;
121 std::vector<std::pair<std::vector<const teb_local_planner::PoseSE2*>, std::size_t>>
_vp_association;
127 #endif // MIN_TIME_VIA_POINTS_COSTS_H_
std::vector< std::pair< std::vector< const teb_local_planner::PoseSE2 * >, std::size_t > > _vp_association
corbo::StageCost::Ptr getInstance() const override
std::shared_ptr< StagePreprocessor > Ptr
ViaPointContainer via_points
std::vector< teb_local_planner::PoseSE2 > ViaPointContainer
int getNonIntegralStateTermDimension(int k) const override
int getNonIntegralDtTermDimension(int k) const override
void setViaPointWeights(double position_weight, double orientation_weight)
Set weights for via-point attraction.
MinTimeViaPointsCost()=default
Default constructor.
std::shared_ptr< StageCost > Ptr
void computeNonIntegralStateTerm(int k, const Eigen::Ref< const Eigen::VectorXd > &x_k, Eigen::Ref< Eigen::VectorXd > cost) const override
double _vp_orientation_weight
double _vp_position_weight
bool isLsqFormNonIntegralDtTerm(int k) const override
bool hasIntegralTerms(int k) const override
const ViaPointContainer * _via_points
void setViaPointContainer(const ViaPointContainer &via_points)
Set reference to via-point container (warning, object must remain allocated)
bool hasNonIntegralTerms(int k) const override
std::shared_ptr< MinTimeViaPointsCost > Ptr
void setViaPointOrderedMode(bool ordered)
Set if the optimzier should try to match the via-point ordering.
bool update(int n, double, corbo::ReferenceTrajectoryInterface &, corbo::ReferenceTrajectoryInterface &, corbo::ReferenceTrajectoryInterface *, bool single_dt, const Eigen::VectorXd &x0, corbo::StagePreprocessor::Ptr, const std::vector< double > &, const corbo::DiscretizationGridInterface *grid) override
std::vector< Eigen::Vector2d, Eigen::aligned_allocator< Eigen::Vector2d > > ViaPointContainer
void computeNonIntegralDtTerm(int k, double dt, Eigen::Ref< Eigen::VectorXd > cost) const override
mpc_local_planner
Author(s): Christoph Rösmann
autogenerated on Wed Mar 2 2022 00:35:06