00001
00002 #ifndef PANO_ROS_MESSAGE_PANO_H
00003 #define PANO_ROS_MESSAGE_PANO_H
00004 #include <string>
00005 #include <vector>
00006 #include <map>
00007 #include <ostream>
00008 #include "ros/serialization.h"
00009 #include "ros/builtin_message_traits.h"
00010 #include "ros/message_operations.h"
00011 #include "ros/time.h"
00012
00013 #include "ros/macros.h"
00014
00015 #include "ros/assert.h"
00016
00017 #include "std_msgs/Header.h"
00018 #include "sensor_msgs/Image.h"
00019
00020 namespace pano_ros
00021 {
00022 template <class ContainerAllocator>
00023 struct Pano_ {
00024 typedef Pano_<ContainerAllocator> Type;
00025
00026 Pano_()
00027 : header()
00028 , pano_id()
00029 , latitude(0.0)
00030 , longitude(0.0)
00031 , heading(0.0)
00032 , geo_tag()
00033 , image()
00034 {
00035 }
00036
00037 Pano_(const ContainerAllocator& _alloc)
00038 : header(_alloc)
00039 , pano_id(_alloc)
00040 , latitude(0.0)
00041 , longitude(0.0)
00042 , heading(0.0)
00043 , geo_tag(_alloc)
00044 , image(_alloc)
00045 {
00046 }
00047
00048 typedef ::std_msgs::Header_<ContainerAllocator> _header_type;
00049 ::std_msgs::Header_<ContainerAllocator> header;
00050
00051 typedef std::basic_string<char, std::char_traits<char>, typename ContainerAllocator::template rebind<char>::other > _pano_id_type;
00052 std::basic_string<char, std::char_traits<char>, typename ContainerAllocator::template rebind<char>::other > pano_id;
00053
00054 typedef double _latitude_type;
00055 double latitude;
00056
00057 typedef double _longitude_type;
00058 double longitude;
00059
00060 typedef double _heading_type;
00061 double heading;
00062
00063 typedef std::basic_string<char, std::char_traits<char>, typename ContainerAllocator::template rebind<char>::other > _geo_tag_type;
00064 std::basic_string<char, std::char_traits<char>, typename ContainerAllocator::template rebind<char>::other > geo_tag;
00065
00066 typedef ::sensor_msgs::Image_<ContainerAllocator> _image_type;
00067 ::sensor_msgs::Image_<ContainerAllocator> image;
00068
00069
00070 typedef boost::shared_ptr< ::pano_ros::Pano_<ContainerAllocator> > Ptr;
00071 typedef boost::shared_ptr< ::pano_ros::Pano_<ContainerAllocator> const> ConstPtr;
00072 boost::shared_ptr<std::map<std::string, std::string> > __connection_header;
00073 };
00074 typedef ::pano_ros::Pano_<std::allocator<void> > Pano;
00075
00076 typedef boost::shared_ptr< ::pano_ros::Pano> PanoPtr;
00077 typedef boost::shared_ptr< ::pano_ros::Pano const> PanoConstPtr;
00078
00079
00080 template<typename ContainerAllocator>
00081 std::ostream& operator<<(std::ostream& s, const ::pano_ros::Pano_<ContainerAllocator> & v)
00082 {
00083 ros::message_operations::Printer< ::pano_ros::Pano_<ContainerAllocator> >::stream(s, "", v);
00084 return s;}
00085
00086 }
00087
00088 namespace ros
00089 {
00090 namespace message_traits
00091 {
00092 template<class ContainerAllocator> struct IsMessage< ::pano_ros::Pano_<ContainerAllocator> > : public TrueType {};
00093 template<class ContainerAllocator> struct IsMessage< ::pano_ros::Pano_<ContainerAllocator> const> : public TrueType {};
00094 template<class ContainerAllocator>
00095 struct MD5Sum< ::pano_ros::Pano_<ContainerAllocator> > {
00096 static const char* value()
00097 {
00098 return "aedf66295b374a7249a786af27aecc87";
00099 }
00100
00101 static const char* value(const ::pano_ros::Pano_<ContainerAllocator> &) { return value(); }
00102 static const uint64_t static_value1 = 0xaedf66295b374a72ULL;
00103 static const uint64_t static_value2 = 0x49a786af27aecc87ULL;
00104 };
00105
00106 template<class ContainerAllocator>
00107 struct DataType< ::pano_ros::Pano_<ContainerAllocator> > {
00108 static const char* value()
00109 {
00110 return "pano_ros/Pano";
00111 }
00112
00113 static const char* value(const ::pano_ros::Pano_<ContainerAllocator> &) { return value(); }
00114 };
00115
00116 template<class ContainerAllocator>
00117 struct Definition< ::pano_ros::Pano_<ContainerAllocator> > {
00118 static const char* value()
00119 {
00120 return "#Pano message\n\
00121 Header header\n\
00122 string pano_id\n\
00123 float64 latitude\n\
00124 float64 longitude\n\
00125 float64 heading #in degrees, compass heading\n\
00126 string geo_tag\n\
00127 sensor_msgs/Image image\n\
00128 ================================================================================\n\
00129 MSG: std_msgs/Header\n\
00130 # Standard metadata for higher-level stamped data types.\n\
00131 # This is generally used to communicate timestamped data \n\
00132 # in a particular coordinate frame.\n\
00133 # \n\
00134 # sequence ID: consecutively increasing ID \n\
00135 uint32 seq\n\
00136 #Two-integer timestamp that is expressed as:\n\
00137 # * stamp.secs: seconds (stamp_secs) since epoch\n\
00138 # * stamp.nsecs: nanoseconds since stamp_secs\n\
00139 # time-handling sugar is provided by the client library\n\
00140 time stamp\n\
00141 #Frame this data is associated with\n\
00142 # 0: no frame\n\
00143 # 1: global frame\n\
00144 string frame_id\n\
00145 \n\
00146 ================================================================================\n\
00147 MSG: sensor_msgs/Image\n\
00148 # This message contains an uncompressed image\n\
00149 # (0, 0) is at top-left corner of image\n\
00150 #\n\
00151 \n\
00152 Header header # Header timestamp should be acquisition time of image\n\
00153 # Header frame_id should be optical frame of camera\n\
00154 # origin of frame should be optical center of cameara\n\
00155 # +x should point to the right in the image\n\
00156 # +y should point down in the image\n\
00157 # +z should point into to plane of the image\n\
00158 # If the frame_id here and the frame_id of the CameraInfo\n\
00159 # message associated with the image conflict\n\
00160 # the behavior is undefined\n\
00161 \n\
00162 uint32 height # image height, that is, number of rows\n\
00163 uint32 width # image width, that is, number of columns\n\
00164 \n\
00165 # The legal values for encoding are in file src/image_encodings.cpp\n\
00166 # If you want to standardize a new string format, join\n\
00167 # ros-users@lists.sourceforge.net and send an email proposing a new encoding.\n\
00168 \n\
00169 string encoding # Encoding of pixels -- channel meaning, ordering, size\n\
00170 # taken from the list of strings in include/sensor_msgs/image_encodings.h\n\
00171 \n\
00172 uint8 is_bigendian # is this data bigendian?\n\
00173 uint32 step # Full row length in bytes\n\
00174 uint8[] data # actual matrix data, size is (step * rows)\n\
00175 \n\
00176 ";
00177 }
00178
00179 static const char* value(const ::pano_ros::Pano_<ContainerAllocator> &) { return value(); }
00180 };
00181
00182 template<class ContainerAllocator> struct HasHeader< ::pano_ros::Pano_<ContainerAllocator> > : public TrueType {};
00183 template<class ContainerAllocator> struct HasHeader< const ::pano_ros::Pano_<ContainerAllocator> > : public TrueType {};
00184 }
00185 }
00186
00187 namespace ros
00188 {
00189 namespace serialization
00190 {
00191
00192 template<class ContainerAllocator> struct Serializer< ::pano_ros::Pano_<ContainerAllocator> >
00193 {
00194 template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m)
00195 {
00196 stream.next(m.header);
00197 stream.next(m.pano_id);
00198 stream.next(m.latitude);
00199 stream.next(m.longitude);
00200 stream.next(m.heading);
00201 stream.next(m.geo_tag);
00202 stream.next(m.image);
00203 }
00204
00205 ROS_DECLARE_ALLINONE_SERIALIZER;
00206 };
00207 }
00208 }
00209
00210 namespace ros
00211 {
00212 namespace message_operations
00213 {
00214
00215 template<class ContainerAllocator>
00216 struct Printer< ::pano_ros::Pano_<ContainerAllocator> >
00217 {
00218 template<typename Stream> static void stream(Stream& s, const std::string& indent, const ::pano_ros::Pano_<ContainerAllocator> & v)
00219 {
00220 s << indent << "header: ";
00221 s << std::endl;
00222 Printer< ::std_msgs::Header_<ContainerAllocator> >::stream(s, indent + " ", v.header);
00223 s << indent << "pano_id: ";
00224 Printer<std::basic_string<char, std::char_traits<char>, typename ContainerAllocator::template rebind<char>::other > >::stream(s, indent + " ", v.pano_id);
00225 s << indent << "latitude: ";
00226 Printer<double>::stream(s, indent + " ", v.latitude);
00227 s << indent << "longitude: ";
00228 Printer<double>::stream(s, indent + " ", v.longitude);
00229 s << indent << "heading: ";
00230 Printer<double>::stream(s, indent + " ", v.heading);
00231 s << indent << "geo_tag: ";
00232 Printer<std::basic_string<char, std::char_traits<char>, typename ContainerAllocator::template rebind<char>::other > >::stream(s, indent + " ", v.geo_tag);
00233 s << indent << "image: ";
00234 s << std::endl;
00235 Printer< ::sensor_msgs::Image_<ContainerAllocator> >::stream(s, indent + " ", v.image);
00236 }
00237 };
00238
00239
00240 }
00241 }
00242
00243 #endif // PANO_ROS_MESSAGE_PANO_H
00244