$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_symbolic_grounding/srv/SymbolGroundingGraspBaseRegion.srv */ 00002 #ifndef SRS_SYMBOLIC_GROUNDING_SERVICE_SYMBOLGROUNDINGGRASPBASEREGION_H 00003 #define SRS_SYMBOLIC_GROUNDING_SERVICE_SYMBOLGROUNDINGGRASPBASEREGION_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/Pose.h" 00020 #include "srs_msgs/SRSSpatialInfo.h" 00021 #include "srs_msgs/SRSSpatialInfo.h" 00022 00023 00024 #include "geometry_msgs/Pose2D.h" 00025 00026 namespace srs_symbolic_grounding 00027 { 00028 template <class ContainerAllocator> 00029 struct SymbolGroundingGraspBaseRegionRequest_ { 00030 typedef SymbolGroundingGraspBaseRegionRequest_<ContainerAllocator> Type; 00031 00032 SymbolGroundingGraspBaseRegionRequest_() 00033 : target_obj_pose() 00034 , parent_obj_geometry() 00035 , furniture_geometry_list() 00036 { 00037 } 00038 00039 SymbolGroundingGraspBaseRegionRequest_(const ContainerAllocator& _alloc) 00040 : target_obj_pose(_alloc) 00041 , parent_obj_geometry(_alloc) 00042 , furniture_geometry_list(_alloc) 00043 { 00044 } 00045 00046 typedef ::geometry_msgs::Pose_<ContainerAllocator> _target_obj_pose_type; 00047 ::geometry_msgs::Pose_<ContainerAllocator> target_obj_pose; 00048 00049 typedef ::srs_msgs::SRSSpatialInfo_<ContainerAllocator> _parent_obj_geometry_type; 00050 ::srs_msgs::SRSSpatialInfo_<ContainerAllocator> parent_obj_geometry; 00051 00052 typedef std::vector< ::srs_msgs::SRSSpatialInfo_<ContainerAllocator> , typename ContainerAllocator::template rebind< ::srs_msgs::SRSSpatialInfo_<ContainerAllocator> >::other > _furniture_geometry_list_type; 00053 std::vector< ::srs_msgs::SRSSpatialInfo_<ContainerAllocator> , typename ContainerAllocator::template rebind< ::srs_msgs::SRSSpatialInfo_<ContainerAllocator> >::other > furniture_geometry_list; 00054 00055 00056 ROS_DEPRECATED uint32_t get_furniture_geometry_list_size() const { return (uint32_t)furniture_geometry_list.size(); } 00057 ROS_DEPRECATED void set_furniture_geometry_list_size(uint32_t size) { furniture_geometry_list.resize((size_t)size); } 00058 ROS_DEPRECATED void get_furniture_geometry_list_vec(std::vector< ::srs_msgs::SRSSpatialInfo_<ContainerAllocator> , typename ContainerAllocator::template rebind< ::srs_msgs::SRSSpatialInfo_<ContainerAllocator> >::other > & vec) const { vec = this->furniture_geometry_list; } 00059 ROS_DEPRECATED void set_furniture_geometry_list_vec(const std::vector< ::srs_msgs::SRSSpatialInfo_<ContainerAllocator> , typename ContainerAllocator::template rebind< ::srs_msgs::SRSSpatialInfo_<ContainerAllocator> >::other > & vec) { this->furniture_geometry_list = vec; } 00060 private: 00061 static const char* __s_getDataType_() { return "srs_symbolic_grounding/SymbolGroundingGraspBaseRegionRequest"; } 00062 public: 00063 ROS_DEPRECATED static const std::string __s_getDataType() { return __s_getDataType_(); } 00064 00065 ROS_DEPRECATED const std::string __getDataType() const { return __s_getDataType_(); } 00066 00067 private: 00068 static const char* __s_getMD5Sum_() { return "929217c873801a8d83a0ef0a0ff55374"; } 00069 public: 00070 ROS_DEPRECATED static const std::string __s_getMD5Sum() { return __s_getMD5Sum_(); } 00071 00072 ROS_DEPRECATED const std::string __getMD5Sum() const { return __s_getMD5Sum_(); } 00073 00074 private: 00075 static const char* __s_getServerMD5Sum_() { return "85656dac540bfd2cc20973338dc0825b"; } 00076 public: 00077 ROS_DEPRECATED static const std::string __s_getServerMD5Sum() { return __s_getServerMD5Sum_(); } 00078 00079 ROS_DEPRECATED const std::string __getServerMD5Sum() const { return __s_getServerMD5Sum_(); } 00080 00081 private: 00082 static const char* __s_getMessageDefinition_() { return "geometry_msgs/Pose target_obj_pose\n\ 00083 \n\ 00084 \n\ 00085 srs_msgs/SRSSpatialInfo parent_obj_geometry\n\ 00086 srs_msgs/SRSSpatialInfo[] furniture_geometry_list\n\ 00087 \n\ 00088 ================================================================================\n\ 00089 MSG: geometry_msgs/Pose\n\ 00090 # A representation of pose in free space, composed of postion and orientation. \n\ 00091 Point position\n\ 00092 Quaternion orientation\n\ 00093 \n\ 00094 ================================================================================\n\ 00095 MSG: geometry_msgs/Point\n\ 00096 # This contains the position of a point in free space\n\ 00097 float64 x\n\ 00098 float64 y\n\ 00099 float64 z\n\ 00100 \n\ 00101 ================================================================================\n\ 00102 MSG: geometry_msgs/Quaternion\n\ 00103 # This represents an orientation in free space in quaternion form.\n\ 00104 \n\ 00105 float64 x\n\ 00106 float64 y\n\ 00107 float64 z\n\ 00108 float64 w\n\ 00109 \n\ 00110 ================================================================================\n\ 00111 MSG: srs_msgs/SRSSpatialInfo\n\ 00112 # Point point\n\ 00113 # Orientation angles\n\ 00114 float32 l\n\ 00115 float32 w\n\ 00116 float32 h\n\ 00117 \n\ 00118 geometry_msgs/Pose pose\n\ 00119 \n\ 00120 "; } 00121 public: 00122 ROS_DEPRECATED static const std::string __s_getMessageDefinition() { return __s_getMessageDefinition_(); } 00123 00124 ROS_DEPRECATED const std::string __getMessageDefinition() const { return __s_getMessageDefinition_(); } 00125 00126 ROS_DEPRECATED virtual uint8_t *serialize(uint8_t *write_ptr, uint32_t seq) const 00127 { 00128 ros::serialization::OStream stream(write_ptr, 1000000000); 00129 ros::serialization::serialize(stream, target_obj_pose); 00130 ros::serialization::serialize(stream, parent_obj_geometry); 00131 ros::serialization::serialize(stream, furniture_geometry_list); 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, target_obj_pose); 00139 ros::serialization::deserialize(stream, parent_obj_geometry); 00140 ros::serialization::deserialize(stream, furniture_geometry_list); 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(target_obj_pose); 00148 size += ros::serialization::serializationLength(parent_obj_geometry); 00149 size += ros::serialization::serializationLength(furniture_geometry_list); 00150 return size; 00151 } 00152 00153 typedef boost::shared_ptr< ::srs_symbolic_grounding::SymbolGroundingGraspBaseRegionRequest_<ContainerAllocator> > Ptr; 00154 typedef boost::shared_ptr< ::srs_symbolic_grounding::SymbolGroundingGraspBaseRegionRequest_<ContainerAllocator> const> ConstPtr; 00155 boost::shared_ptr<std::map<std::string, std::string> > __connection_header; 00156 }; // struct SymbolGroundingGraspBaseRegionRequest 00157 typedef ::srs_symbolic_grounding::SymbolGroundingGraspBaseRegionRequest_<std::allocator<void> > SymbolGroundingGraspBaseRegionRequest; 00158 00159 typedef boost::shared_ptr< ::srs_symbolic_grounding::SymbolGroundingGraspBaseRegionRequest> SymbolGroundingGraspBaseRegionRequestPtr; 00160 typedef boost::shared_ptr< ::srs_symbolic_grounding::SymbolGroundingGraspBaseRegionRequest const> SymbolGroundingGraspBaseRegionRequestConstPtr; 00161 00162 00163 template <class ContainerAllocator> 00164 struct SymbolGroundingGraspBaseRegionResponse_ { 00165 typedef SymbolGroundingGraspBaseRegionResponse_<ContainerAllocator> Type; 00166 00167 SymbolGroundingGraspBaseRegionResponse_() 00168 : obstacle_check(false) 00169 , reach(0.0) 00170 , grasp_base_pose() 00171 , R(0.0) 00172 { 00173 } 00174 00175 SymbolGroundingGraspBaseRegionResponse_(const ContainerAllocator& _alloc) 00176 : obstacle_check(false) 00177 , reach(0.0) 00178 , grasp_base_pose(_alloc) 00179 , R(0.0) 00180 { 00181 } 00182 00183 typedef uint8_t _obstacle_check_type; 00184 uint8_t obstacle_check; 00185 00186 typedef float _reach_type; 00187 float reach; 00188 00189 typedef ::geometry_msgs::Pose2D_<ContainerAllocator> _grasp_base_pose_type; 00190 ::geometry_msgs::Pose2D_<ContainerAllocator> grasp_base_pose; 00191 00192 typedef float _R_type; 00193 float R; 00194 00195 00196 private: 00197 static const char* __s_getDataType_() { return "srs_symbolic_grounding/SymbolGroundingGraspBaseRegionResponse"; } 00198 public: 00199 ROS_DEPRECATED static const std::string __s_getDataType() { return __s_getDataType_(); } 00200 00201 ROS_DEPRECATED const std::string __getDataType() const { return __s_getDataType_(); } 00202 00203 private: 00204 static const char* __s_getMD5Sum_() { return "3fa00ea708fbc84242f9ea364e09f2c6"; } 00205 public: 00206 ROS_DEPRECATED static const std::string __s_getMD5Sum() { return __s_getMD5Sum_(); } 00207 00208 ROS_DEPRECATED const std::string __getMD5Sum() const { return __s_getMD5Sum_(); } 00209 00210 private: 00211 static const char* __s_getServerMD5Sum_() { return "85656dac540bfd2cc20973338dc0825b"; } 00212 public: 00213 ROS_DEPRECATED static const std::string __s_getServerMD5Sum() { return __s_getServerMD5Sum_(); } 00214 00215 ROS_DEPRECATED const std::string __getServerMD5Sum() const { return __s_getServerMD5Sum_(); } 00216 00217 private: 00218 static const char* __s_getMessageDefinition_() { return "bool obstacle_check\n\ 00219 float32 reach\n\ 00220 geometry_msgs/Pose2D grasp_base_pose\n\ 00221 float32 R\n\ 00222 \n\ 00223 \n\ 00224 ================================================================================\n\ 00225 MSG: geometry_msgs/Pose2D\n\ 00226 # This expresses a position and orientation on a 2D manifold.\n\ 00227 \n\ 00228 float64 x\n\ 00229 float64 y\n\ 00230 float64 theta\n\ 00231 "; } 00232 public: 00233 ROS_DEPRECATED static const std::string __s_getMessageDefinition() { return __s_getMessageDefinition_(); } 00234 00235 ROS_DEPRECATED const std::string __getMessageDefinition() const { return __s_getMessageDefinition_(); } 00236 00237 ROS_DEPRECATED virtual uint8_t *serialize(uint8_t *write_ptr, uint32_t seq) const 00238 { 00239 ros::serialization::OStream stream(write_ptr, 1000000000); 00240 ros::serialization::serialize(stream, obstacle_check); 00241 ros::serialization::serialize(stream, reach); 00242 ros::serialization::serialize(stream, grasp_base_pose); 00243 ros::serialization::serialize(stream, R); 00244 return stream.getData(); 00245 } 00246 00247 ROS_DEPRECATED virtual uint8_t *deserialize(uint8_t *read_ptr) 00248 { 00249 ros::serialization::IStream stream(read_ptr, 1000000000); 00250 ros::serialization::deserialize(stream, obstacle_check); 00251 ros::serialization::deserialize(stream, reach); 00252 ros::serialization::deserialize(stream, grasp_base_pose); 00253 ros::serialization::deserialize(stream, R); 00254 return stream.getData(); 00255 } 00256 00257 ROS_DEPRECATED virtual uint32_t serializationLength() const 00258 { 00259 uint32_t size = 0; 00260 size += ros::serialization::serializationLength(obstacle_check); 00261 size += ros::serialization::serializationLength(reach); 00262 size += ros::serialization::serializationLength(grasp_base_pose); 00263 size += ros::serialization::serializationLength(R); 00264 return size; 00265 } 00266 00267 typedef boost::shared_ptr< ::srs_symbolic_grounding::SymbolGroundingGraspBaseRegionResponse_<ContainerAllocator> > Ptr; 00268 typedef boost::shared_ptr< ::srs_symbolic_grounding::SymbolGroundingGraspBaseRegionResponse_<ContainerAllocator> const> ConstPtr; 00269 boost::shared_ptr<std::map<std::string, std::string> > __connection_header; 00270 }; // struct SymbolGroundingGraspBaseRegionResponse 00271 typedef ::srs_symbolic_grounding::SymbolGroundingGraspBaseRegionResponse_<std::allocator<void> > SymbolGroundingGraspBaseRegionResponse; 00272 00273 typedef boost::shared_ptr< ::srs_symbolic_grounding::SymbolGroundingGraspBaseRegionResponse> SymbolGroundingGraspBaseRegionResponsePtr; 00274 typedef boost::shared_ptr< ::srs_symbolic_grounding::SymbolGroundingGraspBaseRegionResponse const> SymbolGroundingGraspBaseRegionResponseConstPtr; 00275 00276 struct SymbolGroundingGraspBaseRegion 00277 { 00278 00279 typedef SymbolGroundingGraspBaseRegionRequest Request; 00280 typedef SymbolGroundingGraspBaseRegionResponse Response; 00281 Request request; 00282 Response response; 00283 00284 typedef Request RequestType; 00285 typedef Response ResponseType; 00286 }; // struct SymbolGroundingGraspBaseRegion 00287 } // namespace srs_symbolic_grounding 00288 00289 namespace ros 00290 { 00291 namespace message_traits 00292 { 00293 template<class ContainerAllocator> struct IsMessage< ::srs_symbolic_grounding::SymbolGroundingGraspBaseRegionRequest_<ContainerAllocator> > : public TrueType {}; 00294 template<class ContainerAllocator> struct IsMessage< ::srs_symbolic_grounding::SymbolGroundingGraspBaseRegionRequest_<ContainerAllocator> const> : public TrueType {}; 00295 template<class ContainerAllocator> 00296 struct MD5Sum< ::srs_symbolic_grounding::SymbolGroundingGraspBaseRegionRequest_<ContainerAllocator> > { 00297 static const char* value() 00298 { 00299 return "929217c873801a8d83a0ef0a0ff55374"; 00300 } 00301 00302 static const char* value(const ::srs_symbolic_grounding::SymbolGroundingGraspBaseRegionRequest_<ContainerAllocator> &) { return value(); } 00303 static const uint64_t static_value1 = 0x929217c873801a8dULL; 00304 static const uint64_t static_value2 = 0x83a0ef0a0ff55374ULL; 00305 }; 00306 00307 template<class ContainerAllocator> 00308 struct DataType< ::srs_symbolic_grounding::SymbolGroundingGraspBaseRegionRequest_<ContainerAllocator> > { 00309 static const char* value() 00310 { 00311 return "srs_symbolic_grounding/SymbolGroundingGraspBaseRegionRequest"; 00312 } 00313 00314 static const char* value(const ::srs_symbolic_grounding::SymbolGroundingGraspBaseRegionRequest_<ContainerAllocator> &) { return value(); } 00315 }; 00316 00317 template<class ContainerAllocator> 00318 struct Definition< ::srs_symbolic_grounding::SymbolGroundingGraspBaseRegionRequest_<ContainerAllocator> > { 00319 static const char* value() 00320 { 00321 return "geometry_msgs/Pose target_obj_pose\n\ 00322 \n\ 00323 \n\ 00324 srs_msgs/SRSSpatialInfo parent_obj_geometry\n\ 00325 srs_msgs/SRSSpatialInfo[] furniture_geometry_list\n\ 00326 \n\ 00327 ================================================================================\n\ 00328 MSG: geometry_msgs/Pose\n\ 00329 # A representation of pose in free space, composed of postion and orientation. \n\ 00330 Point position\n\ 00331 Quaternion orientation\n\ 00332 \n\ 00333 ================================================================================\n\ 00334 MSG: geometry_msgs/Point\n\ 00335 # This contains the position of a point in free space\n\ 00336 float64 x\n\ 00337 float64 y\n\ 00338 float64 z\n\ 00339 \n\ 00340 ================================================================================\n\ 00341 MSG: geometry_msgs/Quaternion\n\ 00342 # This represents an orientation in free space in quaternion form.\n\ 00343 \n\ 00344 float64 x\n\ 00345 float64 y\n\ 00346 float64 z\n\ 00347 float64 w\n\ 00348 \n\ 00349 ================================================================================\n\ 00350 MSG: srs_msgs/SRSSpatialInfo\n\ 00351 # Point point\n\ 00352 # Orientation angles\n\ 00353 float32 l\n\ 00354 float32 w\n\ 00355 float32 h\n\ 00356 \n\ 00357 geometry_msgs/Pose pose\n\ 00358 \n\ 00359 "; 00360 } 00361 00362 static const char* value(const ::srs_symbolic_grounding::SymbolGroundingGraspBaseRegionRequest_<ContainerAllocator> &) { return value(); } 00363 }; 00364 00365 } // namespace message_traits 00366 } // namespace ros 00367 00368 00369 namespace ros 00370 { 00371 namespace message_traits 00372 { 00373 template<class ContainerAllocator> struct IsMessage< ::srs_symbolic_grounding::SymbolGroundingGraspBaseRegionResponse_<ContainerAllocator> > : public TrueType {}; 00374 template<class ContainerAllocator> struct IsMessage< ::srs_symbolic_grounding::SymbolGroundingGraspBaseRegionResponse_<ContainerAllocator> const> : public TrueType {}; 00375 template<class ContainerAllocator> 00376 struct MD5Sum< ::srs_symbolic_grounding::SymbolGroundingGraspBaseRegionResponse_<ContainerAllocator> > { 00377 static const char* value() 00378 { 00379 return "3fa00ea708fbc84242f9ea364e09f2c6"; 00380 } 00381 00382 static const char* value(const ::srs_symbolic_grounding::SymbolGroundingGraspBaseRegionResponse_<ContainerAllocator> &) { return value(); } 00383 static const uint64_t static_value1 = 0x3fa00ea708fbc842ULL; 00384 static const uint64_t static_value2 = 0x42f9ea364e09f2c6ULL; 00385 }; 00386 00387 template<class ContainerAllocator> 00388 struct DataType< ::srs_symbolic_grounding::SymbolGroundingGraspBaseRegionResponse_<ContainerAllocator> > { 00389 static const char* value() 00390 { 00391 return "srs_symbolic_grounding/SymbolGroundingGraspBaseRegionResponse"; 00392 } 00393 00394 static const char* value(const ::srs_symbolic_grounding::SymbolGroundingGraspBaseRegionResponse_<ContainerAllocator> &) { return value(); } 00395 }; 00396 00397 template<class ContainerAllocator> 00398 struct Definition< ::srs_symbolic_grounding::SymbolGroundingGraspBaseRegionResponse_<ContainerAllocator> > { 00399 static const char* value() 00400 { 00401 return "bool obstacle_check\n\ 00402 float32 reach\n\ 00403 geometry_msgs/Pose2D grasp_base_pose\n\ 00404 float32 R\n\ 00405 \n\ 00406 \n\ 00407 ================================================================================\n\ 00408 MSG: geometry_msgs/Pose2D\n\ 00409 # This expresses a position and orientation on a 2D manifold.\n\ 00410 \n\ 00411 float64 x\n\ 00412 float64 y\n\ 00413 float64 theta\n\ 00414 "; 00415 } 00416 00417 static const char* value(const ::srs_symbolic_grounding::SymbolGroundingGraspBaseRegionResponse_<ContainerAllocator> &) { return value(); } 00418 }; 00419 00420 template<class ContainerAllocator> struct IsFixedSize< ::srs_symbolic_grounding::SymbolGroundingGraspBaseRegionResponse_<ContainerAllocator> > : public TrueType {}; 00421 } // namespace message_traits 00422 } // namespace ros 00423 00424 namespace ros 00425 { 00426 namespace serialization 00427 { 00428 00429 template<class ContainerAllocator> struct Serializer< ::srs_symbolic_grounding::SymbolGroundingGraspBaseRegionRequest_<ContainerAllocator> > 00430 { 00431 template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m) 00432 { 00433 stream.next(m.target_obj_pose); 00434 stream.next(m.parent_obj_geometry); 00435 stream.next(m.furniture_geometry_list); 00436 } 00437 00438 ROS_DECLARE_ALLINONE_SERIALIZER; 00439 }; // struct SymbolGroundingGraspBaseRegionRequest_ 00440 } // namespace serialization 00441 } // namespace ros 00442 00443 00444 namespace ros 00445 { 00446 namespace serialization 00447 { 00448 00449 template<class ContainerAllocator> struct Serializer< ::srs_symbolic_grounding::SymbolGroundingGraspBaseRegionResponse_<ContainerAllocator> > 00450 { 00451 template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m) 00452 { 00453 stream.next(m.obstacle_check); 00454 stream.next(m.reach); 00455 stream.next(m.grasp_base_pose); 00456 stream.next(m.R); 00457 } 00458 00459 ROS_DECLARE_ALLINONE_SERIALIZER; 00460 }; // struct SymbolGroundingGraspBaseRegionResponse_ 00461 } // namespace serialization 00462 } // namespace ros 00463 00464 namespace ros 00465 { 00466 namespace service_traits 00467 { 00468 template<> 00469 struct MD5Sum<srs_symbolic_grounding::SymbolGroundingGraspBaseRegion> { 00470 static const char* value() 00471 { 00472 return "85656dac540bfd2cc20973338dc0825b"; 00473 } 00474 00475 static const char* value(const srs_symbolic_grounding::SymbolGroundingGraspBaseRegion&) { return value(); } 00476 }; 00477 00478 template<> 00479 struct DataType<srs_symbolic_grounding::SymbolGroundingGraspBaseRegion> { 00480 static const char* value() 00481 { 00482 return "srs_symbolic_grounding/SymbolGroundingGraspBaseRegion"; 00483 } 00484 00485 static const char* value(const srs_symbolic_grounding::SymbolGroundingGraspBaseRegion&) { return value(); } 00486 }; 00487 00488 template<class ContainerAllocator> 00489 struct MD5Sum<srs_symbolic_grounding::SymbolGroundingGraspBaseRegionRequest_<ContainerAllocator> > { 00490 static const char* value() 00491 { 00492 return "85656dac540bfd2cc20973338dc0825b"; 00493 } 00494 00495 static const char* value(const srs_symbolic_grounding::SymbolGroundingGraspBaseRegionRequest_<ContainerAllocator> &) { return value(); } 00496 }; 00497 00498 template<class ContainerAllocator> 00499 struct DataType<srs_symbolic_grounding::SymbolGroundingGraspBaseRegionRequest_<ContainerAllocator> > { 00500 static const char* value() 00501 { 00502 return "srs_symbolic_grounding/SymbolGroundingGraspBaseRegion"; 00503 } 00504 00505 static const char* value(const srs_symbolic_grounding::SymbolGroundingGraspBaseRegionRequest_<ContainerAllocator> &) { return value(); } 00506 }; 00507 00508 template<class ContainerAllocator> 00509 struct MD5Sum<srs_symbolic_grounding::SymbolGroundingGraspBaseRegionResponse_<ContainerAllocator> > { 00510 static const char* value() 00511 { 00512 return "85656dac540bfd2cc20973338dc0825b"; 00513 } 00514 00515 static const char* value(const srs_symbolic_grounding::SymbolGroundingGraspBaseRegionResponse_<ContainerAllocator> &) { return value(); } 00516 }; 00517 00518 template<class ContainerAllocator> 00519 struct DataType<srs_symbolic_grounding::SymbolGroundingGraspBaseRegionResponse_<ContainerAllocator> > { 00520 static const char* value() 00521 { 00522 return "srs_symbolic_grounding/SymbolGroundingGraspBaseRegion"; 00523 } 00524 00525 static const char* value(const srs_symbolic_grounding::SymbolGroundingGraspBaseRegionResponse_<ContainerAllocator> &) { return value(); } 00526 }; 00527 00528 } // namespace service_traits 00529 } // namespace ros 00530 00531 #endif // SRS_SYMBOLIC_GROUNDING_SERVICE_SYMBOLGROUNDINGGRASPBASEREGION_H 00532