This is the complete list of members for mpc_local_planner::RobotDynamicsInterface, including all inherited members.
_deadtime | corbo::SystemDynamicsInterface | private |
_linearization_method | corbo::SystemDynamicsInterface | private |
ControlVector typedef | corbo::SystemDynamicsInterface | |
dynamics(const Eigen::Ref< const StateVector > &x, const Eigen::Ref< const ControlVector > &u, Eigen::Ref< StateVector > f) const=0 | corbo::SystemDynamicsInterface | pure virtual |
getDeadTime() const | corbo::SystemDynamicsInterface | virtual |
getInputDimension() const=0 | corbo::SystemDynamicsInterface | pure virtual |
getInstance() const=0 | corbo::SystemDynamicsInterface | pure virtual |
getLinearA(const StateVector &x0, const ControlVector &u0, Eigen::MatrixXd &A) const | corbo::SystemDynamicsInterface | virtual |
getLinearB(const StateVector &x0, const ControlVector &u0, Eigen::MatrixXd &B) const | corbo::SystemDynamicsInterface | virtual |
getPoseSE2FromState(const Eigen::Ref< const Eigen::VectorXd > &x, double &pos_x, double &pos_y, double &theta) const =0 | mpc_local_planner::RobotDynamicsInterface | pure virtual |
getPoseSE2FromState(const Eigen::Ref< const Eigen::VectorXd > &x, teb_local_planner::PoseSE2 &pose) const | mpc_local_planner::RobotDynamicsInterface | inlinevirtual |
getPositionFromState(const Eigen::Ref< const Eigen::VectorXd > &x, double &pos_x, double &pos_y) const =0 | mpc_local_planner::RobotDynamicsInterface | pure virtual |
getStateDimension() const=0 | corbo::SystemDynamicsInterface | pure virtual |
getSteadyStateFromPoseSE2(double pos_x, double pos_y, double theta, Eigen::Ref< Eigen::VectorXd > x) const =0 | mpc_local_planner::RobotDynamicsInterface | pure virtual |
getSteadyStateFromPoseSE2(const teb_local_planner::PoseSE2 &pose, Eigen::Ref< Eigen::VectorXd > x) const | mpc_local_planner::RobotDynamicsInterface | inlinevirtual |
getTwistFromControl(const Eigen::Ref< const Eigen::VectorXd > &u, geometry_msgs::Twist &twist) const =0 | mpc_local_planner::RobotDynamicsInterface | pure virtual |
isContinuousTime() const=0 | corbo::SystemDynamicsInterface | pure virtual |
isLinear() const=0 | corbo::SystemDynamicsInterface | pure virtual |
mergeStateFeedbackAndOdomFeedback(const teb_local_planner::PoseSE2 &odom_pose, const geometry_msgs::Twist &odom_twist, Eigen::Ref< Eigen::VectorXd > x) const =0 | mpc_local_planner::RobotDynamicsInterface | pure virtual |
Ptr typedef | mpc_local_planner::RobotDynamicsInterface | |
reset() | mpc_local_planner::RobotDynamicsInterface | inlinevirtual |
setLinearizationMethod(std::shared_ptr< FiniteDifferencesInterface > lin_method) | corbo::SystemDynamicsInterface | |
StateVector typedef | corbo::SystemDynamicsInterface | |
SystemDynamicsInterface() | corbo::SystemDynamicsInterface | |
~SystemDynamicsInterface()=default | corbo::SystemDynamicsInterface | virtual |