$search
00001 /* Auto-generated by genmsg_cpp for file /home/rosbuild/hudson/workspace/doc-electric-cob_common/doc_stacks/2013-03-01_14-38-37.978792/cob_common/cob_srvs/srv/SetDefaultVel.srv */ 00002 #ifndef COB_SRVS_SERVICE_SETDEFAULTVEL_H 00003 #define COB_SRVS_SERVICE_SETDEFAULTVEL_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 00020 00021 #include "std_msgs/Bool.h" 00022 #include "std_msgs/String.h" 00023 00024 namespace cob_srvs 00025 { 00026 template <class ContainerAllocator> 00027 struct SetDefaultVelRequest_ { 00028 typedef SetDefaultVelRequest_<ContainerAllocator> Type; 00029 00030 SetDefaultVelRequest_() 00031 : default_vel(0.0) 00032 { 00033 } 00034 00035 SetDefaultVelRequest_(const ContainerAllocator& _alloc) 00036 : default_vel(0.0) 00037 { 00038 } 00039 00040 typedef float _default_vel_type; 00041 float default_vel; 00042 00043 00044 private: 00045 static const char* __s_getDataType_() { return "cob_srvs/SetDefaultVelRequest"; } 00046 public: 00047 ROS_DEPRECATED static const std::string __s_getDataType() { return __s_getDataType_(); } 00048 00049 ROS_DEPRECATED const std::string __getDataType() const { return __s_getDataType_(); } 00050 00051 private: 00052 static const char* __s_getMD5Sum_() { return "06408962e6bcadda2e07880ad9dedbec"; } 00053 public: 00054 ROS_DEPRECATED static const std::string __s_getMD5Sum() { return __s_getMD5Sum_(); } 00055 00056 ROS_DEPRECATED const std::string __getMD5Sum() const { return __s_getMD5Sum_(); } 00057 00058 private: 00059 static const char* __s_getServerMD5Sum_() { return "a7159156625f755343070ad39bfaf3a3"; } 00060 public: 00061 ROS_DEPRECATED static const std::string __s_getServerMD5Sum() { return __s_getServerMD5Sum_(); } 00062 00063 ROS_DEPRECATED const std::string __getServerMD5Sum() const { return __s_getServerMD5Sum_(); } 00064 00065 private: 00066 static const char* __s_getMessageDefinition_() { return "float32 default_vel\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, default_vel); 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, default_vel); 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(default_vel); 00092 return size; 00093 } 00094 00095 typedef boost::shared_ptr< ::cob_srvs::SetDefaultVelRequest_<ContainerAllocator> > Ptr; 00096 typedef boost::shared_ptr< ::cob_srvs::SetDefaultVelRequest_<ContainerAllocator> const> ConstPtr; 00097 boost::shared_ptr<std::map<std::string, std::string> > __connection_header; 00098 }; // struct SetDefaultVelRequest 00099 typedef ::cob_srvs::SetDefaultVelRequest_<std::allocator<void> > SetDefaultVelRequest; 00100 00101 typedef boost::shared_ptr< ::cob_srvs::SetDefaultVelRequest> SetDefaultVelRequestPtr; 00102 typedef boost::shared_ptr< ::cob_srvs::SetDefaultVelRequest const> SetDefaultVelRequestConstPtr; 00103 00104 00105 template <class ContainerAllocator> 00106 struct SetDefaultVelResponse_ { 00107 typedef SetDefaultVelResponse_<ContainerAllocator> Type; 00108 00109 SetDefaultVelResponse_() 00110 : success() 00111 , error_message() 00112 { 00113 } 00114 00115 SetDefaultVelResponse_(const ContainerAllocator& _alloc) 00116 : success(_alloc) 00117 , error_message(_alloc) 00118 { 00119 } 00120 00121 typedef ::std_msgs::Bool_<ContainerAllocator> _success_type; 00122 ::std_msgs::Bool_<ContainerAllocator> success; 00123 00124 typedef ::std_msgs::String_<ContainerAllocator> _error_message_type; 00125 ::std_msgs::String_<ContainerAllocator> error_message; 00126 00127 00128 private: 00129 static const char* __s_getDataType_() { return "cob_srvs/SetDefaultVelResponse"; } 00130 public: 00131 ROS_DEPRECATED static const std::string __s_getDataType() { return __s_getDataType_(); } 00132 00133 ROS_DEPRECATED const std::string __getDataType() const { return __s_getDataType_(); } 00134 00135 private: 00136 static const char* __s_getMD5Sum_() { return "bdad515e8f4c013bd650d3407753d2b8"; } 00137 public: 00138 ROS_DEPRECATED static const std::string __s_getMD5Sum() { return __s_getMD5Sum_(); } 00139 00140 ROS_DEPRECATED const std::string __getMD5Sum() const { return __s_getMD5Sum_(); } 00141 00142 private: 00143 static const char* __s_getServerMD5Sum_() { return "a7159156625f755343070ad39bfaf3a3"; } 00144 public: 00145 ROS_DEPRECATED static const std::string __s_getServerMD5Sum() { return __s_getServerMD5Sum_(); } 00146 00147 ROS_DEPRECATED const std::string __getServerMD5Sum() const { return __s_getServerMD5Sum_(); } 00148 00149 private: 00150 static const char* __s_getMessageDefinition_() { return "std_msgs/Bool success\n\ 00151 std_msgs/String error_message\n\ 00152 \n\ 00153 \n\ 00154 ================================================================================\n\ 00155 MSG: std_msgs/Bool\n\ 00156 bool data\n\ 00157 ================================================================================\n\ 00158 MSG: std_msgs/String\n\ 00159 string data\n\ 00160 \n\ 00161 "; } 00162 public: 00163 ROS_DEPRECATED static const std::string __s_getMessageDefinition() { return __s_getMessageDefinition_(); } 00164 00165 ROS_DEPRECATED const std::string __getMessageDefinition() const { return __s_getMessageDefinition_(); } 00166 00167 ROS_DEPRECATED virtual uint8_t *serialize(uint8_t *write_ptr, uint32_t seq) const 00168 { 00169 ros::serialization::OStream stream(write_ptr, 1000000000); 00170 ros::serialization::serialize(stream, success); 00171 ros::serialization::serialize(stream, error_message); 00172 return stream.getData(); 00173 } 00174 00175 ROS_DEPRECATED virtual uint8_t *deserialize(uint8_t *read_ptr) 00176 { 00177 ros::serialization::IStream stream(read_ptr, 1000000000); 00178 ros::serialization::deserialize(stream, success); 00179 ros::serialization::deserialize(stream, error_message); 00180 return stream.getData(); 00181 } 00182 00183 ROS_DEPRECATED virtual uint32_t serializationLength() const 00184 { 00185 uint32_t size = 0; 00186 size += ros::serialization::serializationLength(success); 00187 size += ros::serialization::serializationLength(error_message); 00188 return size; 00189 } 00190 00191 typedef boost::shared_ptr< ::cob_srvs::SetDefaultVelResponse_<ContainerAllocator> > Ptr; 00192 typedef boost::shared_ptr< ::cob_srvs::SetDefaultVelResponse_<ContainerAllocator> const> ConstPtr; 00193 boost::shared_ptr<std::map<std::string, std::string> > __connection_header; 00194 }; // struct SetDefaultVelResponse 00195 typedef ::cob_srvs::SetDefaultVelResponse_<std::allocator<void> > SetDefaultVelResponse; 00196 00197 typedef boost::shared_ptr< ::cob_srvs::SetDefaultVelResponse> SetDefaultVelResponsePtr; 00198 typedef boost::shared_ptr< ::cob_srvs::SetDefaultVelResponse const> SetDefaultVelResponseConstPtr; 00199 00200 struct SetDefaultVel 00201 { 00202 00203 typedef SetDefaultVelRequest Request; 00204 typedef SetDefaultVelResponse Response; 00205 Request request; 00206 Response response; 00207 00208 typedef Request RequestType; 00209 typedef Response ResponseType; 00210 }; // struct SetDefaultVel 00211 } // namespace cob_srvs 00212 00213 namespace ros 00214 { 00215 namespace message_traits 00216 { 00217 template<class ContainerAllocator> struct IsMessage< ::cob_srvs::SetDefaultVelRequest_<ContainerAllocator> > : public TrueType {}; 00218 template<class ContainerAllocator> struct IsMessage< ::cob_srvs::SetDefaultVelRequest_<ContainerAllocator> const> : public TrueType {}; 00219 template<class ContainerAllocator> 00220 struct MD5Sum< ::cob_srvs::SetDefaultVelRequest_<ContainerAllocator> > { 00221 static const char* value() 00222 { 00223 return "06408962e6bcadda2e07880ad9dedbec"; 00224 } 00225 00226 static const char* value(const ::cob_srvs::SetDefaultVelRequest_<ContainerAllocator> &) { return value(); } 00227 static const uint64_t static_value1 = 0x06408962e6bcaddaULL; 00228 static const uint64_t static_value2 = 0x2e07880ad9dedbecULL; 00229 }; 00230 00231 template<class ContainerAllocator> 00232 struct DataType< ::cob_srvs::SetDefaultVelRequest_<ContainerAllocator> > { 00233 static const char* value() 00234 { 00235 return "cob_srvs/SetDefaultVelRequest"; 00236 } 00237 00238 static const char* value(const ::cob_srvs::SetDefaultVelRequest_<ContainerAllocator> &) { return value(); } 00239 }; 00240 00241 template<class ContainerAllocator> 00242 struct Definition< ::cob_srvs::SetDefaultVelRequest_<ContainerAllocator> > { 00243 static const char* value() 00244 { 00245 return "float32 default_vel\n\ 00246 \n\ 00247 "; 00248 } 00249 00250 static const char* value(const ::cob_srvs::SetDefaultVelRequest_<ContainerAllocator> &) { return value(); } 00251 }; 00252 00253 template<class ContainerAllocator> struct IsFixedSize< ::cob_srvs::SetDefaultVelRequest_<ContainerAllocator> > : public TrueType {}; 00254 } // namespace message_traits 00255 } // namespace ros 00256 00257 00258 namespace ros 00259 { 00260 namespace message_traits 00261 { 00262 template<class ContainerAllocator> struct IsMessage< ::cob_srvs::SetDefaultVelResponse_<ContainerAllocator> > : public TrueType {}; 00263 template<class ContainerAllocator> struct IsMessage< ::cob_srvs::SetDefaultVelResponse_<ContainerAllocator> const> : public TrueType {}; 00264 template<class ContainerAllocator> 00265 struct MD5Sum< ::cob_srvs::SetDefaultVelResponse_<ContainerAllocator> > { 00266 static const char* value() 00267 { 00268 return "bdad515e8f4c013bd650d3407753d2b8"; 00269 } 00270 00271 static const char* value(const ::cob_srvs::SetDefaultVelResponse_<ContainerAllocator> &) { return value(); } 00272 static const uint64_t static_value1 = 0xbdad515e8f4c013bULL; 00273 static const uint64_t static_value2 = 0xd650d3407753d2b8ULL; 00274 }; 00275 00276 template<class ContainerAllocator> 00277 struct DataType< ::cob_srvs::SetDefaultVelResponse_<ContainerAllocator> > { 00278 static const char* value() 00279 { 00280 return "cob_srvs/SetDefaultVelResponse"; 00281 } 00282 00283 static const char* value(const ::cob_srvs::SetDefaultVelResponse_<ContainerAllocator> &) { return value(); } 00284 }; 00285 00286 template<class ContainerAllocator> 00287 struct Definition< ::cob_srvs::SetDefaultVelResponse_<ContainerAllocator> > { 00288 static const char* value() 00289 { 00290 return "std_msgs/Bool success\n\ 00291 std_msgs/String error_message\n\ 00292 \n\ 00293 \n\ 00294 ================================================================================\n\ 00295 MSG: std_msgs/Bool\n\ 00296 bool data\n\ 00297 ================================================================================\n\ 00298 MSG: std_msgs/String\n\ 00299 string data\n\ 00300 \n\ 00301 "; 00302 } 00303 00304 static const char* value(const ::cob_srvs::SetDefaultVelResponse_<ContainerAllocator> &) { return value(); } 00305 }; 00306 00307 } // namespace message_traits 00308 } // namespace ros 00309 00310 namespace ros 00311 { 00312 namespace serialization 00313 { 00314 00315 template<class ContainerAllocator> struct Serializer< ::cob_srvs::SetDefaultVelRequest_<ContainerAllocator> > 00316 { 00317 template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m) 00318 { 00319 stream.next(m.default_vel); 00320 } 00321 00322 ROS_DECLARE_ALLINONE_SERIALIZER; 00323 }; // struct SetDefaultVelRequest_ 00324 } // namespace serialization 00325 } // namespace ros 00326 00327 00328 namespace ros 00329 { 00330 namespace serialization 00331 { 00332 00333 template<class ContainerAllocator> struct Serializer< ::cob_srvs::SetDefaultVelResponse_<ContainerAllocator> > 00334 { 00335 template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m) 00336 { 00337 stream.next(m.success); 00338 stream.next(m.error_message); 00339 } 00340 00341 ROS_DECLARE_ALLINONE_SERIALIZER; 00342 }; // struct SetDefaultVelResponse_ 00343 } // namespace serialization 00344 } // namespace ros 00345 00346 namespace ros 00347 { 00348 namespace service_traits 00349 { 00350 template<> 00351 struct MD5Sum<cob_srvs::SetDefaultVel> { 00352 static const char* value() 00353 { 00354 return "a7159156625f755343070ad39bfaf3a3"; 00355 } 00356 00357 static const char* value(const cob_srvs::SetDefaultVel&) { return value(); } 00358 }; 00359 00360 template<> 00361 struct DataType<cob_srvs::SetDefaultVel> { 00362 static const char* value() 00363 { 00364 return "cob_srvs/SetDefaultVel"; 00365 } 00366 00367 static const char* value(const cob_srvs::SetDefaultVel&) { return value(); } 00368 }; 00369 00370 template<class ContainerAllocator> 00371 struct MD5Sum<cob_srvs::SetDefaultVelRequest_<ContainerAllocator> > { 00372 static const char* value() 00373 { 00374 return "a7159156625f755343070ad39bfaf3a3"; 00375 } 00376 00377 static const char* value(const cob_srvs::SetDefaultVelRequest_<ContainerAllocator> &) { return value(); } 00378 }; 00379 00380 template<class ContainerAllocator> 00381 struct DataType<cob_srvs::SetDefaultVelRequest_<ContainerAllocator> > { 00382 static const char* value() 00383 { 00384 return "cob_srvs/SetDefaultVel"; 00385 } 00386 00387 static const char* value(const cob_srvs::SetDefaultVelRequest_<ContainerAllocator> &) { return value(); } 00388 }; 00389 00390 template<class ContainerAllocator> 00391 struct MD5Sum<cob_srvs::SetDefaultVelResponse_<ContainerAllocator> > { 00392 static const char* value() 00393 { 00394 return "a7159156625f755343070ad39bfaf3a3"; 00395 } 00396 00397 static const char* value(const cob_srvs::SetDefaultVelResponse_<ContainerAllocator> &) { return value(); } 00398 }; 00399 00400 template<class ContainerAllocator> 00401 struct DataType<cob_srvs::SetDefaultVelResponse_<ContainerAllocator> > { 00402 static const char* value() 00403 { 00404 return "cob_srvs/SetDefaultVel"; 00405 } 00406 00407 static const char* value(const cob_srvs::SetDefaultVelResponse_<ContainerAllocator> &) { return value(); } 00408 }; 00409 00410 } // namespace service_traits 00411 } // namespace ros 00412 00413 #endif // COB_SRVS_SERVICE_SETDEFAULTVEL_H 00414