KalmanDataTypes.hpp
Go to the documentation of this file.
00001 
00002 #include <telekyb_msgs/TKState.h>
00003 #include <sensor_msgs/Imu.h>
00004 #include <geometry_msgs/TransformStamped.h>
00005 #include <Eigen/Core>
00006 
00007 #ifndef KALMANDATATYPES_HPP_
00008 #define KALMANDATATYPES_HPP_
00009 
00010 // Buffers
00011 struct StateBufferElement
00012 {
00013         double timeStamp;
00014         //Eigen::Matrix<double,10,1> state;
00015         telekyb_msgs::TKState state;
00016         Eigen::Matrix<double,9,9> covariance;
00017 };
00018 
00019 struct MeasureBufferElement
00020 {
00021                 double timeStamp;
00022         geometry_msgs::TransformStamped measure;
00023         //int   sensorID;
00024         //Eigen::Matrix<double,6,9> covariance;
00025 };
00026 
00027 struct InputBufferElement
00028 {
00029         double timeStamp;
00030         //Eigen::Matrix<double,6,1> input;
00031         sensor_msgs::Imu input;
00032 };
00033 
00034 #endif /* KALMANDATATYPES_HPP_ */
 All Classes Namespaces Files Functions Variables Typedefs Enumerations Friends


tk_state
Author(s): Dr. Antonio Franchi and Martin Riedel
autogenerated on Mon Nov 11 2013 11:13:03