00001 """autogenerated by genpy from iri_bow_object_detector/RefineGraspPointRequest.msg. Do not edit."""
00002 import sys
00003 python3 = True if sys.hexversion > 0x03000000 else False
00004 import genpy
00005 import struct
00006
00007 import iri_bow_object_detector.msg
00008 import geometry_msgs.msg
00009 import std_msgs.msg
00010 import iri_perception_msgs.msg
00011 import sensor_msgs.msg
00012
00013 class RefineGraspPointRequest(genpy.Message):
00014 _md5sum = "0526af87c7b6cc76c0da62278b22490c"
00015 _type = "iri_bow_object_detector/RefineGraspPointRequest"
00016 _has_header = False
00017 _full_text = """
00018
00019 iri_bow_object_detector/ObjectBox[] posible_solutions
00020 sensor_msgs/Image image
00021 iri_perception_msgs/DescriptorSet descriptor_set
00022
00023 ================================================================================
00024 MSG: iri_bow_object_detector/ObjectBox
00025 iri_perception_msgs/ImagePoint point1
00026 iri_perception_msgs/ImagePoint point2
00027 float32 value
00028 ================================================================================
00029 MSG: iri_perception_msgs/ImagePoint
00030 uint32 x
00031 uint32 y
00032 ================================================================================
00033 MSG: sensor_msgs/Image
00034 # This message contains an uncompressed image
00035 # (0, 0) is at top-left corner of image
00036 #
00037
00038 Header header # Header timestamp should be acquisition time of image
00039 # Header frame_id should be optical frame of camera
00040 # origin of frame should be optical center of cameara
00041 # +x should point to the right in the image
00042 # +y should point down in the image
00043 # +z should point into to plane of the image
00044 # If the frame_id here and the frame_id of the CameraInfo
00045 # message associated with the image conflict
00046 # the behavior is undefined
00047
00048 uint32 height # image height, that is, number of rows
00049 uint32 width # image width, that is, number of columns
00050
00051 # The legal values for encoding are in file src/image_encodings.cpp
00052 # If you want to standardize a new string format, join
00053 # ros-users@lists.sourceforge.net and send an email proposing a new encoding.
00054
00055 string encoding # Encoding of pixels -- channel meaning, ordering, size
00056 # taken from the list of strings in src/image_encodings.cpp
00057
00058 uint8 is_bigendian # is this data bigendian?
00059 uint32 step # Full row length in bytes
00060 uint8[] data # actual matrix data, size is (step * rows)
00061
00062 ================================================================================
00063 MSG: std_msgs/Header
00064 # Standard metadata for higher-level stamped data types.
00065 # This is generally used to communicate timestamped data
00066 # in a particular coordinate frame.
00067 #
00068 # sequence ID: consecutively increasing ID
00069 uint32 seq
00070 #Two-integer timestamp that is expressed as:
00071 # * stamp.secs: seconds (stamp_secs) since epoch
00072 # * stamp.nsecs: nanoseconds since stamp_secs
00073 # time-handling sugar is provided by the client library
00074 time stamp
00075 #Frame this data is associated with
00076 # 0: no frame
00077 # 1: global frame
00078 string frame_id
00079
00080 ================================================================================
00081 MSG: iri_perception_msgs/DescriptorSet
00082 Header header
00083 int32 num_orient_bins
00084 int32 num_spa_bins
00085 int32 num
00086 int32 len
00087 int32 width
00088 int32 height
00089 iri_perception_msgs/Descriptor[] descriptors
00090
00091 ================================================================================
00092 MSG: iri_perception_msgs/Descriptor
00093 float32[] descriptor
00094 geometry_msgs/Vector3 point3d
00095 int32 u
00096 int32 v
00097 float32 orientation
00098
00099 ================================================================================
00100 MSG: geometry_msgs/Vector3
00101 # This represents a vector in free space.
00102
00103 float64 x
00104 float64 y
00105 float64 z
00106 """
00107 __slots__ = ['posible_solutions','image','descriptor_set']
00108 _slot_types = ['iri_bow_object_detector/ObjectBox[]','sensor_msgs/Image','iri_perception_msgs/DescriptorSet']
00109
00110 def __init__(self, *args, **kwds):
00111 """
00112 Constructor. Any message fields that are implicitly/explicitly
00113 set to None will be assigned a default value. The recommend
00114 use is keyword arguments as this is more robust to future message
00115 changes. You cannot mix in-order arguments and keyword arguments.
00116
00117 The available fields are:
00118 posible_solutions,image,descriptor_set
00119
00120 :param args: complete set of field values, in .msg order
00121 :param kwds: use keyword arguments corresponding to message field names
00122 to set specific fields.
00123 """
00124 if args or kwds:
00125 super(RefineGraspPointRequest, self).__init__(*args, **kwds)
00126
00127 if self.posible_solutions is None:
00128 self.posible_solutions = []
00129 if self.image is None:
00130 self.image = sensor_msgs.msg.Image()
00131 if self.descriptor_set is None:
00132 self.descriptor_set = iri_perception_msgs.msg.DescriptorSet()
00133 else:
00134 self.posible_solutions = []
00135 self.image = sensor_msgs.msg.Image()
00136 self.descriptor_set = iri_perception_msgs.msg.DescriptorSet()
00137
00138 def _get_types(self):
00139 """
00140 internal API method
00141 """
00142 return self._slot_types
00143
00144 def serialize(self, buff):
00145 """
00146 serialize message into buffer
00147 :param buff: buffer, ``StringIO``
00148 """
00149 try:
00150 length = len(self.posible_solutions)
00151 buff.write(_struct_I.pack(length))
00152 for val1 in self.posible_solutions:
00153 _v1 = val1.point1
00154 _x = _v1
00155 buff.write(_struct_2I.pack(_x.x, _x.y))
00156 _v2 = val1.point2
00157 _x = _v2
00158 buff.write(_struct_2I.pack(_x.x, _x.y))
00159 buff.write(_struct_f.pack(val1.value))
00160 _x = self
00161 buff.write(_struct_3I.pack(_x.image.header.seq, _x.image.header.stamp.secs, _x.image.header.stamp.nsecs))
00162 _x = self.image.header.frame_id
00163 length = len(_x)
00164 if python3 or type(_x) == unicode:
00165 _x = _x.encode('utf-8')
00166 length = len(_x)
00167 buff.write(struct.pack('<I%ss'%length, length, _x))
00168 _x = self
00169 buff.write(_struct_2I.pack(_x.image.height, _x.image.width))
00170 _x = self.image.encoding
00171 length = len(_x)
00172 if python3 or type(_x) == unicode:
00173 _x = _x.encode('utf-8')
00174 length = len(_x)
00175 buff.write(struct.pack('<I%ss'%length, length, _x))
00176 _x = self
00177 buff.write(_struct_BI.pack(_x.image.is_bigendian, _x.image.step))
00178 _x = self.image.data
00179 length = len(_x)
00180
00181 if type(_x) in [list, tuple]:
00182 buff.write(struct.pack('<I%sB'%length, length, *_x))
00183 else:
00184 buff.write(struct.pack('<I%ss'%length, length, _x))
00185 _x = self
00186 buff.write(_struct_3I.pack(_x.descriptor_set.header.seq, _x.descriptor_set.header.stamp.secs, _x.descriptor_set.header.stamp.nsecs))
00187 _x = self.descriptor_set.header.frame_id
00188 length = len(_x)
00189 if python3 or type(_x) == unicode:
00190 _x = _x.encode('utf-8')
00191 length = len(_x)
00192 buff.write(struct.pack('<I%ss'%length, length, _x))
00193 _x = self
00194 buff.write(_struct_6i.pack(_x.descriptor_set.num_orient_bins, _x.descriptor_set.num_spa_bins, _x.descriptor_set.num, _x.descriptor_set.len, _x.descriptor_set.width, _x.descriptor_set.height))
00195 length = len(self.descriptor_set.descriptors)
00196 buff.write(_struct_I.pack(length))
00197 for val1 in self.descriptor_set.descriptors:
00198 length = len(val1.descriptor)
00199 buff.write(_struct_I.pack(length))
00200 pattern = '<%sf'%length
00201 buff.write(struct.pack(pattern, *val1.descriptor))
00202 _v3 = val1.point3d
00203 _x = _v3
00204 buff.write(_struct_3d.pack(_x.x, _x.y, _x.z))
00205 _x = val1
00206 buff.write(_struct_2if.pack(_x.u, _x.v, _x.orientation))
00207 except struct.error as se: self._check_types(se)
00208 except TypeError as te: self._check_types(te)
00209
00210 def deserialize(self, str):
00211 """
00212 unpack serialized message in str into this message instance
00213 :param str: byte array of serialized message, ``str``
00214 """
00215 try:
00216 if self.posible_solutions is None:
00217 self.posible_solutions = None
00218 if self.image is None:
00219 self.image = sensor_msgs.msg.Image()
00220 if self.descriptor_set is None:
00221 self.descriptor_set = iri_perception_msgs.msg.DescriptorSet()
00222 end = 0
00223 start = end
00224 end += 4
00225 (length,) = _struct_I.unpack(str[start:end])
00226 self.posible_solutions = []
00227 for i in range(0, length):
00228 val1 = iri_bow_object_detector.msg.ObjectBox()
00229 _v4 = val1.point1
00230 _x = _v4
00231 start = end
00232 end += 8
00233 (_x.x, _x.y,) = _struct_2I.unpack(str[start:end])
00234 _v5 = val1.point2
00235 _x = _v5
00236 start = end
00237 end += 8
00238 (_x.x, _x.y,) = _struct_2I.unpack(str[start:end])
00239 start = end
00240 end += 4
00241 (val1.value,) = _struct_f.unpack(str[start:end])
00242 self.posible_solutions.append(val1)
00243 _x = self
00244 start = end
00245 end += 12
00246 (_x.image.header.seq, _x.image.header.stamp.secs, _x.image.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00247 start = end
00248 end += 4
00249 (length,) = _struct_I.unpack(str[start:end])
00250 start = end
00251 end += length
00252 if python3:
00253 self.image.header.frame_id = str[start:end].decode('utf-8')
00254 else:
00255 self.image.header.frame_id = str[start:end]
00256 _x = self
00257 start = end
00258 end += 8
00259 (_x.image.height, _x.image.width,) = _struct_2I.unpack(str[start:end])
00260 start = end
00261 end += 4
00262 (length,) = _struct_I.unpack(str[start:end])
00263 start = end
00264 end += length
00265 if python3:
00266 self.image.encoding = str[start:end].decode('utf-8')
00267 else:
00268 self.image.encoding = str[start:end]
00269 _x = self
00270 start = end
00271 end += 5
00272 (_x.image.is_bigendian, _x.image.step,) = _struct_BI.unpack(str[start:end])
00273 start = end
00274 end += 4
00275 (length,) = _struct_I.unpack(str[start:end])
00276 start = end
00277 end += length
00278 if python3:
00279 self.image.data = str[start:end].decode('utf-8')
00280 else:
00281 self.image.data = str[start:end]
00282 _x = self
00283 start = end
00284 end += 12
00285 (_x.descriptor_set.header.seq, _x.descriptor_set.header.stamp.secs, _x.descriptor_set.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00286 start = end
00287 end += 4
00288 (length,) = _struct_I.unpack(str[start:end])
00289 start = end
00290 end += length
00291 if python3:
00292 self.descriptor_set.header.frame_id = str[start:end].decode('utf-8')
00293 else:
00294 self.descriptor_set.header.frame_id = str[start:end]
00295 _x = self
00296 start = end
00297 end += 24
00298 (_x.descriptor_set.num_orient_bins, _x.descriptor_set.num_spa_bins, _x.descriptor_set.num, _x.descriptor_set.len, _x.descriptor_set.width, _x.descriptor_set.height,) = _struct_6i.unpack(str[start:end])
00299 start = end
00300 end += 4
00301 (length,) = _struct_I.unpack(str[start:end])
00302 self.descriptor_set.descriptors = []
00303 for i in range(0, length):
00304 val1 = iri_perception_msgs.msg.Descriptor()
00305 start = end
00306 end += 4
00307 (length,) = _struct_I.unpack(str[start:end])
00308 pattern = '<%sf'%length
00309 start = end
00310 end += struct.calcsize(pattern)
00311 val1.descriptor = struct.unpack(pattern, str[start:end])
00312 _v6 = val1.point3d
00313 _x = _v6
00314 start = end
00315 end += 24
00316 (_x.x, _x.y, _x.z,) = _struct_3d.unpack(str[start:end])
00317 _x = val1
00318 start = end
00319 end += 12
00320 (_x.u, _x.v, _x.orientation,) = _struct_2if.unpack(str[start:end])
00321 self.descriptor_set.descriptors.append(val1)
00322 return self
00323 except struct.error as e:
00324 raise genpy.DeserializationError(e)
00325
00326
00327 def serialize_numpy(self, buff, numpy):
00328 """
00329 serialize message with numpy array types into buffer
00330 :param buff: buffer, ``StringIO``
00331 :param numpy: numpy python module
00332 """
00333 try:
00334 length = len(self.posible_solutions)
00335 buff.write(_struct_I.pack(length))
00336 for val1 in self.posible_solutions:
00337 _v7 = val1.point1
00338 _x = _v7
00339 buff.write(_struct_2I.pack(_x.x, _x.y))
00340 _v8 = val1.point2
00341 _x = _v8
00342 buff.write(_struct_2I.pack(_x.x, _x.y))
00343 buff.write(_struct_f.pack(val1.value))
00344 _x = self
00345 buff.write(_struct_3I.pack(_x.image.header.seq, _x.image.header.stamp.secs, _x.image.header.stamp.nsecs))
00346 _x = self.image.header.frame_id
00347 length = len(_x)
00348 if python3 or type(_x) == unicode:
00349 _x = _x.encode('utf-8')
00350 length = len(_x)
00351 buff.write(struct.pack('<I%ss'%length, length, _x))
00352 _x = self
00353 buff.write(_struct_2I.pack(_x.image.height, _x.image.width))
00354 _x = self.image.encoding
00355 length = len(_x)
00356 if python3 or type(_x) == unicode:
00357 _x = _x.encode('utf-8')
00358 length = len(_x)
00359 buff.write(struct.pack('<I%ss'%length, length, _x))
00360 _x = self
00361 buff.write(_struct_BI.pack(_x.image.is_bigendian, _x.image.step))
00362 _x = self.image.data
00363 length = len(_x)
00364
00365 if type(_x) in [list, tuple]:
00366 buff.write(struct.pack('<I%sB'%length, length, *_x))
00367 else:
00368 buff.write(struct.pack('<I%ss'%length, length, _x))
00369 _x = self
00370 buff.write(_struct_3I.pack(_x.descriptor_set.header.seq, _x.descriptor_set.header.stamp.secs, _x.descriptor_set.header.stamp.nsecs))
00371 _x = self.descriptor_set.header.frame_id
00372 length = len(_x)
00373 if python3 or type(_x) == unicode:
00374 _x = _x.encode('utf-8')
00375 length = len(_x)
00376 buff.write(struct.pack('<I%ss'%length, length, _x))
00377 _x = self
00378 buff.write(_struct_6i.pack(_x.descriptor_set.num_orient_bins, _x.descriptor_set.num_spa_bins, _x.descriptor_set.num, _x.descriptor_set.len, _x.descriptor_set.width, _x.descriptor_set.height))
00379 length = len(self.descriptor_set.descriptors)
00380 buff.write(_struct_I.pack(length))
00381 for val1 in self.descriptor_set.descriptors:
00382 length = len(val1.descriptor)
00383 buff.write(_struct_I.pack(length))
00384 pattern = '<%sf'%length
00385 buff.write(val1.descriptor.tostring())
00386 _v9 = val1.point3d
00387 _x = _v9
00388 buff.write(_struct_3d.pack(_x.x, _x.y, _x.z))
00389 _x = val1
00390 buff.write(_struct_2if.pack(_x.u, _x.v, _x.orientation))
00391 except struct.error as se: self._check_types(se)
00392 except TypeError as te: self._check_types(te)
00393
00394 def deserialize_numpy(self, str, numpy):
00395 """
00396 unpack serialized message in str into this message instance using numpy for array types
00397 :param str: byte array of serialized message, ``str``
00398 :param numpy: numpy python module
00399 """
00400 try:
00401 if self.posible_solutions is None:
00402 self.posible_solutions = None
00403 if self.image is None:
00404 self.image = sensor_msgs.msg.Image()
00405 if self.descriptor_set is None:
00406 self.descriptor_set = iri_perception_msgs.msg.DescriptorSet()
00407 end = 0
00408 start = end
00409 end += 4
00410 (length,) = _struct_I.unpack(str[start:end])
00411 self.posible_solutions = []
00412 for i in range(0, length):
00413 val1 = iri_bow_object_detector.msg.ObjectBox()
00414 _v10 = val1.point1
00415 _x = _v10
00416 start = end
00417 end += 8
00418 (_x.x, _x.y,) = _struct_2I.unpack(str[start:end])
00419 _v11 = val1.point2
00420 _x = _v11
00421 start = end
00422 end += 8
00423 (_x.x, _x.y,) = _struct_2I.unpack(str[start:end])
00424 start = end
00425 end += 4
00426 (val1.value,) = _struct_f.unpack(str[start:end])
00427 self.posible_solutions.append(val1)
00428 _x = self
00429 start = end
00430 end += 12
00431 (_x.image.header.seq, _x.image.header.stamp.secs, _x.image.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00432 start = end
00433 end += 4
00434 (length,) = _struct_I.unpack(str[start:end])
00435 start = end
00436 end += length
00437 if python3:
00438 self.image.header.frame_id = str[start:end].decode('utf-8')
00439 else:
00440 self.image.header.frame_id = str[start:end]
00441 _x = self
00442 start = end
00443 end += 8
00444 (_x.image.height, _x.image.width,) = _struct_2I.unpack(str[start:end])
00445 start = end
00446 end += 4
00447 (length,) = _struct_I.unpack(str[start:end])
00448 start = end
00449 end += length
00450 if python3:
00451 self.image.encoding = str[start:end].decode('utf-8')
00452 else:
00453 self.image.encoding = str[start:end]
00454 _x = self
00455 start = end
00456 end += 5
00457 (_x.image.is_bigendian, _x.image.step,) = _struct_BI.unpack(str[start:end])
00458 start = end
00459 end += 4
00460 (length,) = _struct_I.unpack(str[start:end])
00461 start = end
00462 end += length
00463 if python3:
00464 self.image.data = str[start:end].decode('utf-8')
00465 else:
00466 self.image.data = str[start:end]
00467 _x = self
00468 start = end
00469 end += 12
00470 (_x.descriptor_set.header.seq, _x.descriptor_set.header.stamp.secs, _x.descriptor_set.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00471 start = end
00472 end += 4
00473 (length,) = _struct_I.unpack(str[start:end])
00474 start = end
00475 end += length
00476 if python3:
00477 self.descriptor_set.header.frame_id = str[start:end].decode('utf-8')
00478 else:
00479 self.descriptor_set.header.frame_id = str[start:end]
00480 _x = self
00481 start = end
00482 end += 24
00483 (_x.descriptor_set.num_orient_bins, _x.descriptor_set.num_spa_bins, _x.descriptor_set.num, _x.descriptor_set.len, _x.descriptor_set.width, _x.descriptor_set.height,) = _struct_6i.unpack(str[start:end])
00484 start = end
00485 end += 4
00486 (length,) = _struct_I.unpack(str[start:end])
00487 self.descriptor_set.descriptors = []
00488 for i in range(0, length):
00489 val1 = iri_perception_msgs.msg.Descriptor()
00490 start = end
00491 end += 4
00492 (length,) = _struct_I.unpack(str[start:end])
00493 pattern = '<%sf'%length
00494 start = end
00495 end += struct.calcsize(pattern)
00496 val1.descriptor = numpy.frombuffer(str[start:end], dtype=numpy.float32, count=length)
00497 _v12 = val1.point3d
00498 _x = _v12
00499 start = end
00500 end += 24
00501 (_x.x, _x.y, _x.z,) = _struct_3d.unpack(str[start:end])
00502 _x = val1
00503 start = end
00504 end += 12
00505 (_x.u, _x.v, _x.orientation,) = _struct_2if.unpack(str[start:end])
00506 self.descriptor_set.descriptors.append(val1)
00507 return self
00508 except struct.error as e:
00509 raise genpy.DeserializationError(e)
00510
00511 _struct_I = genpy.struct_I
00512 _struct_f = struct.Struct("<f")
00513 _struct_6i = struct.Struct("<6i")
00514 _struct_BI = struct.Struct("<BI")
00515 _struct_3I = struct.Struct("<3I")
00516 _struct_2if = struct.Struct("<2if")
00517 _struct_2I = struct.Struct("<2I")
00518 _struct_3d = struct.Struct("<3d")
00519 """autogenerated by genpy from iri_bow_object_detector/RefineGraspPointResponse.msg. Do not edit."""
00520 import sys
00521 python3 = True if sys.hexversion > 0x03000000 else False
00522 import genpy
00523 import struct
00524
00525 import iri_perception_msgs.msg
00526
00527 class RefineGraspPointResponse(genpy.Message):
00528 _md5sum = "a1d3d6d5081395c0c4a6d2daa9a86c56"
00529 _type = "iri_bow_object_detector/RefineGraspPointResponse"
00530 _has_header = False
00531 _full_text = """
00532 iri_perception_msgs/ImagePoint grasp_point
00533
00534
00535 ================================================================================
00536 MSG: iri_perception_msgs/ImagePoint
00537 uint32 x
00538 uint32 y
00539 """
00540 __slots__ = ['grasp_point']
00541 _slot_types = ['iri_perception_msgs/ImagePoint']
00542
00543 def __init__(self, *args, **kwds):
00544 """
00545 Constructor. Any message fields that are implicitly/explicitly
00546 set to None will be assigned a default value. The recommend
00547 use is keyword arguments as this is more robust to future message
00548 changes. You cannot mix in-order arguments and keyword arguments.
00549
00550 The available fields are:
00551 grasp_point
00552
00553 :param args: complete set of field values, in .msg order
00554 :param kwds: use keyword arguments corresponding to message field names
00555 to set specific fields.
00556 """
00557 if args or kwds:
00558 super(RefineGraspPointResponse, self).__init__(*args, **kwds)
00559
00560 if self.grasp_point is None:
00561 self.grasp_point = iri_perception_msgs.msg.ImagePoint()
00562 else:
00563 self.grasp_point = iri_perception_msgs.msg.ImagePoint()
00564
00565 def _get_types(self):
00566 """
00567 internal API method
00568 """
00569 return self._slot_types
00570
00571 def serialize(self, buff):
00572 """
00573 serialize message into buffer
00574 :param buff: buffer, ``StringIO``
00575 """
00576 try:
00577 _x = self
00578 buff.write(_struct_2I.pack(_x.grasp_point.x, _x.grasp_point.y))
00579 except struct.error as se: self._check_types(se)
00580 except TypeError as te: self._check_types(te)
00581
00582 def deserialize(self, str):
00583 """
00584 unpack serialized message in str into this message instance
00585 :param str: byte array of serialized message, ``str``
00586 """
00587 try:
00588 if self.grasp_point is None:
00589 self.grasp_point = iri_perception_msgs.msg.ImagePoint()
00590 end = 0
00591 _x = self
00592 start = end
00593 end += 8
00594 (_x.grasp_point.x, _x.grasp_point.y,) = _struct_2I.unpack(str[start:end])
00595 return self
00596 except struct.error as e:
00597 raise genpy.DeserializationError(e)
00598
00599
00600 def serialize_numpy(self, buff, numpy):
00601 """
00602 serialize message with numpy array types into buffer
00603 :param buff: buffer, ``StringIO``
00604 :param numpy: numpy python module
00605 """
00606 try:
00607 _x = self
00608 buff.write(_struct_2I.pack(_x.grasp_point.x, _x.grasp_point.y))
00609 except struct.error as se: self._check_types(se)
00610 except TypeError as te: self._check_types(te)
00611
00612 def deserialize_numpy(self, str, numpy):
00613 """
00614 unpack serialized message in str into this message instance using numpy for array types
00615 :param str: byte array of serialized message, ``str``
00616 :param numpy: numpy python module
00617 """
00618 try:
00619 if self.grasp_point is None:
00620 self.grasp_point = iri_perception_msgs.msg.ImagePoint()
00621 end = 0
00622 _x = self
00623 start = end
00624 end += 8
00625 (_x.grasp_point.x, _x.grasp_point.y,) = _struct_2I.unpack(str[start:end])
00626 return self
00627 except struct.error as e:
00628 raise genpy.DeserializationError(e)
00629
00630 _struct_I = genpy.struct_I
00631 _struct_2I = struct.Struct("<2I")
00632 class RefineGraspPoint(object):
00633 _type = 'iri_bow_object_detector/RefineGraspPoint'
00634 _md5sum = '4df81184ea52bef77e8b614f35924fb4'
00635 _request_class = RefineGraspPointRequest
00636 _response_class = RefineGraspPointResponse