#include <string>
#include <gtest/gtest.h>
#include "ros/ros.h"
#include "nav_msgs/Odometry.h"
#include "geometry_msgs/PoseWithCovarianceStamped.h"
#include <boost/thread.hpp>
Go to the source code of this file.
Classes | |
class | TestEKF |
Typedefs | |
typedef boost::shared_ptr < geometry_msgs::PoseWithCovarianceStamped const > | EkfConstPtr |
typedef boost::shared_ptr < nav_msgs::Odometry const > | OdomConstPtr |
Functions | |
int | main (int argc, char **argv) |
TEST_F (TestEKF, test) | |
Variables | |
static const double | ekf_duration = 40 |
static const double | EPS_rot_w = 0.005 |
static const double | EPS_rot_x = 0.005 |
static const double | EPS_rot_y = 0.005 |
static const double | EPS_rot_z = 0.005 |
static const double | EPS_trans_x = 0.1 |
static const double | EPS_trans_y = 0.1 |
static const double | EPS_trans_z = 0.00001 |
int | g_argc |
char ** | g_argv |
static const double | time_end = 1368022016.0 |
typedef boost::shared_ptr<geometry_msgs::PoseWithCovarianceStamped const> EkfConstPtr |
Definition at line 62 of file test_robot_pose_ekf_gps.cpp.
typedef boost::shared_ptr<nav_msgs::Odometry const> OdomConstPtr |
Definition at line 61 of file test_robot_pose_ekf_gps.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 185 of file test_robot_pose_ekf_gps.cpp.
Definition at line 134 of file test_robot_pose_ekf_gps.cpp.
const double ekf_duration = 40 [static] |
Definition at line 49 of file test_robot_pose_ekf_gps.cpp.
const double EPS_rot_w = 0.005 [static] |
Definition at line 56 of file test_robot_pose_ekf_gps.cpp.
const double EPS_rot_x = 0.005 [static] |
Definition at line 53 of file test_robot_pose_ekf_gps.cpp.
const double EPS_rot_y = 0.005 [static] |
Definition at line 54 of file test_robot_pose_ekf_gps.cpp.
const double EPS_rot_z = 0.005 [static] |
Definition at line 55 of file test_robot_pose_ekf_gps.cpp.
const double EPS_trans_x = 0.1 [static] |
Definition at line 50 of file test_robot_pose_ekf_gps.cpp.
const double EPS_trans_y = 0.1 [static] |
Definition at line 51 of file test_robot_pose_ekf_gps.cpp.
const double EPS_trans_z = 0.00001 [static] |
Definition at line 52 of file test_robot_pose_ekf_gps.cpp.
int g_argc |
Definition at line 58 of file test_robot_pose_ekf_gps.cpp.
char** g_argv |
Definition at line 59 of file test_robot_pose_ekf_gps.cpp.
const double time_end = 1368022016.0 [static] |
Definition at line 48 of file test_robot_pose_ekf_gps.cpp.