$search
00001 /* Auto-generated by genmsg_cpp for file /home/rosbuild/hudson/workspace/doc-electric-srs_public/doc_stacks/2013-03-05_12-22-34.333426/srs_public/srs_body_detector/srv/getBodyDetections.srv */ 00002 #ifndef SRS_BODY_DETECTOR_SERVICE_GETBODYDETECTIONS_H 00003 #define SRS_BODY_DETECTOR_SERVICE_GETBODYDETECTIONS_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 "geometry_msgs/Pose.h" 00022 00023 namespace srs_body_detector 00024 { 00025 template <class ContainerAllocator> 00026 struct getBodyDetectionsRequest_ { 00027 typedef getBodyDetectionsRequest_<ContainerAllocator> Type; 00028 00029 getBodyDetectionsRequest_() 00030 { 00031 } 00032 00033 getBodyDetectionsRequest_(const ContainerAllocator& _alloc) 00034 { 00035 } 00036 00037 00038 private: 00039 static const char* __s_getDataType_() { return "srs_body_detector/getBodyDetectionsRequest"; } 00040 public: 00041 ROS_DEPRECATED static const std::string __s_getDataType() { return __s_getDataType_(); } 00042 00043 ROS_DEPRECATED const std::string __getDataType() const { return __s_getDataType_(); } 00044 00045 private: 00046 static const char* __s_getMD5Sum_() { return "d41d8cd98f00b204e9800998ecf8427e"; } 00047 public: 00048 ROS_DEPRECATED static const std::string __s_getMD5Sum() { return __s_getMD5Sum_(); } 00049 00050 ROS_DEPRECATED const std::string __getMD5Sum() const { return __s_getMD5Sum_(); } 00051 00052 private: 00053 static const char* __s_getServerMD5Sum_() { return "240e092e1ab6f63df32eca12154e1a3f"; } 00054 public: 00055 ROS_DEPRECATED static const std::string __s_getServerMD5Sum() { return __s_getServerMD5Sum_(); } 00056 00057 ROS_DEPRECATED const std::string __getServerMD5Sum() const { return __s_getServerMD5Sum_(); } 00058 00059 private: 00060 static const char* __s_getMessageDefinition_() { return "\n\ 00061 \n\ 00062 "; } 00063 public: 00064 ROS_DEPRECATED static const std::string __s_getMessageDefinition() { return __s_getMessageDefinition_(); } 00065 00066 ROS_DEPRECATED const std::string __getMessageDefinition() const { return __s_getMessageDefinition_(); } 00067 00068 ROS_DEPRECATED virtual uint8_t *serialize(uint8_t *write_ptr, uint32_t seq) const 00069 { 00070 ros::serialization::OStream stream(write_ptr, 1000000000); 00071 return stream.getData(); 00072 } 00073 00074 ROS_DEPRECATED virtual uint8_t *deserialize(uint8_t *read_ptr) 00075 { 00076 ros::serialization::IStream stream(read_ptr, 1000000000); 00077 return stream.getData(); 00078 } 00079 00080 ROS_DEPRECATED virtual uint32_t serializationLength() const 00081 { 00082 uint32_t size = 0; 00083 return size; 00084 } 00085 00086 typedef boost::shared_ptr< ::srs_body_detector::getBodyDetectionsRequest_<ContainerAllocator> > Ptr; 00087 typedef boost::shared_ptr< ::srs_body_detector::getBodyDetectionsRequest_<ContainerAllocator> const> ConstPtr; 00088 boost::shared_ptr<std::map<std::string, std::string> > __connection_header; 00089 }; // struct getBodyDetectionsRequest 00090 typedef ::srs_body_detector::getBodyDetectionsRequest_<std::allocator<void> > getBodyDetectionsRequest; 00091 00092 typedef boost::shared_ptr< ::srs_body_detector::getBodyDetectionsRequest> getBodyDetectionsRequestPtr; 00093 typedef boost::shared_ptr< ::srs_body_detector::getBodyDetectionsRequest const> getBodyDetectionsRequestConstPtr; 00094 00095 00096 template <class ContainerAllocator> 00097 struct getBodyDetectionsResponse_ { 00098 typedef getBodyDetectionsResponse_<ContainerAllocator> Type; 00099 00100 getBodyDetectionsResponse_() 00101 : bodies_list() 00102 { 00103 } 00104 00105 getBodyDetectionsResponse_(const ContainerAllocator& _alloc) 00106 : bodies_list(_alloc) 00107 { 00108 } 00109 00110 typedef std::vector< ::geometry_msgs::Pose_<ContainerAllocator> , typename ContainerAllocator::template rebind< ::geometry_msgs::Pose_<ContainerAllocator> >::other > _bodies_list_type; 00111 std::vector< ::geometry_msgs::Pose_<ContainerAllocator> , typename ContainerAllocator::template rebind< ::geometry_msgs::Pose_<ContainerAllocator> >::other > bodies_list; 00112 00113 00114 ROS_DEPRECATED uint32_t get_bodies_list_size() const { return (uint32_t)bodies_list.size(); } 00115 ROS_DEPRECATED void set_bodies_list_size(uint32_t size) { bodies_list.resize((size_t)size); } 00116 ROS_DEPRECATED void get_bodies_list_vec(std::vector< ::geometry_msgs::Pose_<ContainerAllocator> , typename ContainerAllocator::template rebind< ::geometry_msgs::Pose_<ContainerAllocator> >::other > & vec) const { vec = this->bodies_list; } 00117 ROS_DEPRECATED void set_bodies_list_vec(const std::vector< ::geometry_msgs::Pose_<ContainerAllocator> , typename ContainerAllocator::template rebind< ::geometry_msgs::Pose_<ContainerAllocator> >::other > & vec) { this->bodies_list = vec; } 00118 private: 00119 static const char* __s_getDataType_() { return "srs_body_detector/getBodyDetectionsResponse"; } 00120 public: 00121 ROS_DEPRECATED static const std::string __s_getDataType() { return __s_getDataType_(); } 00122 00123 ROS_DEPRECATED const std::string __getDataType() const { return __s_getDataType_(); } 00124 00125 private: 00126 static const char* __s_getMD5Sum_() { return "240e092e1ab6f63df32eca12154e1a3f"; } 00127 public: 00128 ROS_DEPRECATED static const std::string __s_getMD5Sum() { return __s_getMD5Sum_(); } 00129 00130 ROS_DEPRECATED const std::string __getMD5Sum() const { return __s_getMD5Sum_(); } 00131 00132 private: 00133 static const char* __s_getServerMD5Sum_() { return "240e092e1ab6f63df32eca12154e1a3f"; } 00134 public: 00135 ROS_DEPRECATED static const std::string __s_getServerMD5Sum() { return __s_getServerMD5Sum_(); } 00136 00137 ROS_DEPRECATED const std::string __getServerMD5Sum() const { return __s_getServerMD5Sum_(); } 00138 00139 private: 00140 static const char* __s_getMessageDefinition_() { return "\n\ 00141 geometry_msgs/Pose[] bodies_list\n\ 00142 \n\ 00143 \n\ 00144 ================================================================================\n\ 00145 MSG: geometry_msgs/Pose\n\ 00146 # A representation of pose in free space, composed of postion and orientation. \n\ 00147 Point position\n\ 00148 Quaternion orientation\n\ 00149 \n\ 00150 ================================================================================\n\ 00151 MSG: geometry_msgs/Point\n\ 00152 # This contains the position of a point in free space\n\ 00153 float64 x\n\ 00154 float64 y\n\ 00155 float64 z\n\ 00156 \n\ 00157 ================================================================================\n\ 00158 MSG: geometry_msgs/Quaternion\n\ 00159 # This represents an orientation in free space in quaternion form.\n\ 00160 \n\ 00161 float64 x\n\ 00162 float64 y\n\ 00163 float64 z\n\ 00164 float64 w\n\ 00165 \n\ 00166 "; } 00167 public: 00168 ROS_DEPRECATED static const std::string __s_getMessageDefinition() { return __s_getMessageDefinition_(); } 00169 00170 ROS_DEPRECATED const std::string __getMessageDefinition() const { return __s_getMessageDefinition_(); } 00171 00172 ROS_DEPRECATED virtual uint8_t *serialize(uint8_t *write_ptr, uint32_t seq) const 00173 { 00174 ros::serialization::OStream stream(write_ptr, 1000000000); 00175 ros::serialization::serialize(stream, bodies_list); 00176 return stream.getData(); 00177 } 00178 00179 ROS_DEPRECATED virtual uint8_t *deserialize(uint8_t *read_ptr) 00180 { 00181 ros::serialization::IStream stream(read_ptr, 1000000000); 00182 ros::serialization::deserialize(stream, bodies_list); 00183 return stream.getData(); 00184 } 00185 00186 ROS_DEPRECATED virtual uint32_t serializationLength() const 00187 { 00188 uint32_t size = 0; 00189 size += ros::serialization::serializationLength(bodies_list); 00190 return size; 00191 } 00192 00193 typedef boost::shared_ptr< ::srs_body_detector::getBodyDetectionsResponse_<ContainerAllocator> > Ptr; 00194 typedef boost::shared_ptr< ::srs_body_detector::getBodyDetectionsResponse_<ContainerAllocator> const> ConstPtr; 00195 boost::shared_ptr<std::map<std::string, std::string> > __connection_header; 00196 }; // struct getBodyDetectionsResponse 00197 typedef ::srs_body_detector::getBodyDetectionsResponse_<std::allocator<void> > getBodyDetectionsResponse; 00198 00199 typedef boost::shared_ptr< ::srs_body_detector::getBodyDetectionsResponse> getBodyDetectionsResponsePtr; 00200 typedef boost::shared_ptr< ::srs_body_detector::getBodyDetectionsResponse const> getBodyDetectionsResponseConstPtr; 00201 00202 struct getBodyDetections 00203 { 00204 00205 typedef getBodyDetectionsRequest Request; 00206 typedef getBodyDetectionsResponse Response; 00207 Request request; 00208 Response response; 00209 00210 typedef Request RequestType; 00211 typedef Response ResponseType; 00212 }; // struct getBodyDetections 00213 } // namespace srs_body_detector 00214 00215 namespace ros 00216 { 00217 namespace message_traits 00218 { 00219 template<class ContainerAllocator> struct IsMessage< ::srs_body_detector::getBodyDetectionsRequest_<ContainerAllocator> > : public TrueType {}; 00220 template<class ContainerAllocator> struct IsMessage< ::srs_body_detector::getBodyDetectionsRequest_<ContainerAllocator> const> : public TrueType {}; 00221 template<class ContainerAllocator> 00222 struct MD5Sum< ::srs_body_detector::getBodyDetectionsRequest_<ContainerAllocator> > { 00223 static const char* value() 00224 { 00225 return "d41d8cd98f00b204e9800998ecf8427e"; 00226 } 00227 00228 static const char* value(const ::srs_body_detector::getBodyDetectionsRequest_<ContainerAllocator> &) { return value(); } 00229 static const uint64_t static_value1 = 0xd41d8cd98f00b204ULL; 00230 static const uint64_t static_value2 = 0xe9800998ecf8427eULL; 00231 }; 00232 00233 template<class ContainerAllocator> 00234 struct DataType< ::srs_body_detector::getBodyDetectionsRequest_<ContainerAllocator> > { 00235 static const char* value() 00236 { 00237 return "srs_body_detector/getBodyDetectionsRequest"; 00238 } 00239 00240 static const char* value(const ::srs_body_detector::getBodyDetectionsRequest_<ContainerAllocator> &) { return value(); } 00241 }; 00242 00243 template<class ContainerAllocator> 00244 struct Definition< ::srs_body_detector::getBodyDetectionsRequest_<ContainerAllocator> > { 00245 static const char* value() 00246 { 00247 return "\n\ 00248 \n\ 00249 "; 00250 } 00251 00252 static const char* value(const ::srs_body_detector::getBodyDetectionsRequest_<ContainerAllocator> &) { return value(); } 00253 }; 00254 00255 template<class ContainerAllocator> struct IsFixedSize< ::srs_body_detector::getBodyDetectionsRequest_<ContainerAllocator> > : public TrueType {}; 00256 } // namespace message_traits 00257 } // namespace ros 00258 00259 00260 namespace ros 00261 { 00262 namespace message_traits 00263 { 00264 template<class ContainerAllocator> struct IsMessage< ::srs_body_detector::getBodyDetectionsResponse_<ContainerAllocator> > : public TrueType {}; 00265 template<class ContainerAllocator> struct IsMessage< ::srs_body_detector::getBodyDetectionsResponse_<ContainerAllocator> const> : public TrueType {}; 00266 template<class ContainerAllocator> 00267 struct MD5Sum< ::srs_body_detector::getBodyDetectionsResponse_<ContainerAllocator> > { 00268 static const char* value() 00269 { 00270 return "240e092e1ab6f63df32eca12154e1a3f"; 00271 } 00272 00273 static const char* value(const ::srs_body_detector::getBodyDetectionsResponse_<ContainerAllocator> &) { return value(); } 00274 static const uint64_t static_value1 = 0x240e092e1ab6f63dULL; 00275 static const uint64_t static_value2 = 0xf32eca12154e1a3fULL; 00276 }; 00277 00278 template<class ContainerAllocator> 00279 struct DataType< ::srs_body_detector::getBodyDetectionsResponse_<ContainerAllocator> > { 00280 static const char* value() 00281 { 00282 return "srs_body_detector/getBodyDetectionsResponse"; 00283 } 00284 00285 static const char* value(const ::srs_body_detector::getBodyDetectionsResponse_<ContainerAllocator> &) { return value(); } 00286 }; 00287 00288 template<class ContainerAllocator> 00289 struct Definition< ::srs_body_detector::getBodyDetectionsResponse_<ContainerAllocator> > { 00290 static const char* value() 00291 { 00292 return "\n\ 00293 geometry_msgs/Pose[] bodies_list\n\ 00294 \n\ 00295 \n\ 00296 ================================================================================\n\ 00297 MSG: geometry_msgs/Pose\n\ 00298 # A representation of pose in free space, composed of postion and orientation. \n\ 00299 Point position\n\ 00300 Quaternion orientation\n\ 00301 \n\ 00302 ================================================================================\n\ 00303 MSG: geometry_msgs/Point\n\ 00304 # This contains the position of a point in free space\n\ 00305 float64 x\n\ 00306 float64 y\n\ 00307 float64 z\n\ 00308 \n\ 00309 ================================================================================\n\ 00310 MSG: geometry_msgs/Quaternion\n\ 00311 # This represents an orientation in free space in quaternion form.\n\ 00312 \n\ 00313 float64 x\n\ 00314 float64 y\n\ 00315 float64 z\n\ 00316 float64 w\n\ 00317 \n\ 00318 "; 00319 } 00320 00321 static const char* value(const ::srs_body_detector::getBodyDetectionsResponse_<ContainerAllocator> &) { return value(); } 00322 }; 00323 00324 } // namespace message_traits 00325 } // namespace ros 00326 00327 namespace ros 00328 { 00329 namespace serialization 00330 { 00331 00332 template<class ContainerAllocator> struct Serializer< ::srs_body_detector::getBodyDetectionsRequest_<ContainerAllocator> > 00333 { 00334 template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m) 00335 { 00336 } 00337 00338 ROS_DECLARE_ALLINONE_SERIALIZER; 00339 }; // struct getBodyDetectionsRequest_ 00340 } // namespace serialization 00341 } // namespace ros 00342 00343 00344 namespace ros 00345 { 00346 namespace serialization 00347 { 00348 00349 template<class ContainerAllocator> struct Serializer< ::srs_body_detector::getBodyDetectionsResponse_<ContainerAllocator> > 00350 { 00351 template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m) 00352 { 00353 stream.next(m.bodies_list); 00354 } 00355 00356 ROS_DECLARE_ALLINONE_SERIALIZER; 00357 }; // struct getBodyDetectionsResponse_ 00358 } // namespace serialization 00359 } // namespace ros 00360 00361 namespace ros 00362 { 00363 namespace service_traits 00364 { 00365 template<> 00366 struct MD5Sum<srs_body_detector::getBodyDetections> { 00367 static const char* value() 00368 { 00369 return "240e092e1ab6f63df32eca12154e1a3f"; 00370 } 00371 00372 static const char* value(const srs_body_detector::getBodyDetections&) { return value(); } 00373 }; 00374 00375 template<> 00376 struct DataType<srs_body_detector::getBodyDetections> { 00377 static const char* value() 00378 { 00379 return "srs_body_detector/getBodyDetections"; 00380 } 00381 00382 static const char* value(const srs_body_detector::getBodyDetections&) { return value(); } 00383 }; 00384 00385 template<class ContainerAllocator> 00386 struct MD5Sum<srs_body_detector::getBodyDetectionsRequest_<ContainerAllocator> > { 00387 static const char* value() 00388 { 00389 return "240e092e1ab6f63df32eca12154e1a3f"; 00390 } 00391 00392 static const char* value(const srs_body_detector::getBodyDetectionsRequest_<ContainerAllocator> &) { return value(); } 00393 }; 00394 00395 template<class ContainerAllocator> 00396 struct DataType<srs_body_detector::getBodyDetectionsRequest_<ContainerAllocator> > { 00397 static const char* value() 00398 { 00399 return "srs_body_detector/getBodyDetections"; 00400 } 00401 00402 static const char* value(const srs_body_detector::getBodyDetectionsRequest_<ContainerAllocator> &) { return value(); } 00403 }; 00404 00405 template<class ContainerAllocator> 00406 struct MD5Sum<srs_body_detector::getBodyDetectionsResponse_<ContainerAllocator> > { 00407 static const char* value() 00408 { 00409 return "240e092e1ab6f63df32eca12154e1a3f"; 00410 } 00411 00412 static const char* value(const srs_body_detector::getBodyDetectionsResponse_<ContainerAllocator> &) { return value(); } 00413 }; 00414 00415 template<class ContainerAllocator> 00416 struct DataType<srs_body_detector::getBodyDetectionsResponse_<ContainerAllocator> > { 00417 static const char* value() 00418 { 00419 return "srs_body_detector/getBodyDetections"; 00420 } 00421 00422 static const char* value(const srs_body_detector::getBodyDetectionsResponse_<ContainerAllocator> &) { return value(); } 00423 }; 00424 00425 } // namespace service_traits 00426 } // namespace ros 00427 00428 #endif // SRS_BODY_DETECTOR_SERVICE_GETBODYDETECTIONS_H 00429