_modified | corbo::VertexSetInterface | protected |
_u_prev | corbo::DiscretizationGridInterface | protected |
_u_prev_dt | corbo::DiscretizationGridInterface | protected |
_u_ref | corbo::DiscretizationGridInterface | protected |
applyIncrementNonFixed(const Eigen::Ref< const Eigen::VectorXd > &increment) | corbo::VertexSetInterface | |
applyIncrementNonFixed(int idx, double increment) | corbo::VertexSetInterface | |
backupParametersActiveVertices() | corbo::VertexSetInterface | |
clear() override=0 | corbo::DiscretizationGridInterface | pure virtual |
clearConnectedEdges() | corbo::VertexSetInterface | |
computeActiveVertices() override=0 | corbo::DiscretizationGridInterface | protectedpure virtual |
computeVertexIndices() | corbo::VertexSetInterface | |
discardBackupParametersActiveVertices(bool all=false) | corbo::VertexSetInterface | |
DiscretizationGridInterface()=default | corbo::DiscretizationGridInterface | |
DiscretizationGridInterface(int state_dim, int control_dim) | corbo::DiscretizationGridInterface | |
getActiveVertices() override=0 | corbo::DiscretizationGridInterface | protectedpure virtual |
getBounds(Eigen::Ref< Eigen::VectorXd > lb, Eigen::Ref< Eigen::VectorXd > ub) | corbo::VertexSetInterface | |
getFactory() | corbo::DiscretizationGridInterface | inlinestatic |
getFinalTime() const =0 | corbo::DiscretizationGridInterface | pure virtual |
getFirstControlInput(Eigen::VectorXd &u0)=0 | corbo::DiscretizationGridInterface | pure virtual |
getFirstDt() const =0 | corbo::DiscretizationGridInterface | pure virtual |
getInitialDt() const =0 | corbo::DiscretizationGridInterface | pure virtual |
getInitialN() const =0 | corbo::DiscretizationGridInterface | pure virtual |
getInstance() const =0 | corbo::DiscretizationGridInterface | pure virtual |
getLowerBound(int idx) | corbo::VertexSetInterface | |
getN() const =0 | corbo::DiscretizationGridInterface | pure virtual |
getParameterDimension() | corbo::VertexSetInterface | |
getParameterValue(int idx) | corbo::VertexSetInterface | |
getParameterVector(Eigen::Ref< Eigen::VectorXd > x) | corbo::VertexSetInterface | |
getStateAndControlTimeSeries(TimeSeries::Ptr x_sequence, TimeSeries::Ptr u_sequence, double t_max=CORBO_INF_DBL) const =0 | corbo::DiscretizationGridInterface | pure virtual |
getUpperBound(int idx) | corbo::VertexSetInterface | |
getVertices(std::vector< VertexInterface *> &vertices) override=0 | corbo::DiscretizationGridInterface | protectedpure virtual |
hasConstantControls() const =0 | corbo::DiscretizationGridInterface | pure virtual |
hasSingleDt() const =0 | corbo::DiscretizationGridInterface | pure virtual |
isEmpty() const =0 | corbo::DiscretizationGridInterface | pure virtual |
isModified() const | corbo::VertexSetInterface | inline |
isTimeVariableGrid() const =0 | corbo::DiscretizationGridInterface | pure virtual |
isUniformGrid() const =0 | corbo::DiscretizationGridInterface | pure virtual |
providesStateTrajectory() const =0 | corbo::DiscretizationGridInterface | pure virtual |
Ptr typedef | corbo::DiscretizationGridInterface | |
restoreBackupParametersActiveVertices(bool keep_backup) | corbo::VertexSetInterface | |
setBounds(const Eigen::Ref< const Eigen::VectorXd > &lb, const Eigen::Ref< const Eigen::VectorXd > &ub) | corbo::VertexSetInterface | |
setInitialDt(double dt)=0 | corbo::DiscretizationGridInterface | pure virtual |
setLastControlRef(const Eigen::VectorXd &last_u_ref) | corbo::DiscretizationGridInterface | inlineprotected |
setLowerBound(int idx, double lb) | corbo::VertexSetInterface | |
setModified(bool modified) | corbo::VertexSetInterface | inline |
setN(int n, bool try_resample=true)=0 | corbo::DiscretizationGridInterface | pure virtual |
setParameterValue(int idx, double x) | corbo::VertexSetInterface | |
setParameterVector(const Eigen::Ref< const Eigen::VectorXd > &x) | corbo::VertexSetInterface | |
setPreviousControl(const Eigen::VectorXd &prev_u, double prev_u_dt) | corbo::DiscretizationGridInterface | inlineprotected |
setUpperBound(int idx, double ub) | corbo::VertexSetInterface | |
setVertexIdx(VertexInterface &vertex, int idx) | corbo::VertexSetInterface | inlineprotected |
update(const Eigen::VectorXd &x0, ReferenceTrajectoryInterface &xref, ReferenceTrajectoryInterface &uref, NlpFunctions &nlp_fun, OptimizationEdgeSet &edges, SystemDynamicsInterface::Ptr dynamics, bool new_run, const Time &t, ReferenceTrajectoryInterface *sref=nullptr, const Eigen::VectorXd *prev_u=nullptr, double prev_u_dt=0, ReferenceTrajectoryInterface *xinit=nullptr, ReferenceTrajectoryInterface *uinit=nullptr)=0 | corbo::DiscretizationGridInterface | pure virtual |
UPtr typedef | corbo::DiscretizationGridInterface | |
VertexSetInterface() | corbo::VertexSetInterface | inline |
~DiscretizationGridInterface()=default | corbo::DiscretizationGridInterface | virtual |
~VertexSetInterface() | corbo::VertexSetInterface | inlinevirtual |