Go to the documentation of this file.
21 #include <Eigen/Dense>
28 typedef Eigen::Matrix<double, 2, 2>
Matrix2d;
29 typedef Eigen::Matrix<double, 3, 3>
Matrix3d;
30 typedef Eigen::Matrix<double, 3, 2>
Matrix32d;
31 typedef Eigen::Matrix<double, 2, 3>
Matrix23d;
40 void set_parameters(
const Motion_Noise &motion_noise,
const Measurement_Noise &measurement_noise,
41 const Controller &_controller);
void get_motion_jacobi(const State &state, const Control &control, double integration_step, Matrix3d &F_x, Matrix32d &F_u) const
Computes the Jacobians of the motion equations with respect to the state and control.
Measurement_Noise measurement_noise_
Measurement noise.
Description of a kinematic car's state.
Eigen::Matrix< double, 3, 2 > Matrix32d
Matrix3d covariance_to_eigen(const double covariance[16]) const
Converts a covariance given by a double array to an Eigen matrix.
Matrix3d get_observation_jacobi() const
Computes the Jacobian of the observation equations with respect to the state.
Matrix3d I_
Identity matrix.
Matrix2d get_motion_covariance(const State &state, const Control &control, double integration_step) const
Returns the motion covariance in control space.
Eigen::Matrix< double, 3, 3 > Matrix3d
Description of a path segment with its corresponding control inputs.
void update(const State_With_Covariance &state_pred, State_With_Covariance &state_corr) const
Predicts the covariances.
void set_parameters(const Motion_Noise &motion_noise, const Measurement_Noise &measurement_noise, const Controller &_controller)
Sets the parameters required by the EKF.
Motion_Noise motion_noise_
Motion noise.
Parameters of the motion noise model according to the book: Probabilistic Robotics,...
Matrix23d get_controller_gain(const Control &control) const
Returns the gain of the controller.
Controller controller_
Feedback controller.
void predict(const State_With_Covariance &state, const Control &control, double integration_step, State_With_Covariance &state_pred) const
Predicts the covariances based on the paper: Rapidly-exploring random belief trees for motion plannin...
Matrix3d get_rotation_matrix(double angle) const
Returns the rotation matrix from a global frame to a local frame.
void eigen_to_covariance(const Matrix3d &covariance_eigen, double covariance[16]) const
Converts a covariance given by an Eigen matrix to a double array.
Description of a kinematic car's state with covariance.
Parameters of the feedback controller.
EIGEN_MAKE_ALIGNED_OPERATOR_NEW
Overload operator new for fixed-size vectorizable Eigen member variable.
Eigen::Matrix< double, 2, 2 > Matrix2d
Matrix3d get_observation_covariance() const
Returns the observation covariance.
Parameters of the measurement noise.
Eigen::Matrix< double, 2, 3 > Matrix23d