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