00001
00002 #ifndef SRS_ENV_MODEL_PERCP_SERVICE_ESTIMATEBBALT_H
00003 #define SRS_ENV_MODEL_PERCP_SERVICE_ESTIMATEBBALT_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/Point.h"
00024
00025 namespace srs_env_model_percp
00026 {
00027 template <class ContainerAllocator>
00028 struct EstimateBBAltRequest_ {
00029 typedef EstimateBBAltRequest_<ContainerAllocator> Type;
00030
00031 EstimateBBAltRequest_()
00032 : header()
00033 , p1()
00034 , p2()
00035 , mode(0)
00036 {
00037 p1.assign(0);
00038 p2.assign(0);
00039 }
00040
00041 EstimateBBAltRequest_(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/EstimateBBAltRequest"; }
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 "ad9fc15330f0f127272c698f197e1c53"; }
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::EstimateBBAltRequest_<ContainerAllocator> > Ptr;
00156 typedef boost::shared_ptr< ::srs_env_model_percp::EstimateBBAltRequest_<ContainerAllocator> const> ConstPtr;
00157 boost::shared_ptr<std::map<std::string, std::string> > __connection_header;
00158 };
00159 typedef ::srs_env_model_percp::EstimateBBAltRequest_<std::allocator<void> > EstimateBBAltRequest;
00160
00161 typedef boost::shared_ptr< ::srs_env_model_percp::EstimateBBAltRequest> EstimateBBAltRequestPtr;
00162 typedef boost::shared_ptr< ::srs_env_model_percp::EstimateBBAltRequest const> EstimateBBAltRequestConstPtr;
00163
00164
00165 template <class ContainerAllocator>
00166 struct EstimateBBAltResponse_ {
00167 typedef EstimateBBAltResponse_<ContainerAllocator> Type;
00168
00169 EstimateBBAltResponse_()
00170 : pose()
00171 , bounding_box_lwh()
00172 {
00173 }
00174
00175 EstimateBBAltResponse_(const ContainerAllocator& _alloc)
00176 : pose(_alloc)
00177 , bounding_box_lwh(_alloc)
00178 {
00179 }
00180
00181 typedef ::geometry_msgs::Pose_<ContainerAllocator> _pose_type;
00182 ::geometry_msgs::Pose_<ContainerAllocator> pose;
00183
00184 typedef ::geometry_msgs::Point_<ContainerAllocator> _bounding_box_lwh_type;
00185 ::geometry_msgs::Point_<ContainerAllocator> bounding_box_lwh;
00186
00187
00188 private:
00189 static const char* __s_getDataType_() { return "srs_env_model_percp/EstimateBBAltResponse"; }
00190 public:
00191 ROS_DEPRECATED static const std::string __s_getDataType() { return __s_getDataType_(); }
00192
00193 ROS_DEPRECATED const std::string __getDataType() const { return __s_getDataType_(); }
00194
00195 private:
00196 static const char* __s_getMD5Sum_() { return "1c8cec028834b47e796bdf21911f3193"; }
00197 public:
00198 ROS_DEPRECATED static const std::string __s_getMD5Sum() { return __s_getMD5Sum_(); }
00199
00200 ROS_DEPRECATED const std::string __getMD5Sum() const { return __s_getMD5Sum_(); }
00201
00202 private:
00203 static const char* __s_getServerMD5Sum_() { return "ad9fc15330f0f127272c698f197e1c53"; }
00204 public:
00205 ROS_DEPRECATED static const std::string __s_getServerMD5Sum() { return __s_getServerMD5Sum_(); }
00206
00207 ROS_DEPRECATED const std::string __getServerMD5Sum() const { return __s_getServerMD5Sum_(); }
00208
00209 private:
00210 static const char* __s_getMessageDefinition_() { return "\n\
00211 \n\
00212 \n\
00213 \n\
00214 \n\
00215 \n\
00216 geometry_msgs/Pose pose\n\
00217 \n\
00218 \n\
00219 \n\
00220 \n\
00221 \n\
00222 \n\
00223 geometry_msgs/Point bounding_box_lwh\n\
00224 \n\
00225 \n\
00226 \n\
00227 ================================================================================\n\
00228 MSG: geometry_msgs/Pose\n\
00229 # A representation of pose in free space, composed of postion and orientation. \n\
00230 Point position\n\
00231 Quaternion orientation\n\
00232 \n\
00233 ================================================================================\n\
00234 MSG: geometry_msgs/Point\n\
00235 # This contains the position of a point in free space\n\
00236 float64 x\n\
00237 float64 y\n\
00238 float64 z\n\
00239 \n\
00240 ================================================================================\n\
00241 MSG: geometry_msgs/Quaternion\n\
00242 # This represents an orientation in free space in quaternion form.\n\
00243 \n\
00244 float64 x\n\
00245 float64 y\n\
00246 float64 z\n\
00247 float64 w\n\
00248 \n\
00249 "; }
00250 public:
00251 ROS_DEPRECATED static const std::string __s_getMessageDefinition() { return __s_getMessageDefinition_(); }
00252
00253 ROS_DEPRECATED const std::string __getMessageDefinition() const { return __s_getMessageDefinition_(); }
00254
00255 ROS_DEPRECATED virtual uint8_t *serialize(uint8_t *write_ptr, uint32_t seq) const
00256 {
00257 ros::serialization::OStream stream(write_ptr, 1000000000);
00258 ros::serialization::serialize(stream, pose);
00259 ros::serialization::serialize(stream, bounding_box_lwh);
00260 return stream.getData();
00261 }
00262
00263 ROS_DEPRECATED virtual uint8_t *deserialize(uint8_t *read_ptr)
00264 {
00265 ros::serialization::IStream stream(read_ptr, 1000000000);
00266 ros::serialization::deserialize(stream, pose);
00267 ros::serialization::deserialize(stream, bounding_box_lwh);
00268 return stream.getData();
00269 }
00270
00271 ROS_DEPRECATED virtual uint32_t serializationLength() const
00272 {
00273 uint32_t size = 0;
00274 size += ros::serialization::serializationLength(pose);
00275 size += ros::serialization::serializationLength(bounding_box_lwh);
00276 return size;
00277 }
00278
00279 typedef boost::shared_ptr< ::srs_env_model_percp::EstimateBBAltResponse_<ContainerAllocator> > Ptr;
00280 typedef boost::shared_ptr< ::srs_env_model_percp::EstimateBBAltResponse_<ContainerAllocator> const> ConstPtr;
00281 boost::shared_ptr<std::map<std::string, std::string> > __connection_header;
00282 };
00283 typedef ::srs_env_model_percp::EstimateBBAltResponse_<std::allocator<void> > EstimateBBAltResponse;
00284
00285 typedef boost::shared_ptr< ::srs_env_model_percp::EstimateBBAltResponse> EstimateBBAltResponsePtr;
00286 typedef boost::shared_ptr< ::srs_env_model_percp::EstimateBBAltResponse const> EstimateBBAltResponseConstPtr;
00287
00288 struct EstimateBBAlt
00289 {
00290
00291 typedef EstimateBBAltRequest Request;
00292 typedef EstimateBBAltResponse Response;
00293 Request request;
00294 Response response;
00295
00296 typedef Request RequestType;
00297 typedef Response ResponseType;
00298 };
00299 }
00300
00301 namespace ros
00302 {
00303 namespace message_traits
00304 {
00305 template<class ContainerAllocator> struct IsMessage< ::srs_env_model_percp::EstimateBBAltRequest_<ContainerAllocator> > : public TrueType {};
00306 template<class ContainerAllocator> struct IsMessage< ::srs_env_model_percp::EstimateBBAltRequest_<ContainerAllocator> const> : public TrueType {};
00307 template<class ContainerAllocator>
00308 struct MD5Sum< ::srs_env_model_percp::EstimateBBAltRequest_<ContainerAllocator> > {
00309 static const char* value()
00310 {
00311 return "b6dedd97dda8ffb14bb6ada07363c51a";
00312 }
00313
00314 static const char* value(const ::srs_env_model_percp::EstimateBBAltRequest_<ContainerAllocator> &) { return value(); }
00315 static const uint64_t static_value1 = 0xb6dedd97dda8ffb1ULL;
00316 static const uint64_t static_value2 = 0x4bb6ada07363c51aULL;
00317 };
00318
00319 template<class ContainerAllocator>
00320 struct DataType< ::srs_env_model_percp::EstimateBBAltRequest_<ContainerAllocator> > {
00321 static const char* value()
00322 {
00323 return "srs_env_model_percp/EstimateBBAltRequest";
00324 }
00325
00326 static const char* value(const ::srs_env_model_percp::EstimateBBAltRequest_<ContainerAllocator> &) { return value(); }
00327 };
00328
00329 template<class ContainerAllocator>
00330 struct Definition< ::srs_env_model_percp::EstimateBBAltRequest_<ContainerAllocator> > {
00331 static const char* value()
00332 {
00333 return "\n\
00334 \n\
00335 \n\
00336 Header header\n\
00337 \n\
00338 \n\
00339 \n\
00340 int16[2] p1\n\
00341 int16[2] p2\n\
00342 \n\
00343 \n\
00344 int8 mode\n\
00345 \n\
00346 ================================================================================\n\
00347 MSG: std_msgs/Header\n\
00348 # Standard metadata for higher-level stamped data types.\n\
00349 # This is generally used to communicate timestamped data \n\
00350 # in a particular coordinate frame.\n\
00351 # \n\
00352 # sequence ID: consecutively increasing ID \n\
00353 uint32 seq\n\
00354 #Two-integer timestamp that is expressed as:\n\
00355 # * stamp.secs: seconds (stamp_secs) since epoch\n\
00356 # * stamp.nsecs: nanoseconds since stamp_secs\n\
00357 # time-handling sugar is provided by the client library\n\
00358 time stamp\n\
00359 #Frame this data is associated with\n\
00360 # 0: no frame\n\
00361 # 1: global frame\n\
00362 string frame_id\n\
00363 \n\
00364 ";
00365 }
00366
00367 static const char* value(const ::srs_env_model_percp::EstimateBBAltRequest_<ContainerAllocator> &) { return value(); }
00368 };
00369
00370 template<class ContainerAllocator> struct HasHeader< ::srs_env_model_percp::EstimateBBAltRequest_<ContainerAllocator> > : public TrueType {};
00371 template<class ContainerAllocator> struct HasHeader< const ::srs_env_model_percp::EstimateBBAltRequest_<ContainerAllocator> > : public TrueType {};
00372 }
00373 }
00374
00375
00376 namespace ros
00377 {
00378 namespace message_traits
00379 {
00380 template<class ContainerAllocator> struct IsMessage< ::srs_env_model_percp::EstimateBBAltResponse_<ContainerAllocator> > : public TrueType {};
00381 template<class ContainerAllocator> struct IsMessage< ::srs_env_model_percp::EstimateBBAltResponse_<ContainerAllocator> const> : public TrueType {};
00382 template<class ContainerAllocator>
00383 struct MD5Sum< ::srs_env_model_percp::EstimateBBAltResponse_<ContainerAllocator> > {
00384 static const char* value()
00385 {
00386 return "1c8cec028834b47e796bdf21911f3193";
00387 }
00388
00389 static const char* value(const ::srs_env_model_percp::EstimateBBAltResponse_<ContainerAllocator> &) { return value(); }
00390 static const uint64_t static_value1 = 0x1c8cec028834b47eULL;
00391 static const uint64_t static_value2 = 0x796bdf21911f3193ULL;
00392 };
00393
00394 template<class ContainerAllocator>
00395 struct DataType< ::srs_env_model_percp::EstimateBBAltResponse_<ContainerAllocator> > {
00396 static const char* value()
00397 {
00398 return "srs_env_model_percp/EstimateBBAltResponse";
00399 }
00400
00401 static const char* value(const ::srs_env_model_percp::EstimateBBAltResponse_<ContainerAllocator> &) { return value(); }
00402 };
00403
00404 template<class ContainerAllocator>
00405 struct Definition< ::srs_env_model_percp::EstimateBBAltResponse_<ContainerAllocator> > {
00406 static const char* value()
00407 {
00408 return "\n\
00409 \n\
00410 \n\
00411 \n\
00412 \n\
00413 \n\
00414 geometry_msgs/Pose pose\n\
00415 \n\
00416 \n\
00417 \n\
00418 \n\
00419 \n\
00420 \n\
00421 geometry_msgs/Point bounding_box_lwh\n\
00422 \n\
00423 \n\
00424 \n\
00425 ================================================================================\n\
00426 MSG: geometry_msgs/Pose\n\
00427 # A representation of pose in free space, composed of postion and orientation. \n\
00428 Point position\n\
00429 Quaternion orientation\n\
00430 \n\
00431 ================================================================================\n\
00432 MSG: geometry_msgs/Point\n\
00433 # This contains the position of a point in free space\n\
00434 float64 x\n\
00435 float64 y\n\
00436 float64 z\n\
00437 \n\
00438 ================================================================================\n\
00439 MSG: geometry_msgs/Quaternion\n\
00440 # This represents an orientation in free space in quaternion form.\n\
00441 \n\
00442 float64 x\n\
00443 float64 y\n\
00444 float64 z\n\
00445 float64 w\n\
00446 \n\
00447 ";
00448 }
00449
00450 static const char* value(const ::srs_env_model_percp::EstimateBBAltResponse_<ContainerAllocator> &) { return value(); }
00451 };
00452
00453 template<class ContainerAllocator> struct IsFixedSize< ::srs_env_model_percp::EstimateBBAltResponse_<ContainerAllocator> > : public TrueType {};
00454 }
00455 }
00456
00457 namespace ros
00458 {
00459 namespace serialization
00460 {
00461
00462 template<class ContainerAllocator> struct Serializer< ::srs_env_model_percp::EstimateBBAltRequest_<ContainerAllocator> >
00463 {
00464 template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m)
00465 {
00466 stream.next(m.header);
00467 stream.next(m.p1);
00468 stream.next(m.p2);
00469 stream.next(m.mode);
00470 }
00471
00472 ROS_DECLARE_ALLINONE_SERIALIZER;
00473 };
00474 }
00475 }
00476
00477
00478 namespace ros
00479 {
00480 namespace serialization
00481 {
00482
00483 template<class ContainerAllocator> struct Serializer< ::srs_env_model_percp::EstimateBBAltResponse_<ContainerAllocator> >
00484 {
00485 template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m)
00486 {
00487 stream.next(m.pose);
00488 stream.next(m.bounding_box_lwh);
00489 }
00490
00491 ROS_DECLARE_ALLINONE_SERIALIZER;
00492 };
00493 }
00494 }
00495
00496 namespace ros
00497 {
00498 namespace service_traits
00499 {
00500 template<>
00501 struct MD5Sum<srs_env_model_percp::EstimateBBAlt> {
00502 static const char* value()
00503 {
00504 return "ad9fc15330f0f127272c698f197e1c53";
00505 }
00506
00507 static const char* value(const srs_env_model_percp::EstimateBBAlt&) { return value(); }
00508 };
00509
00510 template<>
00511 struct DataType<srs_env_model_percp::EstimateBBAlt> {
00512 static const char* value()
00513 {
00514 return "srs_env_model_percp/EstimateBBAlt";
00515 }
00516
00517 static const char* value(const srs_env_model_percp::EstimateBBAlt&) { return value(); }
00518 };
00519
00520 template<class ContainerAllocator>
00521 struct MD5Sum<srs_env_model_percp::EstimateBBAltRequest_<ContainerAllocator> > {
00522 static const char* value()
00523 {
00524 return "ad9fc15330f0f127272c698f197e1c53";
00525 }
00526
00527 static const char* value(const srs_env_model_percp::EstimateBBAltRequest_<ContainerAllocator> &) { return value(); }
00528 };
00529
00530 template<class ContainerAllocator>
00531 struct DataType<srs_env_model_percp::EstimateBBAltRequest_<ContainerAllocator> > {
00532 static const char* value()
00533 {
00534 return "srs_env_model_percp/EstimateBBAlt";
00535 }
00536
00537 static const char* value(const srs_env_model_percp::EstimateBBAltRequest_<ContainerAllocator> &) { return value(); }
00538 };
00539
00540 template<class ContainerAllocator>
00541 struct MD5Sum<srs_env_model_percp::EstimateBBAltResponse_<ContainerAllocator> > {
00542 static const char* value()
00543 {
00544 return "ad9fc15330f0f127272c698f197e1c53";
00545 }
00546
00547 static const char* value(const srs_env_model_percp::EstimateBBAltResponse_<ContainerAllocator> &) { return value(); }
00548 };
00549
00550 template<class ContainerAllocator>
00551 struct DataType<srs_env_model_percp::EstimateBBAltResponse_<ContainerAllocator> > {
00552 static const char* value()
00553 {
00554 return "srs_env_model_percp/EstimateBBAlt";
00555 }
00556
00557 static const char* value(const srs_env_model_percp::EstimateBBAltResponse_<ContainerAllocator> &) { return value(); }
00558 };
00559
00560 }
00561 }
00562
00563 #endif // SRS_ENV_MODEL_PERCP_SERVICE_ESTIMATEBBALT_H
00564