LoadMap.h
Go to the documentation of this file.
00001 /* Auto-generated by genmsg_cpp for file /home/rosbuild/hudson/workspace/doc-fuerte-ethzasl_icp_mapping/doc_stacks/2014-01-02_11-13-24.194570/ethzasl_icp_mapping/ethzasl_icp_mapper/srv/LoadMap.srv */
00002 #ifndef ETHZASL_ICP_MAPPER_SERVICE_LOADMAP_H
00003 #define ETHZASL_ICP_MAPPER_SERVICE_LOADMAP_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 "ros/service_traits.h"
00018 
00019 #include "std_msgs/String.h"
00020 
00021 
00022 
00023 namespace ethzasl_icp_mapper
00024 {
00025 template <class ContainerAllocator>
00026 struct LoadMapRequest_ {
00027   typedef LoadMapRequest_<ContainerAllocator> Type;
00028 
00029   LoadMapRequest_()
00030   : filename()
00031   {
00032   }
00033 
00034   LoadMapRequest_(const ContainerAllocator& _alloc)
00035   : filename(_alloc)
00036   {
00037   }
00038 
00039   typedef  ::std_msgs::String_<ContainerAllocator>  _filename_type;
00040    ::std_msgs::String_<ContainerAllocator>  filename;
00041 
00042 
00043   typedef boost::shared_ptr< ::ethzasl_icp_mapper::LoadMapRequest_<ContainerAllocator> > Ptr;
00044   typedef boost::shared_ptr< ::ethzasl_icp_mapper::LoadMapRequest_<ContainerAllocator>  const> ConstPtr;
00045   boost::shared_ptr<std::map<std::string, std::string> > __connection_header;
00046 }; // struct LoadMapRequest
00047 typedef  ::ethzasl_icp_mapper::LoadMapRequest_<std::allocator<void> > LoadMapRequest;
00048 
00049 typedef boost::shared_ptr< ::ethzasl_icp_mapper::LoadMapRequest> LoadMapRequestPtr;
00050 typedef boost::shared_ptr< ::ethzasl_icp_mapper::LoadMapRequest const> LoadMapRequestConstPtr;
00051 
00052 
00053 template <class ContainerAllocator>
00054 struct LoadMapResponse_ {
00055   typedef LoadMapResponse_<ContainerAllocator> Type;
00056 
00057   LoadMapResponse_()
00058   {
00059   }
00060 
00061   LoadMapResponse_(const ContainerAllocator& _alloc)
00062   {
00063   }
00064 
00065 
00066   typedef boost::shared_ptr< ::ethzasl_icp_mapper::LoadMapResponse_<ContainerAllocator> > Ptr;
00067   typedef boost::shared_ptr< ::ethzasl_icp_mapper::LoadMapResponse_<ContainerAllocator>  const> ConstPtr;
00068   boost::shared_ptr<std::map<std::string, std::string> > __connection_header;
00069 }; // struct LoadMapResponse
00070 typedef  ::ethzasl_icp_mapper::LoadMapResponse_<std::allocator<void> > LoadMapResponse;
00071 
00072 typedef boost::shared_ptr< ::ethzasl_icp_mapper::LoadMapResponse> LoadMapResponsePtr;
00073 typedef boost::shared_ptr< ::ethzasl_icp_mapper::LoadMapResponse const> LoadMapResponseConstPtr;
00074 
00075 struct LoadMap
00076 {
00077 
00078 typedef LoadMapRequest Request;
00079 typedef LoadMapResponse Response;
00080 Request request;
00081 Response response;
00082 
00083 typedef Request RequestType;
00084 typedef Response ResponseType;
00085 }; // struct LoadMap
00086 } // namespace ethzasl_icp_mapper
00087 
00088 namespace ros
00089 {
00090 namespace message_traits
00091 {
00092 template<class ContainerAllocator> struct IsMessage< ::ethzasl_icp_mapper::LoadMapRequest_<ContainerAllocator> > : public TrueType {};
00093 template<class ContainerAllocator> struct IsMessage< ::ethzasl_icp_mapper::LoadMapRequest_<ContainerAllocator>  const> : public TrueType {};
00094 template<class ContainerAllocator>
00095 struct MD5Sum< ::ethzasl_icp_mapper::LoadMapRequest_<ContainerAllocator> > {
00096   static const char* value() 
00097   {
00098     return "716e25f9d9dc76ceba197f93cbf05dc7";
00099   }
00100 
00101   static const char* value(const  ::ethzasl_icp_mapper::LoadMapRequest_<ContainerAllocator> &) { return value(); } 
00102   static const uint64_t static_value1 = 0x716e25f9d9dc76ceULL;
00103   static const uint64_t static_value2 = 0xba197f93cbf05dc7ULL;
00104 };
00105 
00106 template<class ContainerAllocator>
00107 struct DataType< ::ethzasl_icp_mapper::LoadMapRequest_<ContainerAllocator> > {
00108   static const char* value() 
00109   {
00110     return "ethzasl_icp_mapper/LoadMapRequest";
00111   }
00112 
00113   static const char* value(const  ::ethzasl_icp_mapper::LoadMapRequest_<ContainerAllocator> &) { return value(); } 
00114 };
00115 
00116 template<class ContainerAllocator>
00117 struct Definition< ::ethzasl_icp_mapper::LoadMapRequest_<ContainerAllocator> > {
00118   static const char* value() 
00119   {
00120     return "std_msgs/String filename\n\
00121 \n\
00122 ================================================================================\n\
00123 MSG: std_msgs/String\n\
00124 string data\n\
00125 \n\
00126 ";
00127   }
00128 
00129   static const char* value(const  ::ethzasl_icp_mapper::LoadMapRequest_<ContainerAllocator> &) { return value(); } 
00130 };
00131 
00132 } // namespace message_traits
00133 } // namespace ros
00134 
00135 
00136 namespace ros
00137 {
00138 namespace message_traits
00139 {
00140 template<class ContainerAllocator> struct IsMessage< ::ethzasl_icp_mapper::LoadMapResponse_<ContainerAllocator> > : public TrueType {};
00141 template<class ContainerAllocator> struct IsMessage< ::ethzasl_icp_mapper::LoadMapResponse_<ContainerAllocator>  const> : public TrueType {};
00142 template<class ContainerAllocator>
00143 struct MD5Sum< ::ethzasl_icp_mapper::LoadMapResponse_<ContainerAllocator> > {
00144   static const char* value() 
00145   {
00146     return "d41d8cd98f00b204e9800998ecf8427e";
00147   }
00148 
00149   static const char* value(const  ::ethzasl_icp_mapper::LoadMapResponse_<ContainerAllocator> &) { return value(); } 
00150   static const uint64_t static_value1 = 0xd41d8cd98f00b204ULL;
00151   static const uint64_t static_value2 = 0xe9800998ecf8427eULL;
00152 };
00153 
00154 template<class ContainerAllocator>
00155 struct DataType< ::ethzasl_icp_mapper::LoadMapResponse_<ContainerAllocator> > {
00156   static const char* value() 
00157   {
00158     return "ethzasl_icp_mapper/LoadMapResponse";
00159   }
00160 
00161   static const char* value(const  ::ethzasl_icp_mapper::LoadMapResponse_<ContainerAllocator> &) { return value(); } 
00162 };
00163 
00164 template<class ContainerAllocator>
00165 struct Definition< ::ethzasl_icp_mapper::LoadMapResponse_<ContainerAllocator> > {
00166   static const char* value() 
00167   {
00168     return "\n\
00169 \n\
00170 ";
00171   }
00172 
00173   static const char* value(const  ::ethzasl_icp_mapper::LoadMapResponse_<ContainerAllocator> &) { return value(); } 
00174 };
00175 
00176 template<class ContainerAllocator> struct IsFixedSize< ::ethzasl_icp_mapper::LoadMapResponse_<ContainerAllocator> > : public TrueType {};
00177 } // namespace message_traits
00178 } // namespace ros
00179 
00180 namespace ros
00181 {
00182 namespace serialization
00183 {
00184 
00185 template<class ContainerAllocator> struct Serializer< ::ethzasl_icp_mapper::LoadMapRequest_<ContainerAllocator> >
00186 {
00187   template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m)
00188   {
00189     stream.next(m.filename);
00190   }
00191 
00192   ROS_DECLARE_ALLINONE_SERIALIZER;
00193 }; // struct LoadMapRequest_
00194 } // namespace serialization
00195 } // namespace ros
00196 
00197 
00198 namespace ros
00199 {
00200 namespace serialization
00201 {
00202 
00203 template<class ContainerAllocator> struct Serializer< ::ethzasl_icp_mapper::LoadMapResponse_<ContainerAllocator> >
00204 {
00205   template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m)
00206   {
00207   }
00208 
00209   ROS_DECLARE_ALLINONE_SERIALIZER;
00210 }; // struct LoadMapResponse_
00211 } // namespace serialization
00212 } // namespace ros
00213 
00214 namespace ros
00215 {
00216 namespace service_traits
00217 {
00218 template<>
00219 struct MD5Sum<ethzasl_icp_mapper::LoadMap> {
00220   static const char* value() 
00221   {
00222     return "716e25f9d9dc76ceba197f93cbf05dc7";
00223   }
00224 
00225   static const char* value(const ethzasl_icp_mapper::LoadMap&) { return value(); } 
00226 };
00227 
00228 template<>
00229 struct DataType<ethzasl_icp_mapper::LoadMap> {
00230   static const char* value() 
00231   {
00232     return "ethzasl_icp_mapper/LoadMap";
00233   }
00234 
00235   static const char* value(const ethzasl_icp_mapper::LoadMap&) { return value(); } 
00236 };
00237 
00238 template<class ContainerAllocator>
00239 struct MD5Sum<ethzasl_icp_mapper::LoadMapRequest_<ContainerAllocator> > {
00240   static const char* value() 
00241   {
00242     return "716e25f9d9dc76ceba197f93cbf05dc7";
00243   }
00244 
00245   static const char* value(const ethzasl_icp_mapper::LoadMapRequest_<ContainerAllocator> &) { return value(); } 
00246 };
00247 
00248 template<class ContainerAllocator>
00249 struct DataType<ethzasl_icp_mapper::LoadMapRequest_<ContainerAllocator> > {
00250   static const char* value() 
00251   {
00252     return "ethzasl_icp_mapper/LoadMap";
00253   }
00254 
00255   static const char* value(const ethzasl_icp_mapper::LoadMapRequest_<ContainerAllocator> &) { return value(); } 
00256 };
00257 
00258 template<class ContainerAllocator>
00259 struct MD5Sum<ethzasl_icp_mapper::LoadMapResponse_<ContainerAllocator> > {
00260   static const char* value() 
00261   {
00262     return "716e25f9d9dc76ceba197f93cbf05dc7";
00263   }
00264 
00265   static const char* value(const ethzasl_icp_mapper::LoadMapResponse_<ContainerAllocator> &) { return value(); } 
00266 };
00267 
00268 template<class ContainerAllocator>
00269 struct DataType<ethzasl_icp_mapper::LoadMapResponse_<ContainerAllocator> > {
00270   static const char* value() 
00271   {
00272     return "ethzasl_icp_mapper/LoadMap";
00273   }
00274 
00275   static const char* value(const ethzasl_icp_mapper::LoadMapResponse_<ContainerAllocator> &) { return value(); } 
00276 };
00277 
00278 } // namespace service_traits
00279 } // namespace ros
00280 
00281 #endif // ETHZASL_ICP_MAPPER_SERVICE_LOADMAP_H
00282 


ethzasl_icp_mapper
Author(s): François Pomerleau and Stéphane Magnenat
autogenerated on Thu Jan 2 2014 11:16:21