00001 """autogenerated by genmsg_py from PlaneInRegionRequest.msg. Do not edit."""
00002 import roslib.message
00003 import struct
00004
00005 import geometry_msgs.msg
00006 import std_msgs.msg
00007
00008 class PlaneInRegionRequest(roslib.message.Message):
00009 _md5sum = "7d70c4a3215f16e600ab2fb0a95d82d8"
00010 _type = "fast_plane_detection/PlaneInRegionRequest"
00011 _has_header = False
00012 _full_text = """
00013
00014
00015 geometry_msgs/Vector3Stamped point
00016
00017 int64 width
00018 int64 height
00019
00020
00021 ================================================================================
00022 MSG: geometry_msgs/Vector3Stamped
00023 # This represents a Vector3 with reference coordinate frame and timestamp
00024 Header header
00025 Vector3 vector
00026
00027 ================================================================================
00028 MSG: std_msgs/Header
00029 # Standard metadata for higher-level stamped data types.
00030 # This is generally used to communicate timestamped data
00031 # in a particular coordinate frame.
00032 #
00033 # sequence ID: consecutively increasing ID
00034 uint32 seq
00035 #Two-integer timestamp that is expressed as:
00036 # * stamp.secs: seconds (stamp_secs) since epoch
00037 # * stamp.nsecs: nanoseconds since stamp_secs
00038 # time-handling sugar is provided by the client library
00039 time stamp
00040 #Frame this data is associated with
00041 # 0: no frame
00042 # 1: global frame
00043 string frame_id
00044
00045 ================================================================================
00046 MSG: geometry_msgs/Vector3
00047 # This represents a vector in free space.
00048
00049 float64 x
00050 float64 y
00051 float64 z
00052 """
00053 __slots__ = ['point','width','height']
00054 _slot_types = ['geometry_msgs/Vector3Stamped','int64','int64']
00055
00056 def __init__(self, *args, **kwds):
00057 """
00058 Constructor. Any message fields that are implicitly/explicitly
00059 set to None will be assigned a default value. The recommend
00060 use is keyword arguments as this is more robust to future message
00061 changes. You cannot mix in-order arguments and keyword arguments.
00062
00063 The available fields are:
00064 point,width,height
00065
00066 @param args: complete set of field values, in .msg order
00067 @param kwds: use keyword arguments corresponding to message field names
00068 to set specific fields.
00069 """
00070 if args or kwds:
00071 super(PlaneInRegionRequest, self).__init__(*args, **kwds)
00072
00073 if self.point is None:
00074 self.point = geometry_msgs.msg.Vector3Stamped()
00075 if self.width is None:
00076 self.width = 0
00077 if self.height is None:
00078 self.height = 0
00079 else:
00080 self.point = geometry_msgs.msg.Vector3Stamped()
00081 self.width = 0
00082 self.height = 0
00083
00084 def _get_types(self):
00085 """
00086 internal API method
00087 """
00088 return self._slot_types
00089
00090 def serialize(self, buff):
00091 """
00092 serialize message into buffer
00093 @param buff: buffer
00094 @type buff: StringIO
00095 """
00096 try:
00097 _x = self
00098 buff.write(_struct_3I.pack(_x.point.header.seq, _x.point.header.stamp.secs, _x.point.header.stamp.nsecs))
00099 _x = self.point.header.frame_id
00100 length = len(_x)
00101 buff.write(struct.pack('<I%ss'%length, length, _x))
00102 _x = self
00103 buff.write(_struct_3d2q.pack(_x.point.vector.x, _x.point.vector.y, _x.point.vector.z, _x.width, _x.height))
00104 except struct.error, se: self._check_types(se)
00105 except TypeError, te: self._check_types(te)
00106
00107 def deserialize(self, str):
00108 """
00109 unpack serialized message in str into this message instance
00110 @param str: byte array of serialized message
00111 @type str: str
00112 """
00113 try:
00114 if self.point is None:
00115 self.point = geometry_msgs.msg.Vector3Stamped()
00116 end = 0
00117 _x = self
00118 start = end
00119 end += 12
00120 (_x.point.header.seq, _x.point.header.stamp.secs, _x.point.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00121 start = end
00122 end += 4
00123 (length,) = _struct_I.unpack(str[start:end])
00124 start = end
00125 end += length
00126 self.point.header.frame_id = str[start:end]
00127 _x = self
00128 start = end
00129 end += 40
00130 (_x.point.vector.x, _x.point.vector.y, _x.point.vector.z, _x.width, _x.height,) = _struct_3d2q.unpack(str[start:end])
00131 return self
00132 except struct.error, e:
00133 raise roslib.message.DeserializationError(e)
00134
00135
00136 def serialize_numpy(self, buff, numpy):
00137 """
00138 serialize message with numpy array types into buffer
00139 @param buff: buffer
00140 @type buff: StringIO
00141 @param numpy: numpy python module
00142 @type numpy module
00143 """
00144 try:
00145 _x = self
00146 buff.write(_struct_3I.pack(_x.point.header.seq, _x.point.header.stamp.secs, _x.point.header.stamp.nsecs))
00147 _x = self.point.header.frame_id
00148 length = len(_x)
00149 buff.write(struct.pack('<I%ss'%length, length, _x))
00150 _x = self
00151 buff.write(_struct_3d2q.pack(_x.point.vector.x, _x.point.vector.y, _x.point.vector.z, _x.width, _x.height))
00152 except struct.error, se: self._check_types(se)
00153 except TypeError, te: self._check_types(te)
00154
00155 def deserialize_numpy(self, str, numpy):
00156 """
00157 unpack serialized message in str into this message instance using numpy for array types
00158 @param str: byte array of serialized message
00159 @type str: str
00160 @param numpy: numpy python module
00161 @type numpy: module
00162 """
00163 try:
00164 if self.point is None:
00165 self.point = geometry_msgs.msg.Vector3Stamped()
00166 end = 0
00167 _x = self
00168 start = end
00169 end += 12
00170 (_x.point.header.seq, _x.point.header.stamp.secs, _x.point.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00171 start = end
00172 end += 4
00173 (length,) = _struct_I.unpack(str[start:end])
00174 start = end
00175 end += length
00176 self.point.header.frame_id = str[start:end]
00177 _x = self
00178 start = end
00179 end += 40
00180 (_x.point.vector.x, _x.point.vector.y, _x.point.vector.z, _x.width, _x.height,) = _struct_3d2q.unpack(str[start:end])
00181 return self
00182 except struct.error, e:
00183 raise roslib.message.DeserializationError(e)
00184
00185 _struct_I = roslib.message.struct_I
00186 _struct_3I = struct.Struct("<3I")
00187 _struct_3d2q = struct.Struct("<3d2q")
00188 """autogenerated by genmsg_py from PlaneInRegionResponse.msg. Do not edit."""
00189 import roslib.message
00190 import struct
00191
00192 import fast_plane_detection.msg
00193 import geometry_msgs.msg
00194 import std_msgs.msg
00195
00196 class PlaneInRegionResponse(roslib.message.Message):
00197 _md5sum = "fc03c1721a8ecac7e524ced76187dcd4"
00198 _type = "fast_plane_detection/PlaneInRegionResponse"
00199 _has_header = False
00200 _full_text = """
00201 fast_plane_detection/Plane plane
00202
00203
00204 ================================================================================
00205 MSG: fast_plane_detection/Plane
00206 # Informs that a plane has been detected at a given location
00207
00208 # The pose gives you the transform that take you to the coordinate system
00209 # of the plane, with the origin somewhere in the plane and the
00210 # z axis normal to the plane
00211 geometry_msgs/PoseStamped pose
00212
00213 # Point + normal vector of the plane
00214 geometry_msgs/PointStamped plane_point
00215 geometry_msgs/Vector3Stamped normal
00216 float64 plane_d
00217
00218 geometry_msgs/PointStamped slave_point
00219
00220
00221 # These values give you the observed extents of the plane, along x and y,
00222 # in the plane's own coordinate system (above)
00223 # there is no guarantee that the origin of the plane coordinate system is
00224 # inside the boundary defined by these values.
00225 geometry_msgs/Point32 top_left
00226 geometry_msgs/Point32 top_right
00227
00228 geometry_msgs/Point32 bottom_left
00229 geometry_msgs/Point32 bottom_right
00230
00231 # There is no guarantee that the plane doe NOT extend further than these
00232 # values; this is just as far as we've observed it.
00233
00234 # Whether the detection has succeeded or failed
00235 int32 SUCCESS = 1
00236 int32 FEW_INLIERS = 2
00237 int32 NO_PLANE = 3
00238 int32 OTHER_ERROR = 4
00239 int32 result
00240 int32 percentage_inliers
00241
00242 # confidence indicators of plane detection
00243 # mean squared error
00244 float32 error
00245 ================================================================================
00246 MSG: geometry_msgs/PoseStamped
00247 # A Pose with reference coordinate frame and timestamp
00248 Header header
00249 Pose pose
00250
00251 ================================================================================
00252 MSG: std_msgs/Header
00253 # Standard metadata for higher-level stamped data types.
00254 # This is generally used to communicate timestamped data
00255 # in a particular coordinate frame.
00256 #
00257 # sequence ID: consecutively increasing ID
00258 uint32 seq
00259 #Two-integer timestamp that is expressed as:
00260 # * stamp.secs: seconds (stamp_secs) since epoch
00261 # * stamp.nsecs: nanoseconds since stamp_secs
00262 # time-handling sugar is provided by the client library
00263 time stamp
00264 #Frame this data is associated with
00265 # 0: no frame
00266 # 1: global frame
00267 string frame_id
00268
00269 ================================================================================
00270 MSG: geometry_msgs/Pose
00271 # A representation of pose in free space, composed of postion and orientation.
00272 Point position
00273 Quaternion orientation
00274
00275 ================================================================================
00276 MSG: geometry_msgs/Point
00277 # This contains the position of a point in free space
00278 float64 x
00279 float64 y
00280 float64 z
00281
00282 ================================================================================
00283 MSG: geometry_msgs/Quaternion
00284 # This represents an orientation in free space in quaternion form.
00285
00286 float64 x
00287 float64 y
00288 float64 z
00289 float64 w
00290
00291 ================================================================================
00292 MSG: geometry_msgs/PointStamped
00293 # This represents a Point with reference coordinate frame and timestamp
00294 Header header
00295 Point point
00296
00297 ================================================================================
00298 MSG: geometry_msgs/Vector3Stamped
00299 # This represents a Vector3 with reference coordinate frame and timestamp
00300 Header header
00301 Vector3 vector
00302
00303 ================================================================================
00304 MSG: geometry_msgs/Vector3
00305 # This represents a vector in free space.
00306
00307 float64 x
00308 float64 y
00309 float64 z
00310 ================================================================================
00311 MSG: geometry_msgs/Point32
00312 # This contains the position of a point in free space(with 32 bits of precision).
00313 # It is recommeded to use Point wherever possible instead of Point32.
00314 #
00315 # This recommendation is to promote interoperability.
00316 #
00317 # This message is designed to take up less space when sending
00318 # lots of points at once, as in the case of a PointCloud.
00319
00320 float32 x
00321 float32 y
00322 float32 z
00323 """
00324 __slots__ = ['plane']
00325 _slot_types = ['fast_plane_detection/Plane']
00326
00327 def __init__(self, *args, **kwds):
00328 """
00329 Constructor. Any message fields that are implicitly/explicitly
00330 set to None will be assigned a default value. The recommend
00331 use is keyword arguments as this is more robust to future message
00332 changes. You cannot mix in-order arguments and keyword arguments.
00333
00334 The available fields are:
00335 plane
00336
00337 @param args: complete set of field values, in .msg order
00338 @param kwds: use keyword arguments corresponding to message field names
00339 to set specific fields.
00340 """
00341 if args or kwds:
00342 super(PlaneInRegionResponse, self).__init__(*args, **kwds)
00343
00344 if self.plane is None:
00345 self.plane = fast_plane_detection.msg.Plane()
00346 else:
00347 self.plane = fast_plane_detection.msg.Plane()
00348
00349 def _get_types(self):
00350 """
00351 internal API method
00352 """
00353 return self._slot_types
00354
00355 def serialize(self, buff):
00356 """
00357 serialize message into buffer
00358 @param buff: buffer
00359 @type buff: StringIO
00360 """
00361 try:
00362 _x = self
00363 buff.write(_struct_3I.pack(_x.plane.pose.header.seq, _x.plane.pose.header.stamp.secs, _x.plane.pose.header.stamp.nsecs))
00364 _x = self.plane.pose.header.frame_id
00365 length = len(_x)
00366 buff.write(struct.pack('<I%ss'%length, length, _x))
00367 _x = self
00368 buff.write(_struct_7d3I.pack(_x.plane.pose.pose.position.x, _x.plane.pose.pose.position.y, _x.plane.pose.pose.position.z, _x.plane.pose.pose.orientation.x, _x.plane.pose.pose.orientation.y, _x.plane.pose.pose.orientation.z, _x.plane.pose.pose.orientation.w, _x.plane.plane_point.header.seq, _x.plane.plane_point.header.stamp.secs, _x.plane.plane_point.header.stamp.nsecs))
00369 _x = self.plane.plane_point.header.frame_id
00370 length = len(_x)
00371 buff.write(struct.pack('<I%ss'%length, length, _x))
00372 _x = self
00373 buff.write(_struct_3d3I.pack(_x.plane.plane_point.point.x, _x.plane.plane_point.point.y, _x.plane.plane_point.point.z, _x.plane.normal.header.seq, _x.plane.normal.header.stamp.secs, _x.plane.normal.header.stamp.nsecs))
00374 _x = self.plane.normal.header.frame_id
00375 length = len(_x)
00376 buff.write(struct.pack('<I%ss'%length, length, _x))
00377 _x = self
00378 buff.write(_struct_4d3I.pack(_x.plane.normal.vector.x, _x.plane.normal.vector.y, _x.plane.normal.vector.z, _x.plane.plane_d, _x.plane.slave_point.header.seq, _x.plane.slave_point.header.stamp.secs, _x.plane.slave_point.header.stamp.nsecs))
00379 _x = self.plane.slave_point.header.frame_id
00380 length = len(_x)
00381 buff.write(struct.pack('<I%ss'%length, length, _x))
00382 _x = self
00383 buff.write(_struct_3d12f2if.pack(_x.plane.slave_point.point.x, _x.plane.slave_point.point.y, _x.plane.slave_point.point.z, _x.plane.top_left.x, _x.plane.top_left.y, _x.plane.top_left.z, _x.plane.top_right.x, _x.plane.top_right.y, _x.plane.top_right.z, _x.plane.bottom_left.x, _x.plane.bottom_left.y, _x.plane.bottom_left.z, _x.plane.bottom_right.x, _x.plane.bottom_right.y, _x.plane.bottom_right.z, _x.plane.result, _x.plane.percentage_inliers, _x.plane.error))
00384 except struct.error, se: self._check_types(se)
00385 except TypeError, te: self._check_types(te)
00386
00387 def deserialize(self, str):
00388 """
00389 unpack serialized message in str into this message instance
00390 @param str: byte array of serialized message
00391 @type str: str
00392 """
00393 try:
00394 if self.plane is None:
00395 self.plane = fast_plane_detection.msg.Plane()
00396 end = 0
00397 _x = self
00398 start = end
00399 end += 12
00400 (_x.plane.pose.header.seq, _x.plane.pose.header.stamp.secs, _x.plane.pose.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00401 start = end
00402 end += 4
00403 (length,) = _struct_I.unpack(str[start:end])
00404 start = end
00405 end += length
00406 self.plane.pose.header.frame_id = str[start:end]
00407 _x = self
00408 start = end
00409 end += 68
00410 (_x.plane.pose.pose.position.x, _x.plane.pose.pose.position.y, _x.plane.pose.pose.position.z, _x.plane.pose.pose.orientation.x, _x.plane.pose.pose.orientation.y, _x.plane.pose.pose.orientation.z, _x.plane.pose.pose.orientation.w, _x.plane.plane_point.header.seq, _x.plane.plane_point.header.stamp.secs, _x.plane.plane_point.header.stamp.nsecs,) = _struct_7d3I.unpack(str[start:end])
00411 start = end
00412 end += 4
00413 (length,) = _struct_I.unpack(str[start:end])
00414 start = end
00415 end += length
00416 self.plane.plane_point.header.frame_id = str[start:end]
00417 _x = self
00418 start = end
00419 end += 36
00420 (_x.plane.plane_point.point.x, _x.plane.plane_point.point.y, _x.plane.plane_point.point.z, _x.plane.normal.header.seq, _x.plane.normal.header.stamp.secs, _x.plane.normal.header.stamp.nsecs,) = _struct_3d3I.unpack(str[start:end])
00421 start = end
00422 end += 4
00423 (length,) = _struct_I.unpack(str[start:end])
00424 start = end
00425 end += length
00426 self.plane.normal.header.frame_id = str[start:end]
00427 _x = self
00428 start = end
00429 end += 44
00430 (_x.plane.normal.vector.x, _x.plane.normal.vector.y, _x.plane.normal.vector.z, _x.plane.plane_d, _x.plane.slave_point.header.seq, _x.plane.slave_point.header.stamp.secs, _x.plane.slave_point.header.stamp.nsecs,) = _struct_4d3I.unpack(str[start:end])
00431 start = end
00432 end += 4
00433 (length,) = _struct_I.unpack(str[start:end])
00434 start = end
00435 end += length
00436 self.plane.slave_point.header.frame_id = str[start:end]
00437 _x = self
00438 start = end
00439 end += 84
00440 (_x.plane.slave_point.point.x, _x.plane.slave_point.point.y, _x.plane.slave_point.point.z, _x.plane.top_left.x, _x.plane.top_left.y, _x.plane.top_left.z, _x.plane.top_right.x, _x.plane.top_right.y, _x.plane.top_right.z, _x.plane.bottom_left.x, _x.plane.bottom_left.y, _x.plane.bottom_left.z, _x.plane.bottom_right.x, _x.plane.bottom_right.y, _x.plane.bottom_right.z, _x.plane.result, _x.plane.percentage_inliers, _x.plane.error,) = _struct_3d12f2if.unpack(str[start:end])
00441 return self
00442 except struct.error, e:
00443 raise roslib.message.DeserializationError(e)
00444
00445
00446 def serialize_numpy(self, buff, numpy):
00447 """
00448 serialize message with numpy array types into buffer
00449 @param buff: buffer
00450 @type buff: StringIO
00451 @param numpy: numpy python module
00452 @type numpy module
00453 """
00454 try:
00455 _x = self
00456 buff.write(_struct_3I.pack(_x.plane.pose.header.seq, _x.plane.pose.header.stamp.secs, _x.plane.pose.header.stamp.nsecs))
00457 _x = self.plane.pose.header.frame_id
00458 length = len(_x)
00459 buff.write(struct.pack('<I%ss'%length, length, _x))
00460 _x = self
00461 buff.write(_struct_7d3I.pack(_x.plane.pose.pose.position.x, _x.plane.pose.pose.position.y, _x.plane.pose.pose.position.z, _x.plane.pose.pose.orientation.x, _x.plane.pose.pose.orientation.y, _x.plane.pose.pose.orientation.z, _x.plane.pose.pose.orientation.w, _x.plane.plane_point.header.seq, _x.plane.plane_point.header.stamp.secs, _x.plane.plane_point.header.stamp.nsecs))
00462 _x = self.plane.plane_point.header.frame_id
00463 length = len(_x)
00464 buff.write(struct.pack('<I%ss'%length, length, _x))
00465 _x = self
00466 buff.write(_struct_3d3I.pack(_x.plane.plane_point.point.x, _x.plane.plane_point.point.y, _x.plane.plane_point.point.z, _x.plane.normal.header.seq, _x.plane.normal.header.stamp.secs, _x.plane.normal.header.stamp.nsecs))
00467 _x = self.plane.normal.header.frame_id
00468 length = len(_x)
00469 buff.write(struct.pack('<I%ss'%length, length, _x))
00470 _x = self
00471 buff.write(_struct_4d3I.pack(_x.plane.normal.vector.x, _x.plane.normal.vector.y, _x.plane.normal.vector.z, _x.plane.plane_d, _x.plane.slave_point.header.seq, _x.plane.slave_point.header.stamp.secs, _x.plane.slave_point.header.stamp.nsecs))
00472 _x = self.plane.slave_point.header.frame_id
00473 length = len(_x)
00474 buff.write(struct.pack('<I%ss'%length, length, _x))
00475 _x = self
00476 buff.write(_struct_3d12f2if.pack(_x.plane.slave_point.point.x, _x.plane.slave_point.point.y, _x.plane.slave_point.point.z, _x.plane.top_left.x, _x.plane.top_left.y, _x.plane.top_left.z, _x.plane.top_right.x, _x.plane.top_right.y, _x.plane.top_right.z, _x.plane.bottom_left.x, _x.plane.bottom_left.y, _x.plane.bottom_left.z, _x.plane.bottom_right.x, _x.plane.bottom_right.y, _x.plane.bottom_right.z, _x.plane.result, _x.plane.percentage_inliers, _x.plane.error))
00477 except struct.error, se: self._check_types(se)
00478 except TypeError, te: self._check_types(te)
00479
00480 def deserialize_numpy(self, str, numpy):
00481 """
00482 unpack serialized message in str into this message instance using numpy for array types
00483 @param str: byte array of serialized message
00484 @type str: str
00485 @param numpy: numpy python module
00486 @type numpy: module
00487 """
00488 try:
00489 if self.plane is None:
00490 self.plane = fast_plane_detection.msg.Plane()
00491 end = 0
00492 _x = self
00493 start = end
00494 end += 12
00495 (_x.plane.pose.header.seq, _x.plane.pose.header.stamp.secs, _x.plane.pose.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00496 start = end
00497 end += 4
00498 (length,) = _struct_I.unpack(str[start:end])
00499 start = end
00500 end += length
00501 self.plane.pose.header.frame_id = str[start:end]
00502 _x = self
00503 start = end
00504 end += 68
00505 (_x.plane.pose.pose.position.x, _x.plane.pose.pose.position.y, _x.plane.pose.pose.position.z, _x.plane.pose.pose.orientation.x, _x.plane.pose.pose.orientation.y, _x.plane.pose.pose.orientation.z, _x.plane.pose.pose.orientation.w, _x.plane.plane_point.header.seq, _x.plane.plane_point.header.stamp.secs, _x.plane.plane_point.header.stamp.nsecs,) = _struct_7d3I.unpack(str[start:end])
00506 start = end
00507 end += 4
00508 (length,) = _struct_I.unpack(str[start:end])
00509 start = end
00510 end += length
00511 self.plane.plane_point.header.frame_id = str[start:end]
00512 _x = self
00513 start = end
00514 end += 36
00515 (_x.plane.plane_point.point.x, _x.plane.plane_point.point.y, _x.plane.plane_point.point.z, _x.plane.normal.header.seq, _x.plane.normal.header.stamp.secs, _x.plane.normal.header.stamp.nsecs,) = _struct_3d3I.unpack(str[start:end])
00516 start = end
00517 end += 4
00518 (length,) = _struct_I.unpack(str[start:end])
00519 start = end
00520 end += length
00521 self.plane.normal.header.frame_id = str[start:end]
00522 _x = self
00523 start = end
00524 end += 44
00525 (_x.plane.normal.vector.x, _x.plane.normal.vector.y, _x.plane.normal.vector.z, _x.plane.plane_d, _x.plane.slave_point.header.seq, _x.plane.slave_point.header.stamp.secs, _x.plane.slave_point.header.stamp.nsecs,) = _struct_4d3I.unpack(str[start:end])
00526 start = end
00527 end += 4
00528 (length,) = _struct_I.unpack(str[start:end])
00529 start = end
00530 end += length
00531 self.plane.slave_point.header.frame_id = str[start:end]
00532 _x = self
00533 start = end
00534 end += 84
00535 (_x.plane.slave_point.point.x, _x.plane.slave_point.point.y, _x.plane.slave_point.point.z, _x.plane.top_left.x, _x.plane.top_left.y, _x.plane.top_left.z, _x.plane.top_right.x, _x.plane.top_right.y, _x.plane.top_right.z, _x.plane.bottom_left.x, _x.plane.bottom_left.y, _x.plane.bottom_left.z, _x.plane.bottom_right.x, _x.plane.bottom_right.y, _x.plane.bottom_right.z, _x.plane.result, _x.plane.percentage_inliers, _x.plane.error,) = _struct_3d12f2if.unpack(str[start:end])
00536 return self
00537 except struct.error, e:
00538 raise roslib.message.DeserializationError(e)
00539
00540 _struct_I = roslib.message.struct_I
00541 _struct_3d3I = struct.Struct("<3d3I")
00542 _struct_3I = struct.Struct("<3I")
00543 _struct_4d3I = struct.Struct("<4d3I")
00544 _struct_7d3I = struct.Struct("<7d3I")
00545 _struct_3d12f2if = struct.Struct("<3d12f2if")
00546 class PlaneInRegion(roslib.message.ServiceDefinition):
00547 _type = 'fast_plane_detection/PlaneInRegion'
00548 _md5sum = '226b53e3d5df28a414da0d1d86fc1e00'
00549 _request_class = PlaneInRegionRequest
00550 _response_class = PlaneInRegionResponse