00001
00002 #ifndef SRS_ENV_MODEL_PERCP_SERVICE_ESTIMATEBB_H
00003 #define SRS_ENV_MODEL_PERCP_SERVICE_ESTIMATEBB_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/Header.h"
00020
00021
00022 #include "geometry_msgs/Pose.h"
00023 #include "geometry_msgs/Vector3.h"
00024
00025 namespace srs_env_model_percp
00026 {
00027 template <class ContainerAllocator>
00028 struct EstimateBBRequest_ {
00029 typedef EstimateBBRequest_<ContainerAllocator> Type;
00030
00031 EstimateBBRequest_()
00032 : header()
00033 , p1()
00034 , p2()
00035 , mode(0)
00036 {
00037 p1.assign(0);
00038 p2.assign(0);
00039 }
00040
00041 EstimateBBRequest_(const ContainerAllocator& _alloc)
00042 : header(_alloc)
00043 , p1()
00044 , p2()
00045 , mode(0)
00046 {
00047 p1.assign(0);
00048 p2.assign(0);
00049 }
00050
00051 typedef ::std_msgs::Header_<ContainerAllocator> _header_type;
00052 ::std_msgs::Header_<ContainerAllocator> header;
00053
00054 typedef boost::array<int16_t, 2> _p1_type;
00055 boost::array<int16_t, 2> p1;
00056
00057 typedef boost::array<int16_t, 2> _p2_type;
00058 boost::array<int16_t, 2> p2;
00059
00060 typedef int8_t _mode_type;
00061 int8_t mode;
00062
00063
00064 ROS_DEPRECATED uint32_t get_p1_size() const { return (uint32_t)p1.size(); }
00065 ROS_DEPRECATED uint32_t get_p2_size() const { return (uint32_t)p2.size(); }
00066 private:
00067 static const char* __s_getDataType_() { return "srs_env_model_percp/EstimateBBRequest"; }
00068 public:
00069 ROS_DEPRECATED static const std::string __s_getDataType() { return __s_getDataType_(); }
00070
00071 ROS_DEPRECATED const std::string __getDataType() const { return __s_getDataType_(); }
00072
00073 private:
00074 static const char* __s_getMD5Sum_() { return "b6dedd97dda8ffb14bb6ada07363c51a"; }
00075 public:
00076 ROS_DEPRECATED static const std::string __s_getMD5Sum() { return __s_getMD5Sum_(); }
00077
00078 ROS_DEPRECATED const std::string __getMD5Sum() const { return __s_getMD5Sum_(); }
00079
00080 private:
00081 static const char* __s_getServerMD5Sum_() { return "130e4ca67ba701ca993f4e53a24d3b9e"; }
00082 public:
00083 ROS_DEPRECATED static const std::string __s_getServerMD5Sum() { return __s_getServerMD5Sum_(); }
00084
00085 ROS_DEPRECATED const std::string __getServerMD5Sum() const { return __s_getServerMD5Sum_(); }
00086
00087 private:
00088 static const char* __s_getMessageDefinition_() { return "\n\
00089 \n\
00090 \n\
00091 Header header\n\
00092 \n\
00093 \n\
00094 \n\
00095 int16[2] p1\n\
00096 int16[2] p2\n\
00097 \n\
00098 \n\
00099 int8 mode\n\
00100 \n\
00101 ================================================================================\n\
00102 MSG: std_msgs/Header\n\
00103 # Standard metadata for higher-level stamped data types.\n\
00104 # This is generally used to communicate timestamped data \n\
00105 # in a particular coordinate frame.\n\
00106 # \n\
00107 # sequence ID: consecutively increasing ID \n\
00108 uint32 seq\n\
00109 #Two-integer timestamp that is expressed as:\n\
00110 # * stamp.secs: seconds (stamp_secs) since epoch\n\
00111 # * stamp.nsecs: nanoseconds since stamp_secs\n\
00112 # time-handling sugar is provided by the client library\n\
00113 time stamp\n\
00114 #Frame this data is associated with\n\
00115 # 0: no frame\n\
00116 # 1: global frame\n\
00117 string frame_id\n\
00118 \n\
00119 "; }
00120 public:
00121 ROS_DEPRECATED static const std::string __s_getMessageDefinition() { return __s_getMessageDefinition_(); }
00122
00123 ROS_DEPRECATED const std::string __getMessageDefinition() const { return __s_getMessageDefinition_(); }
00124
00125 ROS_DEPRECATED virtual uint8_t *serialize(uint8_t *write_ptr, uint32_t seq) const
00126 {
00127 ros::serialization::OStream stream(write_ptr, 1000000000);
00128 ros::serialization::serialize(stream, header);
00129 ros::serialization::serialize(stream, p1);
00130 ros::serialization::serialize(stream, p2);
00131 ros::serialization::serialize(stream, mode);
00132 return stream.getData();
00133 }
00134
00135 ROS_DEPRECATED virtual uint8_t *deserialize(uint8_t *read_ptr)
00136 {
00137 ros::serialization::IStream stream(read_ptr, 1000000000);
00138 ros::serialization::deserialize(stream, header);
00139 ros::serialization::deserialize(stream, p1);
00140 ros::serialization::deserialize(stream, p2);
00141 ros::serialization::deserialize(stream, mode);
00142 return stream.getData();
00143 }
00144
00145 ROS_DEPRECATED virtual uint32_t serializationLength() const
00146 {
00147 uint32_t size = 0;
00148 size += ros::serialization::serializationLength(header);
00149 size += ros::serialization::serializationLength(p1);
00150 size += ros::serialization::serializationLength(p2);
00151 size += ros::serialization::serializationLength(mode);
00152 return size;
00153 }
00154
00155 typedef boost::shared_ptr< ::srs_env_model_percp::EstimateBBRequest_<ContainerAllocator> > Ptr;
00156 typedef boost::shared_ptr< ::srs_env_model_percp::EstimateBBRequest_<ContainerAllocator> const> ConstPtr;
00157 boost::shared_ptr<std::map<std::string, std::string> > __connection_header;
00158 };
00159 typedef ::srs_env_model_percp::EstimateBBRequest_<std::allocator<void> > EstimateBBRequest;
00160
00161 typedef boost::shared_ptr< ::srs_env_model_percp::EstimateBBRequest> EstimateBBRequestPtr;
00162 typedef boost::shared_ptr< ::srs_env_model_percp::EstimateBBRequest const> EstimateBBRequestConstPtr;
00163
00164
00165 template <class ContainerAllocator>
00166 struct EstimateBBResponse_ {
00167 typedef EstimateBBResponse_<ContainerAllocator> Type;
00168
00169 EstimateBBResponse_()
00170 : p1()
00171 , p2()
00172 , p3()
00173 , p4()
00174 , p5()
00175 , p6()
00176 , p7()
00177 , p8()
00178 , pose()
00179 , scale()
00180 {
00181 p1.assign(0.0);
00182 p2.assign(0.0);
00183 p3.assign(0.0);
00184 p4.assign(0.0);
00185 p5.assign(0.0);
00186 p6.assign(0.0);
00187 p7.assign(0.0);
00188 p8.assign(0.0);
00189 }
00190
00191 EstimateBBResponse_(const ContainerAllocator& _alloc)
00192 : p1()
00193 , p2()
00194 , p3()
00195 , p4()
00196 , p5()
00197 , p6()
00198 , p7()
00199 , p8()
00200 , pose(_alloc)
00201 , scale(_alloc)
00202 {
00203 p1.assign(0.0);
00204 p2.assign(0.0);
00205 p3.assign(0.0);
00206 p4.assign(0.0);
00207 p5.assign(0.0);
00208 p6.assign(0.0);
00209 p7.assign(0.0);
00210 p8.assign(0.0);
00211 }
00212
00213 typedef boost::array<float, 3> _p1_type;
00214 boost::array<float, 3> p1;
00215
00216 typedef boost::array<float, 3> _p2_type;
00217 boost::array<float, 3> p2;
00218
00219 typedef boost::array<float, 3> _p3_type;
00220 boost::array<float, 3> p3;
00221
00222 typedef boost::array<float, 3> _p4_type;
00223 boost::array<float, 3> p4;
00224
00225 typedef boost::array<float, 3> _p5_type;
00226 boost::array<float, 3> p5;
00227
00228 typedef boost::array<float, 3> _p6_type;
00229 boost::array<float, 3> p6;
00230
00231 typedef boost::array<float, 3> _p7_type;
00232 boost::array<float, 3> p7;
00233
00234 typedef boost::array<float, 3> _p8_type;
00235 boost::array<float, 3> p8;
00236
00237 typedef ::geometry_msgs::Pose_<ContainerAllocator> _pose_type;
00238 ::geometry_msgs::Pose_<ContainerAllocator> pose;
00239
00240 typedef ::geometry_msgs::Vector3_<ContainerAllocator> _scale_type;
00241 ::geometry_msgs::Vector3_<ContainerAllocator> scale;
00242
00243
00244 ROS_DEPRECATED uint32_t get_p1_size() const { return (uint32_t)p1.size(); }
00245 ROS_DEPRECATED uint32_t get_p2_size() const { return (uint32_t)p2.size(); }
00246 ROS_DEPRECATED uint32_t get_p3_size() const { return (uint32_t)p3.size(); }
00247 ROS_DEPRECATED uint32_t get_p4_size() const { return (uint32_t)p4.size(); }
00248 ROS_DEPRECATED uint32_t get_p5_size() const { return (uint32_t)p5.size(); }
00249 ROS_DEPRECATED uint32_t get_p6_size() const { return (uint32_t)p6.size(); }
00250 ROS_DEPRECATED uint32_t get_p7_size() const { return (uint32_t)p7.size(); }
00251 ROS_DEPRECATED uint32_t get_p8_size() const { return (uint32_t)p8.size(); }
00252 private:
00253 static const char* __s_getDataType_() { return "srs_env_model_percp/EstimateBBResponse"; }
00254 public:
00255 ROS_DEPRECATED static const std::string __s_getDataType() { return __s_getDataType_(); }
00256
00257 ROS_DEPRECATED const std::string __getDataType() const { return __s_getDataType_(); }
00258
00259 private:
00260 static const char* __s_getMD5Sum_() { return "67df431f59611afc0dd11ada2e7229f3"; }
00261 public:
00262 ROS_DEPRECATED static const std::string __s_getMD5Sum() { return __s_getMD5Sum_(); }
00263
00264 ROS_DEPRECATED const std::string __getMD5Sum() const { return __s_getMD5Sum_(); }
00265
00266 private:
00267 static const char* __s_getServerMD5Sum_() { return "130e4ca67ba701ca993f4e53a24d3b9e"; }
00268 public:
00269 ROS_DEPRECATED static const std::string __s_getServerMD5Sum() { return __s_getServerMD5Sum_(); }
00270
00271 ROS_DEPRECATED const std::string __getServerMD5Sum() const { return __s_getServerMD5Sum_(); }
00272
00273 private:
00274 static const char* __s_getMessageDefinition_() { return "\n\
00275 \n\
00276 \n\
00277 \n\
00278 \n\
00279 float32[3] p1\n\
00280 float32[3] p2\n\
00281 float32[3] p3\n\
00282 float32[3] p4\n\
00283 float32[3] p5\n\
00284 float32[3] p6\n\
00285 float32[3] p7\n\
00286 float32[3] p8\n\
00287 \n\
00288 \n\
00289 geometry_msgs/Pose pose\n\
00290 \n\
00291 \n\
00292 \n\
00293 geometry_msgs/Vector3 scale\n\
00294 \n\
00295 \n\
00296 \n\
00297 ================================================================================\n\
00298 MSG: geometry_msgs/Pose\n\
00299 # A representation of pose in free space, composed of postion and orientation. \n\
00300 Point position\n\
00301 Quaternion orientation\n\
00302 \n\
00303 ================================================================================\n\
00304 MSG: geometry_msgs/Point\n\
00305 # This contains the position of a point in free space\n\
00306 float64 x\n\
00307 float64 y\n\
00308 float64 z\n\
00309 \n\
00310 ================================================================================\n\
00311 MSG: geometry_msgs/Quaternion\n\
00312 # This represents an orientation in free space in quaternion form.\n\
00313 \n\
00314 float64 x\n\
00315 float64 y\n\
00316 float64 z\n\
00317 float64 w\n\
00318 \n\
00319 ================================================================================\n\
00320 MSG: geometry_msgs/Vector3\n\
00321 # This represents a vector in free space. \n\
00322 \n\
00323 float64 x\n\
00324 float64 y\n\
00325 float64 z\n\
00326 "; }
00327 public:
00328 ROS_DEPRECATED static const std::string __s_getMessageDefinition() { return __s_getMessageDefinition_(); }
00329
00330 ROS_DEPRECATED const std::string __getMessageDefinition() const { return __s_getMessageDefinition_(); }
00331
00332 ROS_DEPRECATED virtual uint8_t *serialize(uint8_t *write_ptr, uint32_t seq) const
00333 {
00334 ros::serialization::OStream stream(write_ptr, 1000000000);
00335 ros::serialization::serialize(stream, p1);
00336 ros::serialization::serialize(stream, p2);
00337 ros::serialization::serialize(stream, p3);
00338 ros::serialization::serialize(stream, p4);
00339 ros::serialization::serialize(stream, p5);
00340 ros::serialization::serialize(stream, p6);
00341 ros::serialization::serialize(stream, p7);
00342 ros::serialization::serialize(stream, p8);
00343 ros::serialization::serialize(stream, pose);
00344 ros::serialization::serialize(stream, scale);
00345 return stream.getData();
00346 }
00347
00348 ROS_DEPRECATED virtual uint8_t *deserialize(uint8_t *read_ptr)
00349 {
00350 ros::serialization::IStream stream(read_ptr, 1000000000);
00351 ros::serialization::deserialize(stream, p1);
00352 ros::serialization::deserialize(stream, p2);
00353 ros::serialization::deserialize(stream, p3);
00354 ros::serialization::deserialize(stream, p4);
00355 ros::serialization::deserialize(stream, p5);
00356 ros::serialization::deserialize(stream, p6);
00357 ros::serialization::deserialize(stream, p7);
00358 ros::serialization::deserialize(stream, p8);
00359 ros::serialization::deserialize(stream, pose);
00360 ros::serialization::deserialize(stream, scale);
00361 return stream.getData();
00362 }
00363
00364 ROS_DEPRECATED virtual uint32_t serializationLength() const
00365 {
00366 uint32_t size = 0;
00367 size += ros::serialization::serializationLength(p1);
00368 size += ros::serialization::serializationLength(p2);
00369 size += ros::serialization::serializationLength(p3);
00370 size += ros::serialization::serializationLength(p4);
00371 size += ros::serialization::serializationLength(p5);
00372 size += ros::serialization::serializationLength(p6);
00373 size += ros::serialization::serializationLength(p7);
00374 size += ros::serialization::serializationLength(p8);
00375 size += ros::serialization::serializationLength(pose);
00376 size += ros::serialization::serializationLength(scale);
00377 return size;
00378 }
00379
00380 typedef boost::shared_ptr< ::srs_env_model_percp::EstimateBBResponse_<ContainerAllocator> > Ptr;
00381 typedef boost::shared_ptr< ::srs_env_model_percp::EstimateBBResponse_<ContainerAllocator> const> ConstPtr;
00382 boost::shared_ptr<std::map<std::string, std::string> > __connection_header;
00383 };
00384 typedef ::srs_env_model_percp::EstimateBBResponse_<std::allocator<void> > EstimateBBResponse;
00385
00386 typedef boost::shared_ptr< ::srs_env_model_percp::EstimateBBResponse> EstimateBBResponsePtr;
00387 typedef boost::shared_ptr< ::srs_env_model_percp::EstimateBBResponse const> EstimateBBResponseConstPtr;
00388
00389 struct EstimateBB
00390 {
00391
00392 typedef EstimateBBRequest Request;
00393 typedef EstimateBBResponse Response;
00394 Request request;
00395 Response response;
00396
00397 typedef Request RequestType;
00398 typedef Response ResponseType;
00399 };
00400 }
00401
00402 namespace ros
00403 {
00404 namespace message_traits
00405 {
00406 template<class ContainerAllocator> struct IsMessage< ::srs_env_model_percp::EstimateBBRequest_<ContainerAllocator> > : public TrueType {};
00407 template<class ContainerAllocator> struct IsMessage< ::srs_env_model_percp::EstimateBBRequest_<ContainerAllocator> const> : public TrueType {};
00408 template<class ContainerAllocator>
00409 struct MD5Sum< ::srs_env_model_percp::EstimateBBRequest_<ContainerAllocator> > {
00410 static const char* value()
00411 {
00412 return "b6dedd97dda8ffb14bb6ada07363c51a";
00413 }
00414
00415 static const char* value(const ::srs_env_model_percp::EstimateBBRequest_<ContainerAllocator> &) { return value(); }
00416 static const uint64_t static_value1 = 0xb6dedd97dda8ffb1ULL;
00417 static const uint64_t static_value2 = 0x4bb6ada07363c51aULL;
00418 };
00419
00420 template<class ContainerAllocator>
00421 struct DataType< ::srs_env_model_percp::EstimateBBRequest_<ContainerAllocator> > {
00422 static const char* value()
00423 {
00424 return "srs_env_model_percp/EstimateBBRequest";
00425 }
00426
00427 static const char* value(const ::srs_env_model_percp::EstimateBBRequest_<ContainerAllocator> &) { return value(); }
00428 };
00429
00430 template<class ContainerAllocator>
00431 struct Definition< ::srs_env_model_percp::EstimateBBRequest_<ContainerAllocator> > {
00432 static const char* value()
00433 {
00434 return "\n\
00435 \n\
00436 \n\
00437 Header header\n\
00438 \n\
00439 \n\
00440 \n\
00441 int16[2] p1\n\
00442 int16[2] p2\n\
00443 \n\
00444 \n\
00445 int8 mode\n\
00446 \n\
00447 ================================================================================\n\
00448 MSG: std_msgs/Header\n\
00449 # Standard metadata for higher-level stamped data types.\n\
00450 # This is generally used to communicate timestamped data \n\
00451 # in a particular coordinate frame.\n\
00452 # \n\
00453 # sequence ID: consecutively increasing ID \n\
00454 uint32 seq\n\
00455 #Two-integer timestamp that is expressed as:\n\
00456 # * stamp.secs: seconds (stamp_secs) since epoch\n\
00457 # * stamp.nsecs: nanoseconds since stamp_secs\n\
00458 # time-handling sugar is provided by the client library\n\
00459 time stamp\n\
00460 #Frame this data is associated with\n\
00461 # 0: no frame\n\
00462 # 1: global frame\n\
00463 string frame_id\n\
00464 \n\
00465 ";
00466 }
00467
00468 static const char* value(const ::srs_env_model_percp::EstimateBBRequest_<ContainerAllocator> &) { return value(); }
00469 };
00470
00471 template<class ContainerAllocator> struct HasHeader< ::srs_env_model_percp::EstimateBBRequest_<ContainerAllocator> > : public TrueType {};
00472 template<class ContainerAllocator> struct HasHeader< const ::srs_env_model_percp::EstimateBBRequest_<ContainerAllocator> > : public TrueType {};
00473 }
00474 }
00475
00476
00477 namespace ros
00478 {
00479 namespace message_traits
00480 {
00481 template<class ContainerAllocator> struct IsMessage< ::srs_env_model_percp::EstimateBBResponse_<ContainerAllocator> > : public TrueType {};
00482 template<class ContainerAllocator> struct IsMessage< ::srs_env_model_percp::EstimateBBResponse_<ContainerAllocator> const> : public TrueType {};
00483 template<class ContainerAllocator>
00484 struct MD5Sum< ::srs_env_model_percp::EstimateBBResponse_<ContainerAllocator> > {
00485 static const char* value()
00486 {
00487 return "67df431f59611afc0dd11ada2e7229f3";
00488 }
00489
00490 static const char* value(const ::srs_env_model_percp::EstimateBBResponse_<ContainerAllocator> &) { return value(); }
00491 static const uint64_t static_value1 = 0x67df431f59611afcULL;
00492 static const uint64_t static_value2 = 0x0dd11ada2e7229f3ULL;
00493 };
00494
00495 template<class ContainerAllocator>
00496 struct DataType< ::srs_env_model_percp::EstimateBBResponse_<ContainerAllocator> > {
00497 static const char* value()
00498 {
00499 return "srs_env_model_percp/EstimateBBResponse";
00500 }
00501
00502 static const char* value(const ::srs_env_model_percp::EstimateBBResponse_<ContainerAllocator> &) { return value(); }
00503 };
00504
00505 template<class ContainerAllocator>
00506 struct Definition< ::srs_env_model_percp::EstimateBBResponse_<ContainerAllocator> > {
00507 static const char* value()
00508 {
00509 return "\n\
00510 \n\
00511 \n\
00512 \n\
00513 \n\
00514 float32[3] p1\n\
00515 float32[3] p2\n\
00516 float32[3] p3\n\
00517 float32[3] p4\n\
00518 float32[3] p5\n\
00519 float32[3] p6\n\
00520 float32[3] p7\n\
00521 float32[3] p8\n\
00522 \n\
00523 \n\
00524 geometry_msgs/Pose pose\n\
00525 \n\
00526 \n\
00527 \n\
00528 geometry_msgs/Vector3 scale\n\
00529 \n\
00530 \n\
00531 \n\
00532 ================================================================================\n\
00533 MSG: geometry_msgs/Pose\n\
00534 # A representation of pose in free space, composed of postion and orientation. \n\
00535 Point position\n\
00536 Quaternion orientation\n\
00537 \n\
00538 ================================================================================\n\
00539 MSG: geometry_msgs/Point\n\
00540 # This contains the position of a point in free space\n\
00541 float64 x\n\
00542 float64 y\n\
00543 float64 z\n\
00544 \n\
00545 ================================================================================\n\
00546 MSG: geometry_msgs/Quaternion\n\
00547 # This represents an orientation in free space in quaternion form.\n\
00548 \n\
00549 float64 x\n\
00550 float64 y\n\
00551 float64 z\n\
00552 float64 w\n\
00553 \n\
00554 ================================================================================\n\
00555 MSG: geometry_msgs/Vector3\n\
00556 # This represents a vector in free space. \n\
00557 \n\
00558 float64 x\n\
00559 float64 y\n\
00560 float64 z\n\
00561 ";
00562 }
00563
00564 static const char* value(const ::srs_env_model_percp::EstimateBBResponse_<ContainerAllocator> &) { return value(); }
00565 };
00566
00567 template<class ContainerAllocator> struct IsFixedSize< ::srs_env_model_percp::EstimateBBResponse_<ContainerAllocator> > : public TrueType {};
00568 }
00569 }
00570
00571 namespace ros
00572 {
00573 namespace serialization
00574 {
00575
00576 template<class ContainerAllocator> struct Serializer< ::srs_env_model_percp::EstimateBBRequest_<ContainerAllocator> >
00577 {
00578 template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m)
00579 {
00580 stream.next(m.header);
00581 stream.next(m.p1);
00582 stream.next(m.p2);
00583 stream.next(m.mode);
00584 }
00585
00586 ROS_DECLARE_ALLINONE_SERIALIZER;
00587 };
00588 }
00589 }
00590
00591
00592 namespace ros
00593 {
00594 namespace serialization
00595 {
00596
00597 template<class ContainerAllocator> struct Serializer< ::srs_env_model_percp::EstimateBBResponse_<ContainerAllocator> >
00598 {
00599 template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m)
00600 {
00601 stream.next(m.p1);
00602 stream.next(m.p2);
00603 stream.next(m.p3);
00604 stream.next(m.p4);
00605 stream.next(m.p5);
00606 stream.next(m.p6);
00607 stream.next(m.p7);
00608 stream.next(m.p8);
00609 stream.next(m.pose);
00610 stream.next(m.scale);
00611 }
00612
00613 ROS_DECLARE_ALLINONE_SERIALIZER;
00614 };
00615 }
00616 }
00617
00618 namespace ros
00619 {
00620 namespace service_traits
00621 {
00622 template<>
00623 struct MD5Sum<srs_env_model_percp::EstimateBB> {
00624 static const char* value()
00625 {
00626 return "130e4ca67ba701ca993f4e53a24d3b9e";
00627 }
00628
00629 static const char* value(const srs_env_model_percp::EstimateBB&) { return value(); }
00630 };
00631
00632 template<>
00633 struct DataType<srs_env_model_percp::EstimateBB> {
00634 static const char* value()
00635 {
00636 return "srs_env_model_percp/EstimateBB";
00637 }
00638
00639 static const char* value(const srs_env_model_percp::EstimateBB&) { return value(); }
00640 };
00641
00642 template<class ContainerAllocator>
00643 struct MD5Sum<srs_env_model_percp::EstimateBBRequest_<ContainerAllocator> > {
00644 static const char* value()
00645 {
00646 return "130e4ca67ba701ca993f4e53a24d3b9e";
00647 }
00648
00649 static const char* value(const srs_env_model_percp::EstimateBBRequest_<ContainerAllocator> &) { return value(); }
00650 };
00651
00652 template<class ContainerAllocator>
00653 struct DataType<srs_env_model_percp::EstimateBBRequest_<ContainerAllocator> > {
00654 static const char* value()
00655 {
00656 return "srs_env_model_percp/EstimateBB";
00657 }
00658
00659 static const char* value(const srs_env_model_percp::EstimateBBRequest_<ContainerAllocator> &) { return value(); }
00660 };
00661
00662 template<class ContainerAllocator>
00663 struct MD5Sum<srs_env_model_percp::EstimateBBResponse_<ContainerAllocator> > {
00664 static const char* value()
00665 {
00666 return "130e4ca67ba701ca993f4e53a24d3b9e";
00667 }
00668
00669 static const char* value(const srs_env_model_percp::EstimateBBResponse_<ContainerAllocator> &) { return value(); }
00670 };
00671
00672 template<class ContainerAllocator>
00673 struct DataType<srs_env_model_percp::EstimateBBResponse_<ContainerAllocator> > {
00674 static const char* value()
00675 {
00676 return "srs_env_model_percp/EstimateBB";
00677 }
00678
00679 static const char* value(const srs_env_model_percp::EstimateBBResponse_<ContainerAllocator> &) { return value(); }
00680 };
00681
00682 }
00683 }
00684
00685 #endif // SRS_ENV_MODEL_PERCP_SERVICE_ESTIMATEBB_H
00686