00001
00002 #ifndef GRAPH_MAPPING_MSGS_SERVICE_GETPOSES_H
00003 #define GRAPH_MAPPING_MSGS_SERVICE_GETPOSES_H
00004 #include <string>
00005 #include <vector>
00006 #include <ostream>
00007 #include "ros/serialization.h"
00008 #include "ros/builtin_message_traits.h"
00009 #include "ros/message_operations.h"
00010 #include "ros/message.h"
00011 #include "ros/time.h"
00012
00013 #include "ros/service_traits.h"
00014
00015
00016
00017 #include "geometry_msgs/Pose.h"
00018
00019 namespace graph_mapping_msgs
00020 {
00021 template <class ContainerAllocator>
00022 struct GetPosesRequest_ : public ros::Message
00023 {
00024 typedef GetPosesRequest_<ContainerAllocator> Type;
00025
00026 GetPosesRequest_()
00027 : nodes()
00028 {
00029 }
00030
00031 GetPosesRequest_(const ContainerAllocator& _alloc)
00032 : nodes(_alloc)
00033 {
00034 }
00035
00036 typedef std::vector<uint32_t, typename ContainerAllocator::template rebind<uint32_t>::other > _nodes_type;
00037 std::vector<uint32_t, typename ContainerAllocator::template rebind<uint32_t>::other > nodes;
00038
00039
00040 ROS_DEPRECATED uint32_t get_nodes_size() const { return (uint32_t)nodes.size(); }
00041 ROS_DEPRECATED void set_nodes_size(uint32_t size) { nodes.resize((size_t)size); }
00042 ROS_DEPRECATED void get_nodes_vec(std::vector<uint32_t, typename ContainerAllocator::template rebind<uint32_t>::other > & vec) const { vec = this->nodes; }
00043 ROS_DEPRECATED void set_nodes_vec(const std::vector<uint32_t, typename ContainerAllocator::template rebind<uint32_t>::other > & vec) { this->nodes = vec; }
00044 private:
00045 static const char* __s_getDataType_() { return "graph_mapping_msgs/GetPosesRequest"; }
00046 public:
00047 ROS_DEPRECATED static const std::string __s_getDataType() { return __s_getDataType_(); }
00048
00049 ROS_DEPRECATED const std::string __getDataType() const { return __s_getDataType_(); }
00050
00051 private:
00052 static const char* __s_getMD5Sum_() { return "8822a3644f690455b925fa86611b6024"; }
00053 public:
00054 ROS_DEPRECATED static const std::string __s_getMD5Sum() { return __s_getMD5Sum_(); }
00055
00056 ROS_DEPRECATED const std::string __getMD5Sum() const { return __s_getMD5Sum_(); }
00057
00058 private:
00059 static const char* __s_getServerMD5Sum_() { return "14eb1b62976c50381cfc89a7266aa1d5"; }
00060 public:
00061 ROS_DEPRECATED static const std::string __s_getServerMD5Sum() { return __s_getServerMD5Sum_(); }
00062
00063 ROS_DEPRECATED const std::string __getServerMD5Sum() const { return __s_getServerMD5Sum_(); }
00064
00065 private:
00066 static const char* __s_getMessageDefinition_() { return "\n\
00067 \n\
00068 uint32[] nodes\n\
00069 \n\
00070 "; }
00071 public:
00072 ROS_DEPRECATED static const std::string __s_getMessageDefinition() { return __s_getMessageDefinition_(); }
00073
00074 ROS_DEPRECATED const std::string __getMessageDefinition() const { return __s_getMessageDefinition_(); }
00075
00076 ROS_DEPRECATED virtual uint8_t *serialize(uint8_t *write_ptr, uint32_t seq) const
00077 {
00078 ros::serialization::OStream stream(write_ptr, 1000000000);
00079 ros::serialization::serialize(stream, nodes);
00080 return stream.getData();
00081 }
00082
00083 ROS_DEPRECATED virtual uint8_t *deserialize(uint8_t *read_ptr)
00084 {
00085 ros::serialization::IStream stream(read_ptr, 1000000000);
00086 ros::serialization::deserialize(stream, nodes);
00087 return stream.getData();
00088 }
00089
00090 ROS_DEPRECATED virtual uint32_t serializationLength() const
00091 {
00092 uint32_t size = 0;
00093 size += ros::serialization::serializationLength(nodes);
00094 return size;
00095 }
00096
00097 typedef boost::shared_ptr< ::graph_mapping_msgs::GetPosesRequest_<ContainerAllocator> > Ptr;
00098 typedef boost::shared_ptr< ::graph_mapping_msgs::GetPosesRequest_<ContainerAllocator> const> ConstPtr;
00099 };
00100 typedef ::graph_mapping_msgs::GetPosesRequest_<std::allocator<void> > GetPosesRequest;
00101
00102 typedef boost::shared_ptr< ::graph_mapping_msgs::GetPosesRequest> GetPosesRequestPtr;
00103 typedef boost::shared_ptr< ::graph_mapping_msgs::GetPosesRequest const> GetPosesRequestConstPtr;
00104
00105
00106 template <class ContainerAllocator>
00107 struct GetPosesResponse_ : public ros::Message
00108 {
00109 typedef GetPosesResponse_<ContainerAllocator> Type;
00110
00111 GetPosesResponse_()
00112 : error_code(0)
00113 , error_msg()
00114 , poses()
00115 {
00116 }
00117
00118 GetPosesResponse_(const ContainerAllocator& _alloc)
00119 : error_code(0)
00120 , error_msg(_alloc)
00121 , poses(_alloc)
00122 {
00123 }
00124
00125 typedef uint8_t _error_code_type;
00126 uint8_t error_code;
00127
00128 typedef std::basic_string<char, std::char_traits<char>, typename ContainerAllocator::template rebind<char>::other > _error_msg_type;
00129 std::basic_string<char, std::char_traits<char>, typename ContainerAllocator::template rebind<char>::other > error_msg;
00130
00131 typedef std::vector< ::geometry_msgs::Pose_<ContainerAllocator> , typename ContainerAllocator::template rebind< ::geometry_msgs::Pose_<ContainerAllocator> >::other > _poses_type;
00132 std::vector< ::geometry_msgs::Pose_<ContainerAllocator> , typename ContainerAllocator::template rebind< ::geometry_msgs::Pose_<ContainerAllocator> >::other > poses;
00133
00134 enum { SUCCESS = 0 };
00135 enum { DISCONNECTED_NODES = 1 };
00136 enum { UNKNOWN_NODES = 2 };
00137 enum { EMPTY_NODE_SET = 3 };
00138
00139 ROS_DEPRECATED uint32_t get_poses_size() const { return (uint32_t)poses.size(); }
00140 ROS_DEPRECATED void set_poses_size(uint32_t size) { poses.resize((size_t)size); }
00141 ROS_DEPRECATED void get_poses_vec(std::vector< ::geometry_msgs::Pose_<ContainerAllocator> , typename ContainerAllocator::template rebind< ::geometry_msgs::Pose_<ContainerAllocator> >::other > & vec) const { vec = this->poses; }
00142 ROS_DEPRECATED void set_poses_vec(const std::vector< ::geometry_msgs::Pose_<ContainerAllocator> , typename ContainerAllocator::template rebind< ::geometry_msgs::Pose_<ContainerAllocator> >::other > & vec) { this->poses = vec; }
00143 private:
00144 static const char* __s_getDataType_() { return "graph_mapping_msgs/GetPosesResponse"; }
00145 public:
00146 ROS_DEPRECATED static const std::string __s_getDataType() { return __s_getDataType_(); }
00147
00148 ROS_DEPRECATED const std::string __getDataType() const { return __s_getDataType_(); }
00149
00150 private:
00151 static const char* __s_getMD5Sum_() { return "684c39e2d774e03c12c8de35a0b4ecd5"; }
00152 public:
00153 ROS_DEPRECATED static const std::string __s_getMD5Sum() { return __s_getMD5Sum_(); }
00154
00155 ROS_DEPRECATED const std::string __getMD5Sum() const { return __s_getMD5Sum_(); }
00156
00157 private:
00158 static const char* __s_getServerMD5Sum_() { return "14eb1b62976c50381cfc89a7266aa1d5"; }
00159 public:
00160 ROS_DEPRECATED static const std::string __s_getServerMD5Sum() { return __s_getServerMD5Sum_(); }
00161
00162 ROS_DEPRECATED const std::string __getServerMD5Sum() const { return __s_getServerMD5Sum_(); }
00163
00164 private:
00165 static const char* __s_getMessageDefinition_() { return "uint8 error_code\n\
00166 string error_msg\n\
00167 \n\
00168 \n\
00169 \n\
00170 geometry_msgs/Pose[] poses\n\
00171 \n\
00172 \n\
00173 uint8 SUCCESS=0\n\
00174 uint8 DISCONNECTED_NODES=1\n\
00175 uint8 UNKNOWN_NODES=2\n\
00176 uint8 EMPTY_NODE_SET=3\n\
00177 \n\
00178 ================================================================================\n\
00179 MSG: geometry_msgs/Pose\n\
00180 # A representation of pose in free space, composed of postion and orientation. \n\
00181 Point position\n\
00182 Quaternion orientation\n\
00183 \n\
00184 ================================================================================\n\
00185 MSG: geometry_msgs/Point\n\
00186 # This contains the position of a point in free space\n\
00187 float64 x\n\
00188 float64 y\n\
00189 float64 z\n\
00190 \n\
00191 ================================================================================\n\
00192 MSG: geometry_msgs/Quaternion\n\
00193 # This represents an orientation in free space in quaternion form.\n\
00194 \n\
00195 float64 x\n\
00196 float64 y\n\
00197 float64 z\n\
00198 float64 w\n\
00199 \n\
00200 "; }
00201 public:
00202 ROS_DEPRECATED static const std::string __s_getMessageDefinition() { return __s_getMessageDefinition_(); }
00203
00204 ROS_DEPRECATED const std::string __getMessageDefinition() const { return __s_getMessageDefinition_(); }
00205
00206 ROS_DEPRECATED virtual uint8_t *serialize(uint8_t *write_ptr, uint32_t seq) const
00207 {
00208 ros::serialization::OStream stream(write_ptr, 1000000000);
00209 ros::serialization::serialize(stream, error_code);
00210 ros::serialization::serialize(stream, error_msg);
00211 ros::serialization::serialize(stream, poses);
00212 return stream.getData();
00213 }
00214
00215 ROS_DEPRECATED virtual uint8_t *deserialize(uint8_t *read_ptr)
00216 {
00217 ros::serialization::IStream stream(read_ptr, 1000000000);
00218 ros::serialization::deserialize(stream, error_code);
00219 ros::serialization::deserialize(stream, error_msg);
00220 ros::serialization::deserialize(stream, poses);
00221 return stream.getData();
00222 }
00223
00224 ROS_DEPRECATED virtual uint32_t serializationLength() const
00225 {
00226 uint32_t size = 0;
00227 size += ros::serialization::serializationLength(error_code);
00228 size += ros::serialization::serializationLength(error_msg);
00229 size += ros::serialization::serializationLength(poses);
00230 return size;
00231 }
00232
00233 typedef boost::shared_ptr< ::graph_mapping_msgs::GetPosesResponse_<ContainerAllocator> > Ptr;
00234 typedef boost::shared_ptr< ::graph_mapping_msgs::GetPosesResponse_<ContainerAllocator> const> ConstPtr;
00235 };
00236 typedef ::graph_mapping_msgs::GetPosesResponse_<std::allocator<void> > GetPosesResponse;
00237
00238 typedef boost::shared_ptr< ::graph_mapping_msgs::GetPosesResponse> GetPosesResponsePtr;
00239 typedef boost::shared_ptr< ::graph_mapping_msgs::GetPosesResponse const> GetPosesResponseConstPtr;
00240
00241 struct GetPoses
00242 {
00243
00244 typedef GetPosesRequest Request;
00245 typedef GetPosesResponse Response;
00246 Request request;
00247 Response response;
00248
00249 typedef Request RequestType;
00250 typedef Response ResponseType;
00251 };
00252 }
00253
00254 namespace ros
00255 {
00256 namespace message_traits
00257 {
00258 template<class ContainerAllocator>
00259 struct MD5Sum< ::graph_mapping_msgs::GetPosesRequest_<ContainerAllocator> > {
00260 static const char* value()
00261 {
00262 return "8822a3644f690455b925fa86611b6024";
00263 }
00264
00265 static const char* value(const ::graph_mapping_msgs::GetPosesRequest_<ContainerAllocator> &) { return value(); }
00266 static const uint64_t static_value1 = 0x8822a3644f690455ULL;
00267 static const uint64_t static_value2 = 0xb925fa86611b6024ULL;
00268 };
00269
00270 template<class ContainerAllocator>
00271 struct DataType< ::graph_mapping_msgs::GetPosesRequest_<ContainerAllocator> > {
00272 static const char* value()
00273 {
00274 return "graph_mapping_msgs/GetPosesRequest";
00275 }
00276
00277 static const char* value(const ::graph_mapping_msgs::GetPosesRequest_<ContainerAllocator> &) { return value(); }
00278 };
00279
00280 template<class ContainerAllocator>
00281 struct Definition< ::graph_mapping_msgs::GetPosesRequest_<ContainerAllocator> > {
00282 static const char* value()
00283 {
00284 return "\n\
00285 \n\
00286 uint32[] nodes\n\
00287 \n\
00288 ";
00289 }
00290
00291 static const char* value(const ::graph_mapping_msgs::GetPosesRequest_<ContainerAllocator> &) { return value(); }
00292 };
00293
00294 }
00295 }
00296
00297
00298 namespace ros
00299 {
00300 namespace message_traits
00301 {
00302 template<class ContainerAllocator>
00303 struct MD5Sum< ::graph_mapping_msgs::GetPosesResponse_<ContainerAllocator> > {
00304 static const char* value()
00305 {
00306 return "684c39e2d774e03c12c8de35a0b4ecd5";
00307 }
00308
00309 static const char* value(const ::graph_mapping_msgs::GetPosesResponse_<ContainerAllocator> &) { return value(); }
00310 static const uint64_t static_value1 = 0x684c39e2d774e03cULL;
00311 static const uint64_t static_value2 = 0x12c8de35a0b4ecd5ULL;
00312 };
00313
00314 template<class ContainerAllocator>
00315 struct DataType< ::graph_mapping_msgs::GetPosesResponse_<ContainerAllocator> > {
00316 static const char* value()
00317 {
00318 return "graph_mapping_msgs/GetPosesResponse";
00319 }
00320
00321 static const char* value(const ::graph_mapping_msgs::GetPosesResponse_<ContainerAllocator> &) { return value(); }
00322 };
00323
00324 template<class ContainerAllocator>
00325 struct Definition< ::graph_mapping_msgs::GetPosesResponse_<ContainerAllocator> > {
00326 static const char* value()
00327 {
00328 return "uint8 error_code\n\
00329 string error_msg\n\
00330 \n\
00331 \n\
00332 \n\
00333 geometry_msgs/Pose[] poses\n\
00334 \n\
00335 \n\
00336 uint8 SUCCESS=0\n\
00337 uint8 DISCONNECTED_NODES=1\n\
00338 uint8 UNKNOWN_NODES=2\n\
00339 uint8 EMPTY_NODE_SET=3\n\
00340 \n\
00341 ================================================================================\n\
00342 MSG: geometry_msgs/Pose\n\
00343 # A representation of pose in free space, composed of postion and orientation. \n\
00344 Point position\n\
00345 Quaternion orientation\n\
00346 \n\
00347 ================================================================================\n\
00348 MSG: geometry_msgs/Point\n\
00349 # This contains the position of a point in free space\n\
00350 float64 x\n\
00351 float64 y\n\
00352 float64 z\n\
00353 \n\
00354 ================================================================================\n\
00355 MSG: geometry_msgs/Quaternion\n\
00356 # This represents an orientation in free space in quaternion form.\n\
00357 \n\
00358 float64 x\n\
00359 float64 y\n\
00360 float64 z\n\
00361 float64 w\n\
00362 \n\
00363 ";
00364 }
00365
00366 static const char* value(const ::graph_mapping_msgs::GetPosesResponse_<ContainerAllocator> &) { return value(); }
00367 };
00368
00369 }
00370 }
00371
00372 namespace ros
00373 {
00374 namespace serialization
00375 {
00376
00377 template<class ContainerAllocator> struct Serializer< ::graph_mapping_msgs::GetPosesRequest_<ContainerAllocator> >
00378 {
00379 template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m)
00380 {
00381 stream.next(m.nodes);
00382 }
00383
00384 ROS_DECLARE_ALLINONE_SERIALIZER;
00385 };
00386 }
00387 }
00388
00389
00390 namespace ros
00391 {
00392 namespace serialization
00393 {
00394
00395 template<class ContainerAllocator> struct Serializer< ::graph_mapping_msgs::GetPosesResponse_<ContainerAllocator> >
00396 {
00397 template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m)
00398 {
00399 stream.next(m.error_code);
00400 stream.next(m.error_msg);
00401 stream.next(m.poses);
00402 }
00403
00404 ROS_DECLARE_ALLINONE_SERIALIZER;
00405 };
00406 }
00407 }
00408
00409 namespace ros
00410 {
00411 namespace service_traits
00412 {
00413 template<>
00414 struct MD5Sum<graph_mapping_msgs::GetPoses> {
00415 static const char* value()
00416 {
00417 return "14eb1b62976c50381cfc89a7266aa1d5";
00418 }
00419
00420 static const char* value(const graph_mapping_msgs::GetPoses&) { return value(); }
00421 };
00422
00423 template<>
00424 struct DataType<graph_mapping_msgs::GetPoses> {
00425 static const char* value()
00426 {
00427 return "graph_mapping_msgs/GetPoses";
00428 }
00429
00430 static const char* value(const graph_mapping_msgs::GetPoses&) { return value(); }
00431 };
00432
00433 template<class ContainerAllocator>
00434 struct MD5Sum<graph_mapping_msgs::GetPosesRequest_<ContainerAllocator> > {
00435 static const char* value()
00436 {
00437 return "14eb1b62976c50381cfc89a7266aa1d5";
00438 }
00439
00440 static const char* value(const graph_mapping_msgs::GetPosesRequest_<ContainerAllocator> &) { return value(); }
00441 };
00442
00443 template<class ContainerAllocator>
00444 struct DataType<graph_mapping_msgs::GetPosesRequest_<ContainerAllocator> > {
00445 static const char* value()
00446 {
00447 return "graph_mapping_msgs/GetPoses";
00448 }
00449
00450 static const char* value(const graph_mapping_msgs::GetPosesRequest_<ContainerAllocator> &) { return value(); }
00451 };
00452
00453 template<class ContainerAllocator>
00454 struct MD5Sum<graph_mapping_msgs::GetPosesResponse_<ContainerAllocator> > {
00455 static const char* value()
00456 {
00457 return "14eb1b62976c50381cfc89a7266aa1d5";
00458 }
00459
00460 static const char* value(const graph_mapping_msgs::GetPosesResponse_<ContainerAllocator> &) { return value(); }
00461 };
00462
00463 template<class ContainerAllocator>
00464 struct DataType<graph_mapping_msgs::GetPosesResponse_<ContainerAllocator> > {
00465 static const char* value()
00466 {
00467 return "graph_mapping_msgs/GetPoses";
00468 }
00469
00470 static const char* value(const graph_mapping_msgs::GetPosesResponse_<ContainerAllocator> &) { return value(); }
00471 };
00472
00473 }
00474 }
00475
00476 #endif // GRAPH_MAPPING_MSGS_SERVICE_GETPOSES_H
00477