#include "mrpt_bridge/GPS.h"
#include "mrpt_bridge/range.h"
#include "mrpt_bridge/imu.h"
#include "mrpt_bridge/image.h"
#include "mrpt_bridge/stereo_image.h"
#include "../GPS.cpp"
#include "../range.cpp"
#include "../imu.cpp"
#include "../image.cpp"
#include "../stereo_image.cpp"
#include <mrpt/obs/CRawlog.h>
#include <mrpt/system/filesystem.h>
#include <dirent.h>
Go to the source code of this file.
Functions | |
int | main (int argc, char **argv) |
int main | ( | int | argc, |
char ** | argv | ||
) |
main method to test the MRPT_ROS bridge to test converisons between MRPT messages and ROS messages the results of the topics published values can be viewed in RViz
argc | |
argv |
Testing Range mrpt --> ros
initializing num_ranges of the ros Range messages
Testing Imu mrpt--> ros
Testing Image mrpt-->ros
Need to change this path to be the path having the images by the user
Testing stereo_image mrpt-->ROS Testing Image mrpt-->ros
Need to change this path to be the path having the images by the user
right images
Commpn header for all ROS messages
Publishing sensor_msgs::Image ROS message
Publishing Stereo Images
Publishing sensor_msgs::Imu ROS message
Publishing sensor_msgs::NavSatFix ROS message
Publishing sensor_msgs::Range ROS message
Definition at line 49 of file test_Bridge.cpp.