#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 = 62.0 |
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.02 |
static const double | EPS_trans_y = 0.04 |
static const double | EPS_trans_z = 0.00001 |
int | g_argc |
char ** | g_argv |
static const double | time_end = 1264198883.0 |
typedef boost::shared_ptr<geometry_msgs::PoseWithCovarianceStamped const> EkfConstPtr |
Definition at line 63 of file test_robot_pose_ekf.cpp.
typedef boost::shared_ptr<nav_msgs::Odometry const> OdomConstPtr |
Definition at line 62 of file test_robot_pose_ekf.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 186 of file test_robot_pose_ekf.cpp.
Definition at line 138 of file test_robot_pose_ekf.cpp.
const double ekf_duration = 62.0 [static] |
Definition at line 49 of file test_robot_pose_ekf.cpp.
const double EPS_rot_w = 0.005 [static] |
Definition at line 56 of file test_robot_pose_ekf.cpp.
const double EPS_rot_x = 0.005 [static] |
Definition at line 53 of file test_robot_pose_ekf.cpp.
const double EPS_rot_y = 0.005 [static] |
Definition at line 54 of file test_robot_pose_ekf.cpp.
const double EPS_rot_z = 0.005 [static] |
Definition at line 55 of file test_robot_pose_ekf.cpp.
const double EPS_trans_x = 0.02 [static] |
Definition at line 50 of file test_robot_pose_ekf.cpp.
const double EPS_trans_y = 0.04 [static] |
Definition at line 51 of file test_robot_pose_ekf.cpp.
const double EPS_trans_z = 0.00001 [static] |
Definition at line 52 of file test_robot_pose_ekf.cpp.
int g_argc |
Definition at line 59 of file test_robot_pose_ekf.cpp.
char** g_argv |
Definition at line 60 of file test_robot_pose_ekf.cpp.
const double time_end = 1264198883.0 [static] |
Definition at line 48 of file test_robot_pose_ekf.cpp.