00001
00002 #ifndef TOPOLOGICAL_NAV_MSGS_SERVICE_SWITCHGRID_H
00003 #define TOPOLOGICAL_NAV_MSGS_SERVICE_SWITCHGRID_H
00004 #include <string>
00005 #include <vector>
00006 #include <ostream>
00007 #include "ros/serialization.h"
00008 #include "ros/builtin_message_traits.h"
00009 #include "ros/message_operations.h"
00010 #include "ros/message.h"
00011 #include "ros/time.h"
00012
00013 #include "ros/service_traits.h"
00014
00015
00016
00017
00018 namespace topological_nav_msgs
00019 {
00020 template <class ContainerAllocator>
00021 struct SwitchGridRequest_ : public ros::Message
00022 {
00023 typedef SwitchGridRequest_<ContainerAllocator> Type;
00024
00025 SwitchGridRequest_()
00026 : grid(0)
00027 {
00028 }
00029
00030 SwitchGridRequest_(const ContainerAllocator& _alloc)
00031 : grid(0)
00032 {
00033 }
00034
00035 typedef uint32_t _grid_type;
00036 uint32_t grid;
00037
00038
00039 private:
00040 static const char* __s_getDataType_() { return "topological_nav_msgs/SwitchGridRequest"; }
00041 public:
00042 ROS_DEPRECATED static const std::string __s_getDataType() { return __s_getDataType_(); }
00043
00044 ROS_DEPRECATED const std::string __getDataType() const { return __s_getDataType_(); }
00045
00046 private:
00047 static const char* __s_getMD5Sum_() { return "aba54f31d03f4e2cc9663123e4cdacca"; }
00048 public:
00049 ROS_DEPRECATED static const std::string __s_getMD5Sum() { return __s_getMD5Sum_(); }
00050
00051 ROS_DEPRECATED const std::string __getMD5Sum() const { return __s_getMD5Sum_(); }
00052
00053 private:
00054 static const char* __s_getServerMD5Sum_() { return "aba54f31d03f4e2cc9663123e4cdacca"; }
00055 public:
00056 ROS_DEPRECATED static const std::string __s_getServerMD5Sum() { return __s_getServerMD5Sum_(); }
00057
00058 ROS_DEPRECATED const std::string __getServerMD5Sum() const { return __s_getServerMD5Sum_(); }
00059
00060 private:
00061 static const char* __s_getMessageDefinition_() { return "\n\
00062 \n\
00063 \n\
00064 uint32 grid\n\
00065 \n\
00066 "; }
00067 public:
00068 ROS_DEPRECATED static const std::string __s_getMessageDefinition() { return __s_getMessageDefinition_(); }
00069
00070 ROS_DEPRECATED const std::string __getMessageDefinition() const { return __s_getMessageDefinition_(); }
00071
00072 ROS_DEPRECATED virtual uint8_t *serialize(uint8_t *write_ptr, uint32_t seq) const
00073 {
00074 ros::serialization::OStream stream(write_ptr, 1000000000);
00075 ros::serialization::serialize(stream, grid);
00076 return stream.getData();
00077 }
00078
00079 ROS_DEPRECATED virtual uint8_t *deserialize(uint8_t *read_ptr)
00080 {
00081 ros::serialization::IStream stream(read_ptr, 1000000000);
00082 ros::serialization::deserialize(stream, grid);
00083 return stream.getData();
00084 }
00085
00086 ROS_DEPRECATED virtual uint32_t serializationLength() const
00087 {
00088 uint32_t size = 0;
00089 size += ros::serialization::serializationLength(grid);
00090 return size;
00091 }
00092
00093 typedef boost::shared_ptr< ::topological_nav_msgs::SwitchGridRequest_<ContainerAllocator> > Ptr;
00094 typedef boost::shared_ptr< ::topological_nav_msgs::SwitchGridRequest_<ContainerAllocator> const> ConstPtr;
00095 };
00096 typedef ::topological_nav_msgs::SwitchGridRequest_<std::allocator<void> > SwitchGridRequest;
00097
00098 typedef boost::shared_ptr< ::topological_nav_msgs::SwitchGridRequest> SwitchGridRequestPtr;
00099 typedef boost::shared_ptr< ::topological_nav_msgs::SwitchGridRequest const> SwitchGridRequestConstPtr;
00100
00101
00102 template <class ContainerAllocator>
00103 struct SwitchGridResponse_ : public ros::Message
00104 {
00105 typedef SwitchGridResponse_<ContainerAllocator> Type;
00106
00107 SwitchGridResponse_()
00108 {
00109 }
00110
00111 SwitchGridResponse_(const ContainerAllocator& _alloc)
00112 {
00113 }
00114
00115
00116 private:
00117 static const char* __s_getDataType_() { return "topological_nav_msgs/SwitchGridResponse"; }
00118 public:
00119 ROS_DEPRECATED static const std::string __s_getDataType() { return __s_getDataType_(); }
00120
00121 ROS_DEPRECATED const std::string __getDataType() const { return __s_getDataType_(); }
00122
00123 private:
00124 static const char* __s_getMD5Sum_() { return "d41d8cd98f00b204e9800998ecf8427e"; }
00125 public:
00126 ROS_DEPRECATED static const std::string __s_getMD5Sum() { return __s_getMD5Sum_(); }
00127
00128 ROS_DEPRECATED const std::string __getMD5Sum() const { return __s_getMD5Sum_(); }
00129
00130 private:
00131 static const char* __s_getServerMD5Sum_() { return "aba54f31d03f4e2cc9663123e4cdacca"; }
00132 public:
00133 ROS_DEPRECATED static const std::string __s_getServerMD5Sum() { return __s_getServerMD5Sum_(); }
00134
00135 ROS_DEPRECATED const std::string __getServerMD5Sum() const { return __s_getServerMD5Sum_(); }
00136
00137 private:
00138 static const char* __s_getMessageDefinition_() { return "\n\
00139 \n\
00140 \n\
00141 \n\
00142 "; }
00143 public:
00144 ROS_DEPRECATED static const std::string __s_getMessageDefinition() { return __s_getMessageDefinition_(); }
00145
00146 ROS_DEPRECATED const std::string __getMessageDefinition() const { return __s_getMessageDefinition_(); }
00147
00148 ROS_DEPRECATED virtual uint8_t *serialize(uint8_t *write_ptr, uint32_t seq) const
00149 {
00150 ros::serialization::OStream stream(write_ptr, 1000000000);
00151 return stream.getData();
00152 }
00153
00154 ROS_DEPRECATED virtual uint8_t *deserialize(uint8_t *read_ptr)
00155 {
00156 ros::serialization::IStream stream(read_ptr, 1000000000);
00157 return stream.getData();
00158 }
00159
00160 ROS_DEPRECATED virtual uint32_t serializationLength() const
00161 {
00162 uint32_t size = 0;
00163 return size;
00164 }
00165
00166 typedef boost::shared_ptr< ::topological_nav_msgs::SwitchGridResponse_<ContainerAllocator> > Ptr;
00167 typedef boost::shared_ptr< ::topological_nav_msgs::SwitchGridResponse_<ContainerAllocator> const> ConstPtr;
00168 };
00169 typedef ::topological_nav_msgs::SwitchGridResponse_<std::allocator<void> > SwitchGridResponse;
00170
00171 typedef boost::shared_ptr< ::topological_nav_msgs::SwitchGridResponse> SwitchGridResponsePtr;
00172 typedef boost::shared_ptr< ::topological_nav_msgs::SwitchGridResponse const> SwitchGridResponseConstPtr;
00173
00174 struct SwitchGrid
00175 {
00176
00177 typedef SwitchGridRequest Request;
00178 typedef SwitchGridResponse Response;
00179 Request request;
00180 Response response;
00181
00182 typedef Request RequestType;
00183 typedef Response ResponseType;
00184 };
00185 }
00186
00187 namespace ros
00188 {
00189 namespace message_traits
00190 {
00191 template<class ContainerAllocator>
00192 struct MD5Sum< ::topological_nav_msgs::SwitchGridRequest_<ContainerAllocator> > {
00193 static const char* value()
00194 {
00195 return "aba54f31d03f4e2cc9663123e4cdacca";
00196 }
00197
00198 static const char* value(const ::topological_nav_msgs::SwitchGridRequest_<ContainerAllocator> &) { return value(); }
00199 static const uint64_t static_value1 = 0xaba54f31d03f4e2cULL;
00200 static const uint64_t static_value2 = 0xc9663123e4cdaccaULL;
00201 };
00202
00203 template<class ContainerAllocator>
00204 struct DataType< ::topological_nav_msgs::SwitchGridRequest_<ContainerAllocator> > {
00205 static const char* value()
00206 {
00207 return "topological_nav_msgs/SwitchGridRequest";
00208 }
00209
00210 static const char* value(const ::topological_nav_msgs::SwitchGridRequest_<ContainerAllocator> &) { return value(); }
00211 };
00212
00213 template<class ContainerAllocator>
00214 struct Definition< ::topological_nav_msgs::SwitchGridRequest_<ContainerAllocator> > {
00215 static const char* value()
00216 {
00217 return "\n\
00218 \n\
00219 \n\
00220 uint32 grid\n\
00221 \n\
00222 ";
00223 }
00224
00225 static const char* value(const ::topological_nav_msgs::SwitchGridRequest_<ContainerAllocator> &) { return value(); }
00226 };
00227
00228 template<class ContainerAllocator> struct IsFixedSize< ::topological_nav_msgs::SwitchGridRequest_<ContainerAllocator> > : public TrueType {};
00229 }
00230 }
00231
00232
00233 namespace ros
00234 {
00235 namespace message_traits
00236 {
00237 template<class ContainerAllocator>
00238 struct MD5Sum< ::topological_nav_msgs::SwitchGridResponse_<ContainerAllocator> > {
00239 static const char* value()
00240 {
00241 return "d41d8cd98f00b204e9800998ecf8427e";
00242 }
00243
00244 static const char* value(const ::topological_nav_msgs::SwitchGridResponse_<ContainerAllocator> &) { return value(); }
00245 static const uint64_t static_value1 = 0xd41d8cd98f00b204ULL;
00246 static const uint64_t static_value2 = 0xe9800998ecf8427eULL;
00247 };
00248
00249 template<class ContainerAllocator>
00250 struct DataType< ::topological_nav_msgs::SwitchGridResponse_<ContainerAllocator> > {
00251 static const char* value()
00252 {
00253 return "topological_nav_msgs/SwitchGridResponse";
00254 }
00255
00256 static const char* value(const ::topological_nav_msgs::SwitchGridResponse_<ContainerAllocator> &) { return value(); }
00257 };
00258
00259 template<class ContainerAllocator>
00260 struct Definition< ::topological_nav_msgs::SwitchGridResponse_<ContainerAllocator> > {
00261 static const char* value()
00262 {
00263 return "\n\
00264 \n\
00265 \n\
00266 \n\
00267 ";
00268 }
00269
00270 static const char* value(const ::topological_nav_msgs::SwitchGridResponse_<ContainerAllocator> &) { return value(); }
00271 };
00272
00273 template<class ContainerAllocator> struct IsFixedSize< ::topological_nav_msgs::SwitchGridResponse_<ContainerAllocator> > : public TrueType {};
00274 }
00275 }
00276
00277 namespace ros
00278 {
00279 namespace serialization
00280 {
00281
00282 template<class ContainerAllocator> struct Serializer< ::topological_nav_msgs::SwitchGridRequest_<ContainerAllocator> >
00283 {
00284 template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m)
00285 {
00286 stream.next(m.grid);
00287 }
00288
00289 ROS_DECLARE_ALLINONE_SERIALIZER;
00290 };
00291 }
00292 }
00293
00294
00295 namespace ros
00296 {
00297 namespace serialization
00298 {
00299
00300 template<class ContainerAllocator> struct Serializer< ::topological_nav_msgs::SwitchGridResponse_<ContainerAllocator> >
00301 {
00302 template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m)
00303 {
00304 }
00305
00306 ROS_DECLARE_ALLINONE_SERIALIZER;
00307 };
00308 }
00309 }
00310
00311 namespace ros
00312 {
00313 namespace service_traits
00314 {
00315 template<>
00316 struct MD5Sum<topological_nav_msgs::SwitchGrid> {
00317 static const char* value()
00318 {
00319 return "aba54f31d03f4e2cc9663123e4cdacca";
00320 }
00321
00322 static const char* value(const topological_nav_msgs::SwitchGrid&) { return value(); }
00323 };
00324
00325 template<>
00326 struct DataType<topological_nav_msgs::SwitchGrid> {
00327 static const char* value()
00328 {
00329 return "topological_nav_msgs/SwitchGrid";
00330 }
00331
00332 static const char* value(const topological_nav_msgs::SwitchGrid&) { return value(); }
00333 };
00334
00335 template<class ContainerAllocator>
00336 struct MD5Sum<topological_nav_msgs::SwitchGridRequest_<ContainerAllocator> > {
00337 static const char* value()
00338 {
00339 return "aba54f31d03f4e2cc9663123e4cdacca";
00340 }
00341
00342 static const char* value(const topological_nav_msgs::SwitchGridRequest_<ContainerAllocator> &) { return value(); }
00343 };
00344
00345 template<class ContainerAllocator>
00346 struct DataType<topological_nav_msgs::SwitchGridRequest_<ContainerAllocator> > {
00347 static const char* value()
00348 {
00349 return "topological_nav_msgs/SwitchGrid";
00350 }
00351
00352 static const char* value(const topological_nav_msgs::SwitchGridRequest_<ContainerAllocator> &) { return value(); }
00353 };
00354
00355 template<class ContainerAllocator>
00356 struct MD5Sum<topological_nav_msgs::SwitchGridResponse_<ContainerAllocator> > {
00357 static const char* value()
00358 {
00359 return "aba54f31d03f4e2cc9663123e4cdacca";
00360 }
00361
00362 static const char* value(const topological_nav_msgs::SwitchGridResponse_<ContainerAllocator> &) { return value(); }
00363 };
00364
00365 template<class ContainerAllocator>
00366 struct DataType<topological_nav_msgs::SwitchGridResponse_<ContainerAllocator> > {
00367 static const char* value()
00368 {
00369 return "topological_nav_msgs/SwitchGrid";
00370 }
00371
00372 static const char* value(const topological_nav_msgs::SwitchGridResponse_<ContainerAllocator> &) { return value(); }
00373 };
00374
00375 }
00376 }
00377
00378 #endif // TOPOLOGICAL_NAV_MSGS_SERVICE_SWITCHGRID_H
00379