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