#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 |
Functions | |
int | main (int argc, char **argv) |
TEST_F (TestEKF, test) | |
Variables | |
int | g_argc |
char ** | g_argv |
typedef boost::shared_ptr<geometry_msgs::PoseWithCovarianceStamped const> EkfConstPtr |
Definition at line 51 of file test_robot_pose_ekf_zero_covariance.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 104 of file test_robot_pose_ekf_zero_covariance.cpp.
Definition at line 86 of file test_robot_pose_ekf_zero_covariance.cpp.
int g_argc |
Definition at line 48 of file test_robot_pose_ekf_zero_covariance.cpp.
char** g_argv |
Definition at line 49 of file test_robot_pose_ekf_zero_covariance.cpp.