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