00001
00002 #ifndef SRS_ENV_MODEL_PERCP_SERVICE_ESTIMATERECTALT_H
00003 #define SRS_ENV_MODEL_PERCP_SERVICE_ESTIMATERECTALT_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 #include "geometry_msgs/Pose.h"
00021 #include "geometry_msgs/Point.h"
00022
00023
00024
00025 namespace srs_env_model_percp
00026 {
00027 template <class ContainerAllocator>
00028 struct EstimateRectAltRequest_ {
00029 typedef EstimateRectAltRequest_<ContainerAllocator> Type;
00030
00031 EstimateRectAltRequest_()
00032 : header()
00033 , pose()
00034 , bounding_box_lwh()
00035 {
00036 }
00037
00038 EstimateRectAltRequest_(const ContainerAllocator& _alloc)
00039 : header(_alloc)
00040 , pose(_alloc)
00041 , bounding_box_lwh(_alloc)
00042 {
00043 }
00044
00045 typedef ::std_msgs::Header_<ContainerAllocator> _header_type;
00046 ::std_msgs::Header_<ContainerAllocator> header;
00047
00048 typedef ::geometry_msgs::Pose_<ContainerAllocator> _pose_type;
00049 ::geometry_msgs::Pose_<ContainerAllocator> pose;
00050
00051 typedef ::geometry_msgs::Point_<ContainerAllocator> _bounding_box_lwh_type;
00052 ::geometry_msgs::Point_<ContainerAllocator> bounding_box_lwh;
00053
00054
00055 private:
00056 static const char* __s_getDataType_() { return "srs_env_model_percp/EstimateRectAltRequest"; }
00057 public:
00058 ROS_DEPRECATED static const std::string __s_getDataType() { return __s_getDataType_(); }
00059
00060 ROS_DEPRECATED const std::string __getDataType() const { return __s_getDataType_(); }
00061
00062 private:
00063 static const char* __s_getMD5Sum_() { return "41dc0657d2e4a9be24c3e1b3d65b81b3"; }
00064 public:
00065 ROS_DEPRECATED static const std::string __s_getMD5Sum() { return __s_getMD5Sum_(); }
00066
00067 ROS_DEPRECATED const std::string __getMD5Sum() const { return __s_getMD5Sum_(); }
00068
00069 private:
00070 static const char* __s_getServerMD5Sum_() { return "162a30e1972ba11d87ef416c5ba2a6d9"; }
00071 public:
00072 ROS_DEPRECATED static const std::string __s_getServerMD5Sum() { return __s_getServerMD5Sum_(); }
00073
00074 ROS_DEPRECATED const std::string __getServerMD5Sum() const { return __s_getServerMD5Sum_(); }
00075
00076 private:
00077 static const char* __s_getMessageDefinition_() { return "\n\
00078 \n\
00079 \n\
00080 Header header\n\
00081 \n\
00082 \n\
00083 \n\
00084 geometry_msgs/Pose pose\n\
00085 \n\
00086 \n\
00087 \n\
00088 \n\
00089 \n\
00090 \n\
00091 geometry_msgs/Point bounding_box_lwh\n\
00092 \n\
00093 ================================================================================\n\
00094 MSG: std_msgs/Header\n\
00095 # Standard metadata for higher-level stamped data types.\n\
00096 # This is generally used to communicate timestamped data \n\
00097 # in a particular coordinate frame.\n\
00098 # \n\
00099 # sequence ID: consecutively increasing ID \n\
00100 uint32 seq\n\
00101 #Two-integer timestamp that is expressed as:\n\
00102 # * stamp.secs: seconds (stamp_secs) since epoch\n\
00103 # * stamp.nsecs: nanoseconds since stamp_secs\n\
00104 # time-handling sugar is provided by the client library\n\
00105 time stamp\n\
00106 #Frame this data is associated with\n\
00107 # 0: no frame\n\
00108 # 1: global frame\n\
00109 string frame_id\n\
00110 \n\
00111 ================================================================================\n\
00112 MSG: geometry_msgs/Pose\n\
00113 # A representation of pose in free space, composed of postion and orientation. \n\
00114 Point position\n\
00115 Quaternion orientation\n\
00116 \n\
00117 ================================================================================\n\
00118 MSG: geometry_msgs/Point\n\
00119 # This contains the position of a point in free space\n\
00120 float64 x\n\
00121 float64 y\n\
00122 float64 z\n\
00123 \n\
00124 ================================================================================\n\
00125 MSG: geometry_msgs/Quaternion\n\
00126 # This represents an orientation in free space in quaternion form.\n\
00127 \n\
00128 float64 x\n\
00129 float64 y\n\
00130 float64 z\n\
00131 float64 w\n\
00132 \n\
00133 "; }
00134 public:
00135 ROS_DEPRECATED static const std::string __s_getMessageDefinition() { return __s_getMessageDefinition_(); }
00136
00137 ROS_DEPRECATED const std::string __getMessageDefinition() const { return __s_getMessageDefinition_(); }
00138
00139 ROS_DEPRECATED virtual uint8_t *serialize(uint8_t *write_ptr, uint32_t seq) const
00140 {
00141 ros::serialization::OStream stream(write_ptr, 1000000000);
00142 ros::serialization::serialize(stream, header);
00143 ros::serialization::serialize(stream, pose);
00144 ros::serialization::serialize(stream, bounding_box_lwh);
00145 return stream.getData();
00146 }
00147
00148 ROS_DEPRECATED virtual uint8_t *deserialize(uint8_t *read_ptr)
00149 {
00150 ros::serialization::IStream stream(read_ptr, 1000000000);
00151 ros::serialization::deserialize(stream, header);
00152 ros::serialization::deserialize(stream, pose);
00153 ros::serialization::deserialize(stream, bounding_box_lwh);
00154 return stream.getData();
00155 }
00156
00157 ROS_DEPRECATED virtual uint32_t serializationLength() const
00158 {
00159 uint32_t size = 0;
00160 size += ros::serialization::serializationLength(header);
00161 size += ros::serialization::serializationLength(pose);
00162 size += ros::serialization::serializationLength(bounding_box_lwh);
00163 return size;
00164 }
00165
00166 typedef boost::shared_ptr< ::srs_env_model_percp::EstimateRectAltRequest_<ContainerAllocator> > Ptr;
00167 typedef boost::shared_ptr< ::srs_env_model_percp::EstimateRectAltRequest_<ContainerAllocator> const> ConstPtr;
00168 boost::shared_ptr<std::map<std::string, std::string> > __connection_header;
00169 };
00170 typedef ::srs_env_model_percp::EstimateRectAltRequest_<std::allocator<void> > EstimateRectAltRequest;
00171
00172 typedef boost::shared_ptr< ::srs_env_model_percp::EstimateRectAltRequest> EstimateRectAltRequestPtr;
00173 typedef boost::shared_ptr< ::srs_env_model_percp::EstimateRectAltRequest const> EstimateRectAltRequestConstPtr;
00174
00175
00176 template <class ContainerAllocator>
00177 struct EstimateRectAltResponse_ {
00178 typedef EstimateRectAltResponse_<ContainerAllocator> Type;
00179
00180 EstimateRectAltResponse_()
00181 : p1()
00182 , p2()
00183 {
00184 p1.assign(0);
00185 p2.assign(0);
00186 }
00187
00188 EstimateRectAltResponse_(const ContainerAllocator& _alloc)
00189 : p1()
00190 , p2()
00191 {
00192 p1.assign(0);
00193 p2.assign(0);
00194 }
00195
00196 typedef boost::array<int16_t, 2> _p1_type;
00197 boost::array<int16_t, 2> p1;
00198
00199 typedef boost::array<int16_t, 2> _p2_type;
00200 boost::array<int16_t, 2> p2;
00201
00202
00203 ROS_DEPRECATED uint32_t get_p1_size() const { return (uint32_t)p1.size(); }
00204 ROS_DEPRECATED uint32_t get_p2_size() const { return (uint32_t)p2.size(); }
00205 private:
00206 static const char* __s_getDataType_() { return "srs_env_model_percp/EstimateRectAltResponse"; }
00207 public:
00208 ROS_DEPRECATED static const std::string __s_getDataType() { return __s_getDataType_(); }
00209
00210 ROS_DEPRECATED const std::string __getDataType() const { return __s_getDataType_(); }
00211
00212 private:
00213 static const char* __s_getMD5Sum_() { return "363df5631fa30ccd790dae289b1dbcc0"; }
00214 public:
00215 ROS_DEPRECATED static const std::string __s_getMD5Sum() { return __s_getMD5Sum_(); }
00216
00217 ROS_DEPRECATED const std::string __getMD5Sum() const { return __s_getMD5Sum_(); }
00218
00219 private:
00220 static const char* __s_getServerMD5Sum_() { return "162a30e1972ba11d87ef416c5ba2a6d9"; }
00221 public:
00222 ROS_DEPRECATED static const std::string __s_getServerMD5Sum() { return __s_getServerMD5Sum_(); }
00223
00224 ROS_DEPRECATED const std::string __getServerMD5Sum() const { return __s_getServerMD5Sum_(); }
00225
00226 private:
00227 static const char* __s_getMessageDefinition_() { return "\n\
00228 \n\
00229 \n\
00230 \n\
00231 \n\
00232 \n\
00233 int16[2] p1\n\
00234 int16[2] p2\n\
00235 \n\
00236 \n\
00237 \n\
00238 "; }
00239 public:
00240 ROS_DEPRECATED static const std::string __s_getMessageDefinition() { return __s_getMessageDefinition_(); }
00241
00242 ROS_DEPRECATED const std::string __getMessageDefinition() const { return __s_getMessageDefinition_(); }
00243
00244 ROS_DEPRECATED virtual uint8_t *serialize(uint8_t *write_ptr, uint32_t seq) const
00245 {
00246 ros::serialization::OStream stream(write_ptr, 1000000000);
00247 ros::serialization::serialize(stream, p1);
00248 ros::serialization::serialize(stream, p2);
00249 return stream.getData();
00250 }
00251
00252 ROS_DEPRECATED virtual uint8_t *deserialize(uint8_t *read_ptr)
00253 {
00254 ros::serialization::IStream stream(read_ptr, 1000000000);
00255 ros::serialization::deserialize(stream, p1);
00256 ros::serialization::deserialize(stream, p2);
00257 return stream.getData();
00258 }
00259
00260 ROS_DEPRECATED virtual uint32_t serializationLength() const
00261 {
00262 uint32_t size = 0;
00263 size += ros::serialization::serializationLength(p1);
00264 size += ros::serialization::serializationLength(p2);
00265 return size;
00266 }
00267
00268 typedef boost::shared_ptr< ::srs_env_model_percp::EstimateRectAltResponse_<ContainerAllocator> > Ptr;
00269 typedef boost::shared_ptr< ::srs_env_model_percp::EstimateRectAltResponse_<ContainerAllocator> const> ConstPtr;
00270 boost::shared_ptr<std::map<std::string, std::string> > __connection_header;
00271 };
00272 typedef ::srs_env_model_percp::EstimateRectAltResponse_<std::allocator<void> > EstimateRectAltResponse;
00273
00274 typedef boost::shared_ptr< ::srs_env_model_percp::EstimateRectAltResponse> EstimateRectAltResponsePtr;
00275 typedef boost::shared_ptr< ::srs_env_model_percp::EstimateRectAltResponse const> EstimateRectAltResponseConstPtr;
00276
00277 struct EstimateRectAlt
00278 {
00279
00280 typedef EstimateRectAltRequest Request;
00281 typedef EstimateRectAltResponse Response;
00282 Request request;
00283 Response response;
00284
00285 typedef Request RequestType;
00286 typedef Response ResponseType;
00287 };
00288 }
00289
00290 namespace ros
00291 {
00292 namespace message_traits
00293 {
00294 template<class ContainerAllocator> struct IsMessage< ::srs_env_model_percp::EstimateRectAltRequest_<ContainerAllocator> > : public TrueType {};
00295 template<class ContainerAllocator> struct IsMessage< ::srs_env_model_percp::EstimateRectAltRequest_<ContainerAllocator> const> : public TrueType {};
00296 template<class ContainerAllocator>
00297 struct MD5Sum< ::srs_env_model_percp::EstimateRectAltRequest_<ContainerAllocator> > {
00298 static const char* value()
00299 {
00300 return "41dc0657d2e4a9be24c3e1b3d65b81b3";
00301 }
00302
00303 static const char* value(const ::srs_env_model_percp::EstimateRectAltRequest_<ContainerAllocator> &) { return value(); }
00304 static const uint64_t static_value1 = 0x41dc0657d2e4a9beULL;
00305 static const uint64_t static_value2 = 0x24c3e1b3d65b81b3ULL;
00306 };
00307
00308 template<class ContainerAllocator>
00309 struct DataType< ::srs_env_model_percp::EstimateRectAltRequest_<ContainerAllocator> > {
00310 static const char* value()
00311 {
00312 return "srs_env_model_percp/EstimateRectAltRequest";
00313 }
00314
00315 static const char* value(const ::srs_env_model_percp::EstimateRectAltRequest_<ContainerAllocator> &) { return value(); }
00316 };
00317
00318 template<class ContainerAllocator>
00319 struct Definition< ::srs_env_model_percp::EstimateRectAltRequest_<ContainerAllocator> > {
00320 static const char* value()
00321 {
00322 return "\n\
00323 \n\
00324 \n\
00325 Header header\n\
00326 \n\
00327 \n\
00328 \n\
00329 geometry_msgs/Pose pose\n\
00330 \n\
00331 \n\
00332 \n\
00333 \n\
00334 \n\
00335 \n\
00336 geometry_msgs/Point bounding_box_lwh\n\
00337 \n\
00338 ================================================================================\n\
00339 MSG: std_msgs/Header\n\
00340 # Standard metadata for higher-level stamped data types.\n\
00341 # This is generally used to communicate timestamped data \n\
00342 # in a particular coordinate frame.\n\
00343 # \n\
00344 # sequence ID: consecutively increasing ID \n\
00345 uint32 seq\n\
00346 #Two-integer timestamp that is expressed as:\n\
00347 # * stamp.secs: seconds (stamp_secs) since epoch\n\
00348 # * stamp.nsecs: nanoseconds since stamp_secs\n\
00349 # time-handling sugar is provided by the client library\n\
00350 time stamp\n\
00351 #Frame this data is associated with\n\
00352 # 0: no frame\n\
00353 # 1: global frame\n\
00354 string frame_id\n\
00355 \n\
00356 ================================================================================\n\
00357 MSG: geometry_msgs/Pose\n\
00358 # A representation of pose in free space, composed of postion and orientation. \n\
00359 Point position\n\
00360 Quaternion orientation\n\
00361 \n\
00362 ================================================================================\n\
00363 MSG: geometry_msgs/Point\n\
00364 # This contains the position of a point in free space\n\
00365 float64 x\n\
00366 float64 y\n\
00367 float64 z\n\
00368 \n\
00369 ================================================================================\n\
00370 MSG: geometry_msgs/Quaternion\n\
00371 # This represents an orientation in free space in quaternion form.\n\
00372 \n\
00373 float64 x\n\
00374 float64 y\n\
00375 float64 z\n\
00376 float64 w\n\
00377 \n\
00378 ";
00379 }
00380
00381 static const char* value(const ::srs_env_model_percp::EstimateRectAltRequest_<ContainerAllocator> &) { return value(); }
00382 };
00383
00384 template<class ContainerAllocator> struct HasHeader< ::srs_env_model_percp::EstimateRectAltRequest_<ContainerAllocator> > : public TrueType {};
00385 template<class ContainerAllocator> struct HasHeader< const ::srs_env_model_percp::EstimateRectAltRequest_<ContainerAllocator> > : public TrueType {};
00386 }
00387 }
00388
00389
00390 namespace ros
00391 {
00392 namespace message_traits
00393 {
00394 template<class ContainerAllocator> struct IsMessage< ::srs_env_model_percp::EstimateRectAltResponse_<ContainerAllocator> > : public TrueType {};
00395 template<class ContainerAllocator> struct IsMessage< ::srs_env_model_percp::EstimateRectAltResponse_<ContainerAllocator> const> : public TrueType {};
00396 template<class ContainerAllocator>
00397 struct MD5Sum< ::srs_env_model_percp::EstimateRectAltResponse_<ContainerAllocator> > {
00398 static const char* value()
00399 {
00400 return "363df5631fa30ccd790dae289b1dbcc0";
00401 }
00402
00403 static const char* value(const ::srs_env_model_percp::EstimateRectAltResponse_<ContainerAllocator> &) { return value(); }
00404 static const uint64_t static_value1 = 0x363df5631fa30ccdULL;
00405 static const uint64_t static_value2 = 0x790dae289b1dbcc0ULL;
00406 };
00407
00408 template<class ContainerAllocator>
00409 struct DataType< ::srs_env_model_percp::EstimateRectAltResponse_<ContainerAllocator> > {
00410 static const char* value()
00411 {
00412 return "srs_env_model_percp/EstimateRectAltResponse";
00413 }
00414
00415 static const char* value(const ::srs_env_model_percp::EstimateRectAltResponse_<ContainerAllocator> &) { return value(); }
00416 };
00417
00418 template<class ContainerAllocator>
00419 struct Definition< ::srs_env_model_percp::EstimateRectAltResponse_<ContainerAllocator> > {
00420 static const char* value()
00421 {
00422 return "\n\
00423 \n\
00424 \n\
00425 \n\
00426 \n\
00427 \n\
00428 int16[2] p1\n\
00429 int16[2] p2\n\
00430 \n\
00431 \n\
00432 \n\
00433 ";
00434 }
00435
00436 static const char* value(const ::srs_env_model_percp::EstimateRectAltResponse_<ContainerAllocator> &) { return value(); }
00437 };
00438
00439 template<class ContainerAllocator> struct IsFixedSize< ::srs_env_model_percp::EstimateRectAltResponse_<ContainerAllocator> > : public TrueType {};
00440 }
00441 }
00442
00443 namespace ros
00444 {
00445 namespace serialization
00446 {
00447
00448 template<class ContainerAllocator> struct Serializer< ::srs_env_model_percp::EstimateRectAltRequest_<ContainerAllocator> >
00449 {
00450 template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m)
00451 {
00452 stream.next(m.header);
00453 stream.next(m.pose);
00454 stream.next(m.bounding_box_lwh);
00455 }
00456
00457 ROS_DECLARE_ALLINONE_SERIALIZER;
00458 };
00459 }
00460 }
00461
00462
00463 namespace ros
00464 {
00465 namespace serialization
00466 {
00467
00468 template<class ContainerAllocator> struct Serializer< ::srs_env_model_percp::EstimateRectAltResponse_<ContainerAllocator> >
00469 {
00470 template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m)
00471 {
00472 stream.next(m.p1);
00473 stream.next(m.p2);
00474 }
00475
00476 ROS_DECLARE_ALLINONE_SERIALIZER;
00477 };
00478 }
00479 }
00480
00481 namespace ros
00482 {
00483 namespace service_traits
00484 {
00485 template<>
00486 struct MD5Sum<srs_env_model_percp::EstimateRectAlt> {
00487 static const char* value()
00488 {
00489 return "162a30e1972ba11d87ef416c5ba2a6d9";
00490 }
00491
00492 static const char* value(const srs_env_model_percp::EstimateRectAlt&) { return value(); }
00493 };
00494
00495 template<>
00496 struct DataType<srs_env_model_percp::EstimateRectAlt> {
00497 static const char* value()
00498 {
00499 return "srs_env_model_percp/EstimateRectAlt";
00500 }
00501
00502 static const char* value(const srs_env_model_percp::EstimateRectAlt&) { return value(); }
00503 };
00504
00505 template<class ContainerAllocator>
00506 struct MD5Sum<srs_env_model_percp::EstimateRectAltRequest_<ContainerAllocator> > {
00507 static const char* value()
00508 {
00509 return "162a30e1972ba11d87ef416c5ba2a6d9";
00510 }
00511
00512 static const char* value(const srs_env_model_percp::EstimateRectAltRequest_<ContainerAllocator> &) { return value(); }
00513 };
00514
00515 template<class ContainerAllocator>
00516 struct DataType<srs_env_model_percp::EstimateRectAltRequest_<ContainerAllocator> > {
00517 static const char* value()
00518 {
00519 return "srs_env_model_percp/EstimateRectAlt";
00520 }
00521
00522 static const char* value(const srs_env_model_percp::EstimateRectAltRequest_<ContainerAllocator> &) { return value(); }
00523 };
00524
00525 template<class ContainerAllocator>
00526 struct MD5Sum<srs_env_model_percp::EstimateRectAltResponse_<ContainerAllocator> > {
00527 static const char* value()
00528 {
00529 return "162a30e1972ba11d87ef416c5ba2a6d9";
00530 }
00531
00532 static const char* value(const srs_env_model_percp::EstimateRectAltResponse_<ContainerAllocator> &) { return value(); }
00533 };
00534
00535 template<class ContainerAllocator>
00536 struct DataType<srs_env_model_percp::EstimateRectAltResponse_<ContainerAllocator> > {
00537 static const char* value()
00538 {
00539 return "srs_env_model_percp/EstimateRectAlt";
00540 }
00541
00542 static const char* value(const srs_env_model_percp::EstimateRectAltResponse_<ContainerAllocator> &) { return value(); }
00543 };
00544
00545 }
00546 }
00547
00548 #endif // SRS_ENV_MODEL_PERCP_SERVICE_ESTIMATERECTALT_H
00549