#include <Eigen/Eigen>#include <ros/ros.h>#include <dynamic_reconfigure/server.h>#include <ssf_core/SSF_CoreConfig.h>#include <sensor_fusion_comm/DoubleArrayStamped.h>#include <sensor_fusion_comm/ExtState.h>#include <sensor_fusion_comm/ExtEkf.h>#include <geometry_msgs/PoseWithCovarianceStamped.h>#include <sensor_msgs/Imu.h>#include <vector>#include <ssf_core/state.h>

Go to the source code of this file.
Classes | |
| class | ssf_core::SSF_Core |
Namespaces | |
| namespace | ssf_core |
Defines | |
| #define | HLI_EKF_STATE_SIZE 16 |
| number of states exchanged with external propagation. Here: p,v,q,bw,bw=16 | |
| #define | N_STATE_BUFFER 256 |
| size of unsigned char, do not change! | |
Typedefs | |
| typedef dynamic_reconfigure::Server < ssf_core::SSF_CoreConfig > | ssf_core::ReconfigureServer |
| #define HLI_EKF_STATE_SIZE 16 |
number of states exchanged with external propagation. Here: p,v,q,bw,bw=16
Definition at line 53 of file SSF_Core.h.
| #define N_STATE_BUFFER 256 |
size of unsigned char, do not change!
Definition at line 52 of file SSF_Core.h.