This is the complete list of members for mpc_local_planner::BaseRobotSE2, including all inherited members.
| _deadtime | corbo::SystemDynamicsInterface | private |
| _linearization_method | corbo::SystemDynamicsInterface | private |
| BaseRobotSE2()=default | mpc_local_planner::BaseRobotSE2 | |
| ControlVector typedef | corbo::SystemDynamicsInterface | |
| dynamics(const Eigen::Ref< const StateVector > &x, const Eigen::Ref< const ControlVector > &u, Eigen::Ref< StateVector > f) const override=0 | mpc_local_planner::BaseRobotSE2 | pure virtual |
| getDeadTime() const | corbo::SystemDynamicsInterface | virtual |
| getInputDimension() const override=0 | mpc_local_planner::BaseRobotSE2 | pure virtual |
| getInstance() const override=0 | mpc_local_planner::BaseRobotSE2 | 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 override | mpc_local_planner::BaseRobotSE2 | inlinevirtual |
| mpc_local_planner::RobotDynamicsInterface::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 override | mpc_local_planner::BaseRobotSE2 | inlinevirtual |
| getStateDimension() const override | mpc_local_planner::BaseRobotSE2 | inlinevirtual |
| getSteadyStateFromPoseSE2(double pos_x, double pos_y, double theta, Eigen::Ref< Eigen::VectorXd > x) const override | mpc_local_planner::BaseRobotSE2 | inlinevirtual |
| mpc_local_planner::RobotDynamicsInterface::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 override | mpc_local_planner::BaseRobotSE2 | inlinevirtual |
| isLinear() const override | mpc_local_planner::BaseRobotSE2 | inlinevirtual |
| mergeStateFeedbackAndOdomFeedback(const teb_local_planner::PoseSE2 &odom_pose, const geometry_msgs::Twist &odom_twist, Eigen::Ref< Eigen::VectorXd > x) const override | mpc_local_planner::BaseRobotSE2 | inlinevirtual |
| Ptr typedef | mpc_local_planner::BaseRobotSE2 | |
| 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 |