ros_resources.hpp
Go to the documentation of this file.
00001 
00005 #ifndef _THERMALVIS_ROS_RESOURCES_H_
00006 #define _THERMALVIS_ROS_RESOURCES_H_
00007 
00008 #include "general_resources.hpp"
00009 #include "opencv_resources.hpp"
00010 
00011 /***** ROS Stuff *****/
00012 #include "ros/ros.h"
00013 #include <std_msgs/Float32.h>
00014 //#include <../../opt/ros/fuerte/include/ros/node_handle.h>
00015 #include "ros/node_handle.h"
00016 #include "std_msgs/String.h"
00017 #include <image_transport/image_transport.h>
00018 #include <sensor_msgs/Image.h>
00019 #include <sensor_msgs/CameraInfo.h>
00020 #include <sensor_msgs/SetCameraInfo.h>
00021 #include <sensor_msgs/image_encodings.h>
00022 #include <camera_calibration_parsers/parse_ini.h>
00023 #include <cv_bridge/cv_bridge.h>
00024 
00025 #include <ros/ros.h>
00026 #include <image_transport/image_transport.h>
00027 
00028 #include <tf/transform_broadcaster.h>
00029 
00030 #include <visualization_msgs/MarkerArray.h>
00031 
00032 #include <dynamic_reconfigure/server.h>
00033 
00034 namespace enc = sensor_msgs::image_encodings;
00035 
00036 void changemode(int);
00037 int  kbhit(void);
00038 double timeDiff(ros::Time time1, ros::Time time2);
00039 ros::Time findAverageTime(ros::Time time1, ros::Time time2);
00040 
00041 #define MAX_RVIZ_DISPLACEMENT   1000
00042 
00043 #endif


thermalvis
Author(s): Stephen Vidas
autogenerated on Sun Jan 5 2014 11:38:45