| _auto_update_prev_control | corbo::PredictiveController | protected |
| _dynamics | mpc_local_planner::Controller | protected |
| _force_reinit_new_goal_angular | mpc_local_planner::Controller | protected |
| _force_reinit_new_goal_dist | mpc_local_planner::Controller | protected |
| _force_reinit_num_steps | mpc_local_planner::Controller | protected |
| _grid | mpc_local_planner::Controller | protected |
| _guess_backwards_motion | mpc_local_planner::Controller | protected |
| _inequality_constraint | mpc_local_planner::Controller | protected |
| _initial_plan_estimate_orientation | mpc_local_planner::Controller | protected |
| _initialized | corbo::PredictiveController | protected |
| _last_goal | mpc_local_planner::Controller | protected |
| _num_ocp_iterations | corbo::PredictiveController | protected |
| _ocp | corbo::PredictiveController | protected |
| _ocp_result_pub | mpc_local_planner::Controller | protected |
| _ocp_seq | mpc_local_planner::Controller | protected |
| _ocp_successful | mpc_local_planner::Controller | protected |
| _output_control_sequence | corbo::PredictiveController | protected |
| _output_state_sequence | corbo::PredictiveController | protected |
| _prefer_x_feedback | mpc_local_planner::Controller | protected |
| _print_cpu_time | mpc_local_planner::Controller | protected |
| _publish_ocp_results | mpc_local_planner::Controller | protected |
| _publish_prediction | corbo::PredictiveController | protected |
| _recent_x_feedback | mpc_local_planner::Controller | protected |
| _recent_x_time | mpc_local_planner::Controller | protected |
| _robot_type | mpc_local_planner::Controller | protected |
| _solver | mpc_local_planner::Controller | protected |
| _statistics | corbo::PredictiveController | protected |
| _structured_ocp | mpc_local_planner::Controller | protected |
| _u_ts | corbo::PredictiveController | protected |
| _x_feedback_mutex | mpc_local_planner::Controller | protected |
| _x_feedback_sub | mpc_local_planner::Controller | protected |
| _x_seq_init | mpc_local_planner::Controller | protected |
| _x_ts | corbo::PredictiveController | protected |
| configure(ros::NodeHandle &nh, const teb_local_planner::ObstContainer &obstacles, teb_local_planner::RobotFootprintModelPtr robot_model, const std::vector< teb_local_planner::PoseSE2 > &via_points) | mpc_local_planner::Controller | |
| configureGrid(const ros::NodeHandle &nh) | mpc_local_planner::Controller | protected |
| configureOcp(const ros::NodeHandle &nh, const teb_local_planner::ObstContainer &obstacles, teb_local_planner::RobotFootprintModelPtr robot_model, const std::vector< teb_local_planner::PoseSE2 > &via_points) | mpc_local_planner::Controller | protected |
| configureRobotDynamics(const ros::NodeHandle &nh) | mpc_local_planner::Controller | protected |
| configureSolver(const ros::NodeHandle &nh) | mpc_local_planner::Controller | protected |
| Controller()=default | mpc_local_planner::Controller | |
| ControlVector typedef | corbo::ControllerInterface | |
| generateInitialStateTrajectory(const Eigen::VectorXd &x0, const Eigen::VectorXd &xf, const std::vector< geometry_msgs::PoseStamped > &initial_plan, bool backward) | mpc_local_planner::Controller | protected |
| getAutoUpdatePreviousControl() const | corbo::PredictiveController | |
| getAvailableSignals(SignalTargetInterface &signal_target, const std::string &ns="") const override | corbo::PredictiveController | virtual |
| getControlDuration() const override | corbo::PredictiveController | virtual |
| getControlInputDimension() const override | corbo::PredictiveController | virtual |
| getFactory() | corbo::ControllerInterface | static |
| getInequalityConstraint() | mpc_local_planner::Controller | inline |
| getInstance() const override | mpc_local_planner::Controller | inlinevirtual |
| getInstanceStatic() | mpc_local_planner::Controller | inlinestatic |
| getNumOcpIterations() const | corbo::PredictiveController | |
| getOptimalControlProblem() | corbo::PredictiveController | |
| getRobotDynamics() | mpc_local_planner::Controller | inline |
| getStateDimension() const override | corbo::PredictiveController | virtual |
| getStatistics() const override | corbo::PredictiveController | virtual |
| hasPiecewiseConstantControls() const override | corbo::PredictiveController | virtual |
| initialize(const StateVector &x, ReferenceTrajectoryInterface &expected_xref, ReferenceTrajectoryInterface &expected_uref, const Duration &expected_dt, const Time &t, ReferenceTrajectoryInterface *sref=nullptr) override | corbo::PredictiveController | virtual |
| isPoseTrajectoryFeasible(base_local_planner::CostmapModel *costmap_model, const std::vector< geometry_msgs::Point > &footprint_spec, double inscribed_radius=0.0, double circumscribed_radius=0.0, double min_resolution_collision_check_angular=M_PI, int look_ahead_idx=-1) | mpc_local_planner::Controller | virtual |
| isPublishPrediction() const | corbo::PredictiveController | |
| PoseSE2 typedef | mpc_local_planner::Controller | |
| PredictiveController() | corbo::PredictiveController | |
| providesFutureControls() const override | corbo::PredictiveController | virtual |
| providesFutureStates() const override | corbo::PredictiveController | virtual |
| Ptr typedef | mpc_local_planner::Controller | |
| publishOptimalControlResult() | mpc_local_planner::Controller | |
| reset() override | mpc_local_planner::Controller | virtual |
| sendSignals(double t, SignalTargetInterface &signal_target, const std::string &ns="") const override | corbo::PredictiveController | virtual |
| setAutoUpdatePreviousControl(bool enable) | corbo::PredictiveController | |
| setInitialPlanEstimateOrientation(bool estimate) | mpc_local_planner::Controller | inline |
| setNumOcpIterations(int ocp_iter) | corbo::PredictiveController | |
| setOptimalControlProblem(corbo::OptimalControlProblemInterface::Ptr ocp)=delete | mpc_local_planner::Controller | |
| setOutputControlSequenceLenght(bool activate) | corbo::PredictiveController | |
| setOutputStateSequenceLenght(bool activate) | corbo::PredictiveController | |
| setPublishPrediction(bool publish) | corbo::PredictiveController | |
| stateFeedbackCallback(const mpc_local_planner_msgs::StateFeedback::ConstPtr &msg) | mpc_local_planner::Controller | |
| StateVector typedef | corbo::ControllerInterface | |
| step(const PoseSE2 &start, const PoseSE2 &goal, const geometry_msgs::Twist &vel, double dt, ros::Time t, corbo::TimeSeries::Ptr u_seq, corbo::TimeSeries::Ptr x_seq) | mpc_local_planner::Controller | |
| step(const std::vector< geometry_msgs::PoseStamped > &initial_plan, const geometry_msgs::Twist &vel, double dt, ros::Time t, corbo::TimeSeries::Ptr u_seq, corbo::TimeSeries::Ptr x_seq) | mpc_local_planner::Controller | |
| corbo::PredictiveController::step(const StateVector &x, ReferenceTrajectoryInterface &xref, ReferenceTrajectoryInterface &uref, const Duration &dt, const Time &t, TimeSeries::Ptr u_sequence, TimeSeries::Ptr x_sequence, SignalTargetInterface *signal_target=nullptr, ReferenceTrajectoryInterface *sref=nullptr, ReferenceTrajectoryInterface *xinit=nullptr, ReferenceTrajectoryInterface *uinit=nullptr, const std::string &ns="") override | corbo::PredictiveController | virtual |
| corbo::ControllerInterface::step(const StateVector &x, ReferenceTrajectoryInterface &xref, ReferenceTrajectoryInterface &uref, const Duration &dt, const Time &t, ControlVector &u, SignalTargetInterface *signal_target=nullptr, const std::string &ns="") | corbo::ControllerInterface | virtual |
| supportsAsynchronousControl() const override | corbo::PredictiveController | virtual |
| UPtr typedef | corbo::ControllerInterface | |
| ~ControllerInterface() | corbo::ControllerInterface | virtual |