76 virtual void update_x(CvMat *x_pred, CvMat *
x);
86 virtual void predict_x(
unsigned long tick);
106 virtual CvMat *predict();
143 virtual void update_K(CvMat *P_pred);
147 virtual void update_P(CvMat *P_pred, CvMat *P);
200 virtual void update_F(
unsigned long tick);
207 CvMat *predict(
unsigned long tick);
214 CvMat *predict_update(
KalmanSensor *sensor,
unsigned long tick);
216 double seconds_since_update(
unsigned long tick);
232 virtual void h(CvMat *x_pred, CvMat *_z_pred) = 0;
233 virtual void update_H(CvMat *x_pred);
234 virtual void update_x(CvMat *x_pred, CvMat *x);
254 virtual void f(CvMat *_x, CvMat *_x_pred,
double dt) = 0;
255 virtual void update_F(
unsigned long tick);
256 virtual void predict_x(
unsigned long tick);
290 void img_matrix(CvMat *mat,
int top,
int left);
Extended Kalman Filter (EKF) sensor implementation.
Extended Kalman Filter (EKF) implementation.
Core implementation for Kalman.
KalmanSensorCore * sensor
Class for visualizing Kalman filter.
CvMat * K
The matrix (n*m) containing Kalman gain (something between 0 and H^-1). In this core-implementation w...
CvMat * P
The error covariance matrix describing the accuracy of the state estimate.
int get_n()
Accessor for n.
void ALVAR_EXPORT out_matrix(const CvMat *m, const char *name)
Output OpenCV matrix for debug purposes.
CvMat * P_pred
The predicted error covariance matrix.
IplImage * img_show
Image to show.
Core implementation for Kalman sensor.
IplImage * img_legend
Image to show.
CvMat * R
The covariance matrix for the observation noise.
Kalman sensor implementation.
int get_m()
Accessor for m.
TFSIMD_FORCE_INLINE const tfScalar & x() const
CvMat * H
The matrix (m*n) mapping Kalman state vector into this sensor's measurements vector.
CvMat * F
The matrix (n*n) containing the transition model for the internal state.
CvMat * x_pred
Predicted state, TODO: should be protected?!
CvMat * Q
The covariance matrix for the process noise.
CvMat * z
Latest measurement vector (m*1)
CvMat * x
The Kalman state vector (n*1)
IplImage * img
Image collecting visualization of the Kalman filter.
KalmanSensor * sensor_ext
int img_scale
visualization scale before show
int get_n()
Accessor for n.
virtual void update_H(CvMat *x_pred)
Method for updating how the Kalman state vector is mapped into this sensor's measurements vector...
This file defines library export definitions, version numbers and build information.