00001 """autogenerated by genpy from cob_object_detection_msgs/TrainObjectAction.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 cob_object_detection_msgs.msg
00008 import genpy
00009 import actionlib_msgs.msg
00010 import std_msgs.msg
00011
00012 class TrainObjectAction(genpy.Message):
00013 _md5sum = "989cf87235aa440d07ac51414c297bdd"
00014 _type = "cob_object_detection_msgs/TrainObjectAction"
00015 _has_header = False
00016 _full_text = """# ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00017
00018 TrainObjectActionGoal action_goal
00019 TrainObjectActionResult action_result
00020 TrainObjectActionFeedback action_feedback
00021
00022 ================================================================================
00023 MSG: cob_object_detection_msgs/TrainObjectActionGoal
00024 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00025
00026 Header header
00027 actionlib_msgs/GoalID goal_id
00028 TrainObjectGoal goal
00029
00030 ================================================================================
00031 MSG: std_msgs/Header
00032 # Standard metadata for higher-level stamped data types.
00033 # This is generally used to communicate timestamped data
00034 # in a particular coordinate frame.
00035 #
00036 # sequence ID: consecutively increasing ID
00037 uint32 seq
00038 #Two-integer timestamp that is expressed as:
00039 # * stamp.secs: seconds (stamp_secs) since epoch
00040 # * stamp.nsecs: nanoseconds since stamp_secs
00041 # time-handling sugar is provided by the client library
00042 time stamp
00043 #Frame this data is associated with
00044 # 0: no frame
00045 # 1: global frame
00046 string frame_id
00047
00048 ================================================================================
00049 MSG: actionlib_msgs/GoalID
00050 # The stamp should store the time at which this goal was requested.
00051 # It is used by an action server when it tries to preempt all
00052 # goals that were requested before a certain time
00053 time stamp
00054
00055 # The id provides a way to associate feedback and
00056 # result message with specific goal requests. The id
00057 # specified must be unique.
00058 string id
00059
00060
00061 ================================================================================
00062 MSG: cob_object_detection_msgs/TrainObjectGoal
00063 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00064 # The goal
00065 string object_name
00066
00067 ================================================================================
00068 MSG: cob_object_detection_msgs/TrainObjectActionResult
00069 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00070
00071 Header header
00072 actionlib_msgs/GoalStatus status
00073 TrainObjectResult result
00074
00075 ================================================================================
00076 MSG: actionlib_msgs/GoalStatus
00077 GoalID goal_id
00078 uint8 status
00079 uint8 PENDING = 0 # The goal has yet to be processed by the action server
00080 uint8 ACTIVE = 1 # The goal is currently being processed by the action server
00081 uint8 PREEMPTED = 2 # The goal received a cancel request after it started executing
00082 # and has since completed its execution (Terminal State)
00083 uint8 SUCCEEDED = 3 # The goal was achieved successfully by the action server (Terminal State)
00084 uint8 ABORTED = 4 # The goal was aborted during execution by the action server due
00085 # to some failure (Terminal State)
00086 uint8 REJECTED = 5 # The goal was rejected by the action server without being processed,
00087 # because the goal was unattainable or invalid (Terminal State)
00088 uint8 PREEMPTING = 6 # The goal received a cancel request after it started executing
00089 # and has not yet completed execution
00090 uint8 RECALLING = 7 # The goal received a cancel request before it started executing,
00091 # but the action server has not yet confirmed that the goal is canceled
00092 uint8 RECALLED = 8 # The goal received a cancel request before it started executing
00093 # and was successfully cancelled (Terminal State)
00094 uint8 LOST = 9 # An action client can determine that a goal is LOST. This should not be
00095 # sent over the wire by an action server
00096
00097 #Allow for the user to associate a string with GoalStatus for debugging
00098 string text
00099
00100
00101 ================================================================================
00102 MSG: cob_object_detection_msgs/TrainObjectResult
00103 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00104 # The results
00105
00106 ================================================================================
00107 MSG: cob_object_detection_msgs/TrainObjectActionFeedback
00108 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00109
00110 Header header
00111 actionlib_msgs/GoalStatus status
00112 TrainObjectFeedback feedback
00113
00114 ================================================================================
00115 MSG: cob_object_detection_msgs/TrainObjectFeedback
00116 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00117 # The feedback
00118 float32 percent_complete
00119
00120
00121 """
00122 __slots__ = ['action_goal','action_result','action_feedback']
00123 _slot_types = ['cob_object_detection_msgs/TrainObjectActionGoal','cob_object_detection_msgs/TrainObjectActionResult','cob_object_detection_msgs/TrainObjectActionFeedback']
00124
00125 def __init__(self, *args, **kwds):
00126 """
00127 Constructor. Any message fields that are implicitly/explicitly
00128 set to None will be assigned a default value. The recommend
00129 use is keyword arguments as this is more robust to future message
00130 changes. You cannot mix in-order arguments and keyword arguments.
00131
00132 The available fields are:
00133 action_goal,action_result,action_feedback
00134
00135 :param args: complete set of field values, in .msg order
00136 :param kwds: use keyword arguments corresponding to message field names
00137 to set specific fields.
00138 """
00139 if args or kwds:
00140 super(TrainObjectAction, self).__init__(*args, **kwds)
00141
00142 if self.action_goal is None:
00143 self.action_goal = cob_object_detection_msgs.msg.TrainObjectActionGoal()
00144 if self.action_result is None:
00145 self.action_result = cob_object_detection_msgs.msg.TrainObjectActionResult()
00146 if self.action_feedback is None:
00147 self.action_feedback = cob_object_detection_msgs.msg.TrainObjectActionFeedback()
00148 else:
00149 self.action_goal = cob_object_detection_msgs.msg.TrainObjectActionGoal()
00150 self.action_result = cob_object_detection_msgs.msg.TrainObjectActionResult()
00151 self.action_feedback = cob_object_detection_msgs.msg.TrainObjectActionFeedback()
00152
00153 def _get_types(self):
00154 """
00155 internal API method
00156 """
00157 return self._slot_types
00158
00159 def serialize(self, buff):
00160 """
00161 serialize message into buffer
00162 :param buff: buffer, ``StringIO``
00163 """
00164 try:
00165 _x = self
00166 buff.write(_struct_3I.pack(_x.action_goal.header.seq, _x.action_goal.header.stamp.secs, _x.action_goal.header.stamp.nsecs))
00167 _x = self.action_goal.header.frame_id
00168 length = len(_x)
00169 if python3 or type(_x) == unicode:
00170 _x = _x.encode('utf-8')
00171 length = len(_x)
00172 buff.write(struct.pack('<I%ss'%length, length, _x))
00173 _x = self
00174 buff.write(_struct_2I.pack(_x.action_goal.goal_id.stamp.secs, _x.action_goal.goal_id.stamp.nsecs))
00175 _x = self.action_goal.goal_id.id
00176 length = len(_x)
00177 if python3 or type(_x) == unicode:
00178 _x = _x.encode('utf-8')
00179 length = len(_x)
00180 buff.write(struct.pack('<I%ss'%length, length, _x))
00181 _x = self.action_goal.goal.object_name
00182 length = len(_x)
00183 if python3 or type(_x) == unicode:
00184 _x = _x.encode('utf-8')
00185 length = len(_x)
00186 buff.write(struct.pack('<I%ss'%length, length, _x))
00187 _x = self
00188 buff.write(_struct_3I.pack(_x.action_result.header.seq, _x.action_result.header.stamp.secs, _x.action_result.header.stamp.nsecs))
00189 _x = self.action_result.header.frame_id
00190 length = len(_x)
00191 if python3 or type(_x) == unicode:
00192 _x = _x.encode('utf-8')
00193 length = len(_x)
00194 buff.write(struct.pack('<I%ss'%length, length, _x))
00195 _x = self
00196 buff.write(_struct_2I.pack(_x.action_result.status.goal_id.stamp.secs, _x.action_result.status.goal_id.stamp.nsecs))
00197 _x = self.action_result.status.goal_id.id
00198 length = len(_x)
00199 if python3 or type(_x) == unicode:
00200 _x = _x.encode('utf-8')
00201 length = len(_x)
00202 buff.write(struct.pack('<I%ss'%length, length, _x))
00203 buff.write(_struct_B.pack(self.action_result.status.status))
00204 _x = self.action_result.status.text
00205 length = len(_x)
00206 if python3 or type(_x) == unicode:
00207 _x = _x.encode('utf-8')
00208 length = len(_x)
00209 buff.write(struct.pack('<I%ss'%length, length, _x))
00210 _x = self
00211 buff.write(_struct_3I.pack(_x.action_feedback.header.seq, _x.action_feedback.header.stamp.secs, _x.action_feedback.header.stamp.nsecs))
00212 _x = self.action_feedback.header.frame_id
00213 length = len(_x)
00214 if python3 or type(_x) == unicode:
00215 _x = _x.encode('utf-8')
00216 length = len(_x)
00217 buff.write(struct.pack('<I%ss'%length, length, _x))
00218 _x = self
00219 buff.write(_struct_2I.pack(_x.action_feedback.status.goal_id.stamp.secs, _x.action_feedback.status.goal_id.stamp.nsecs))
00220 _x = self.action_feedback.status.goal_id.id
00221 length = len(_x)
00222 if python3 or type(_x) == unicode:
00223 _x = _x.encode('utf-8')
00224 length = len(_x)
00225 buff.write(struct.pack('<I%ss'%length, length, _x))
00226 buff.write(_struct_B.pack(self.action_feedback.status.status))
00227 _x = self.action_feedback.status.text
00228 length = len(_x)
00229 if python3 or type(_x) == unicode:
00230 _x = _x.encode('utf-8')
00231 length = len(_x)
00232 buff.write(struct.pack('<I%ss'%length, length, _x))
00233 buff.write(_struct_f.pack(self.action_feedback.feedback.percent_complete))
00234 except struct.error as se: self._check_types(se)
00235 except TypeError as te: self._check_types(te)
00236
00237 def deserialize(self, str):
00238 """
00239 unpack serialized message in str into this message instance
00240 :param str: byte array of serialized message, ``str``
00241 """
00242 try:
00243 if self.action_goal is None:
00244 self.action_goal = cob_object_detection_msgs.msg.TrainObjectActionGoal()
00245 if self.action_result is None:
00246 self.action_result = cob_object_detection_msgs.msg.TrainObjectActionResult()
00247 if self.action_feedback is None:
00248 self.action_feedback = cob_object_detection_msgs.msg.TrainObjectActionFeedback()
00249 end = 0
00250 _x = self
00251 start = end
00252 end += 12
00253 (_x.action_goal.header.seq, _x.action_goal.header.stamp.secs, _x.action_goal.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00254 start = end
00255 end += 4
00256 (length,) = _struct_I.unpack(str[start:end])
00257 start = end
00258 end += length
00259 if python3:
00260 self.action_goal.header.frame_id = str[start:end].decode('utf-8')
00261 else:
00262 self.action_goal.header.frame_id = str[start:end]
00263 _x = self
00264 start = end
00265 end += 8
00266 (_x.action_goal.goal_id.stamp.secs, _x.action_goal.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00267 start = end
00268 end += 4
00269 (length,) = _struct_I.unpack(str[start:end])
00270 start = end
00271 end += length
00272 if python3:
00273 self.action_goal.goal_id.id = str[start:end].decode('utf-8')
00274 else:
00275 self.action_goal.goal_id.id = str[start:end]
00276 start = end
00277 end += 4
00278 (length,) = _struct_I.unpack(str[start:end])
00279 start = end
00280 end += length
00281 if python3:
00282 self.action_goal.goal.object_name = str[start:end].decode('utf-8')
00283 else:
00284 self.action_goal.goal.object_name = str[start:end]
00285 _x = self
00286 start = end
00287 end += 12
00288 (_x.action_result.header.seq, _x.action_result.header.stamp.secs, _x.action_result.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00289 start = end
00290 end += 4
00291 (length,) = _struct_I.unpack(str[start:end])
00292 start = end
00293 end += length
00294 if python3:
00295 self.action_result.header.frame_id = str[start:end].decode('utf-8')
00296 else:
00297 self.action_result.header.frame_id = str[start:end]
00298 _x = self
00299 start = end
00300 end += 8
00301 (_x.action_result.status.goal_id.stamp.secs, _x.action_result.status.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00302 start = end
00303 end += 4
00304 (length,) = _struct_I.unpack(str[start:end])
00305 start = end
00306 end += length
00307 if python3:
00308 self.action_result.status.goal_id.id = str[start:end].decode('utf-8')
00309 else:
00310 self.action_result.status.goal_id.id = str[start:end]
00311 start = end
00312 end += 1
00313 (self.action_result.status.status,) = _struct_B.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.action_result.status.text = str[start:end].decode('utf-8')
00321 else:
00322 self.action_result.status.text = str[start:end]
00323 _x = self
00324 start = end
00325 end += 12
00326 (_x.action_feedback.header.seq, _x.action_feedback.header.stamp.secs, _x.action_feedback.header.stamp.nsecs,) = _struct_3I.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.action_feedback.header.frame_id = str[start:end].decode('utf-8')
00334 else:
00335 self.action_feedback.header.frame_id = str[start:end]
00336 _x = self
00337 start = end
00338 end += 8
00339 (_x.action_feedback.status.goal_id.stamp.secs, _x.action_feedback.status.goal_id.stamp.nsecs,) = _struct_2I.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.action_feedback.status.goal_id.id = str[start:end].decode('utf-8')
00347 else:
00348 self.action_feedback.status.goal_id.id = str[start:end]
00349 start = end
00350 end += 1
00351 (self.action_feedback.status.status,) = _struct_B.unpack(str[start:end])
00352 start = end
00353 end += 4
00354 (length,) = _struct_I.unpack(str[start:end])
00355 start = end
00356 end += length
00357 if python3:
00358 self.action_feedback.status.text = str[start:end].decode('utf-8')
00359 else:
00360 self.action_feedback.status.text = str[start:end]
00361 start = end
00362 end += 4
00363 (self.action_feedback.feedback.percent_complete,) = _struct_f.unpack(str[start:end])
00364 return self
00365 except struct.error as e:
00366 raise genpy.DeserializationError(e)
00367
00368
00369 def serialize_numpy(self, buff, numpy):
00370 """
00371 serialize message with numpy array types into buffer
00372 :param buff: buffer, ``StringIO``
00373 :param numpy: numpy python module
00374 """
00375 try:
00376 _x = self
00377 buff.write(_struct_3I.pack(_x.action_goal.header.seq, _x.action_goal.header.stamp.secs, _x.action_goal.header.stamp.nsecs))
00378 _x = self.action_goal.header.frame_id
00379 length = len(_x)
00380 if python3 or type(_x) == unicode:
00381 _x = _x.encode('utf-8')
00382 length = len(_x)
00383 buff.write(struct.pack('<I%ss'%length, length, _x))
00384 _x = self
00385 buff.write(_struct_2I.pack(_x.action_goal.goal_id.stamp.secs, _x.action_goal.goal_id.stamp.nsecs))
00386 _x = self.action_goal.goal_id.id
00387 length = len(_x)
00388 if python3 or type(_x) == unicode:
00389 _x = _x.encode('utf-8')
00390 length = len(_x)
00391 buff.write(struct.pack('<I%ss'%length, length, _x))
00392 _x = self.action_goal.goal.object_name
00393 length = len(_x)
00394 if python3 or type(_x) == unicode:
00395 _x = _x.encode('utf-8')
00396 length = len(_x)
00397 buff.write(struct.pack('<I%ss'%length, length, _x))
00398 _x = self
00399 buff.write(_struct_3I.pack(_x.action_result.header.seq, _x.action_result.header.stamp.secs, _x.action_result.header.stamp.nsecs))
00400 _x = self.action_result.header.frame_id
00401 length = len(_x)
00402 if python3 or type(_x) == unicode:
00403 _x = _x.encode('utf-8')
00404 length = len(_x)
00405 buff.write(struct.pack('<I%ss'%length, length, _x))
00406 _x = self
00407 buff.write(_struct_2I.pack(_x.action_result.status.goal_id.stamp.secs, _x.action_result.status.goal_id.stamp.nsecs))
00408 _x = self.action_result.status.goal_id.id
00409 length = len(_x)
00410 if python3 or type(_x) == unicode:
00411 _x = _x.encode('utf-8')
00412 length = len(_x)
00413 buff.write(struct.pack('<I%ss'%length, length, _x))
00414 buff.write(_struct_B.pack(self.action_result.status.status))
00415 _x = self.action_result.status.text
00416 length = len(_x)
00417 if python3 or type(_x) == unicode:
00418 _x = _x.encode('utf-8')
00419 length = len(_x)
00420 buff.write(struct.pack('<I%ss'%length, length, _x))
00421 _x = self
00422 buff.write(_struct_3I.pack(_x.action_feedback.header.seq, _x.action_feedback.header.stamp.secs, _x.action_feedback.header.stamp.nsecs))
00423 _x = self.action_feedback.header.frame_id
00424 length = len(_x)
00425 if python3 or type(_x) == unicode:
00426 _x = _x.encode('utf-8')
00427 length = len(_x)
00428 buff.write(struct.pack('<I%ss'%length, length, _x))
00429 _x = self
00430 buff.write(_struct_2I.pack(_x.action_feedback.status.goal_id.stamp.secs, _x.action_feedback.status.goal_id.stamp.nsecs))
00431 _x = self.action_feedback.status.goal_id.id
00432 length = len(_x)
00433 if python3 or type(_x) == unicode:
00434 _x = _x.encode('utf-8')
00435 length = len(_x)
00436 buff.write(struct.pack('<I%ss'%length, length, _x))
00437 buff.write(_struct_B.pack(self.action_feedback.status.status))
00438 _x = self.action_feedback.status.text
00439 length = len(_x)
00440 if python3 or type(_x) == unicode:
00441 _x = _x.encode('utf-8')
00442 length = len(_x)
00443 buff.write(struct.pack('<I%ss'%length, length, _x))
00444 buff.write(_struct_f.pack(self.action_feedback.feedback.percent_complete))
00445 except struct.error as se: self._check_types(se)
00446 except TypeError as te: self._check_types(te)
00447
00448 def deserialize_numpy(self, str, numpy):
00449 """
00450 unpack serialized message in str into this message instance using numpy for array types
00451 :param str: byte array of serialized message, ``str``
00452 :param numpy: numpy python module
00453 """
00454 try:
00455 if self.action_goal is None:
00456 self.action_goal = cob_object_detection_msgs.msg.TrainObjectActionGoal()
00457 if self.action_result is None:
00458 self.action_result = cob_object_detection_msgs.msg.TrainObjectActionResult()
00459 if self.action_feedback is None:
00460 self.action_feedback = cob_object_detection_msgs.msg.TrainObjectActionFeedback()
00461 end = 0
00462 _x = self
00463 start = end
00464 end += 12
00465 (_x.action_goal.header.seq, _x.action_goal.header.stamp.secs, _x.action_goal.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00466 start = end
00467 end += 4
00468 (length,) = _struct_I.unpack(str[start:end])
00469 start = end
00470 end += length
00471 if python3:
00472 self.action_goal.header.frame_id = str[start:end].decode('utf-8')
00473 else:
00474 self.action_goal.header.frame_id = str[start:end]
00475 _x = self
00476 start = end
00477 end += 8
00478 (_x.action_goal.goal_id.stamp.secs, _x.action_goal.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00479 start = end
00480 end += 4
00481 (length,) = _struct_I.unpack(str[start:end])
00482 start = end
00483 end += length
00484 if python3:
00485 self.action_goal.goal_id.id = str[start:end].decode('utf-8')
00486 else:
00487 self.action_goal.goal_id.id = str[start:end]
00488 start = end
00489 end += 4
00490 (length,) = _struct_I.unpack(str[start:end])
00491 start = end
00492 end += length
00493 if python3:
00494 self.action_goal.goal.object_name = str[start:end].decode('utf-8')
00495 else:
00496 self.action_goal.goal.object_name = str[start:end]
00497 _x = self
00498 start = end
00499 end += 12
00500 (_x.action_result.header.seq, _x.action_result.header.stamp.secs, _x.action_result.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00501 start = end
00502 end += 4
00503 (length,) = _struct_I.unpack(str[start:end])
00504 start = end
00505 end += length
00506 if python3:
00507 self.action_result.header.frame_id = str[start:end].decode('utf-8')
00508 else:
00509 self.action_result.header.frame_id = str[start:end]
00510 _x = self
00511 start = end
00512 end += 8
00513 (_x.action_result.status.goal_id.stamp.secs, _x.action_result.status.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00514 start = end
00515 end += 4
00516 (length,) = _struct_I.unpack(str[start:end])
00517 start = end
00518 end += length
00519 if python3:
00520 self.action_result.status.goal_id.id = str[start:end].decode('utf-8')
00521 else:
00522 self.action_result.status.goal_id.id = str[start:end]
00523 start = end
00524 end += 1
00525 (self.action_result.status.status,) = _struct_B.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 if python3:
00532 self.action_result.status.text = str[start:end].decode('utf-8')
00533 else:
00534 self.action_result.status.text = str[start:end]
00535 _x = self
00536 start = end
00537 end += 12
00538 (_x.action_feedback.header.seq, _x.action_feedback.header.stamp.secs, _x.action_feedback.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00539 start = end
00540 end += 4
00541 (length,) = _struct_I.unpack(str[start:end])
00542 start = end
00543 end += length
00544 if python3:
00545 self.action_feedback.header.frame_id = str[start:end].decode('utf-8')
00546 else:
00547 self.action_feedback.header.frame_id = str[start:end]
00548 _x = self
00549 start = end
00550 end += 8
00551 (_x.action_feedback.status.goal_id.stamp.secs, _x.action_feedback.status.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00552 start = end
00553 end += 4
00554 (length,) = _struct_I.unpack(str[start:end])
00555 start = end
00556 end += length
00557 if python3:
00558 self.action_feedback.status.goal_id.id = str[start:end].decode('utf-8')
00559 else:
00560 self.action_feedback.status.goal_id.id = str[start:end]
00561 start = end
00562 end += 1
00563 (self.action_feedback.status.status,) = _struct_B.unpack(str[start:end])
00564 start = end
00565 end += 4
00566 (length,) = _struct_I.unpack(str[start:end])
00567 start = end
00568 end += length
00569 if python3:
00570 self.action_feedback.status.text = str[start:end].decode('utf-8')
00571 else:
00572 self.action_feedback.status.text = str[start:end]
00573 start = end
00574 end += 4
00575 (self.action_feedback.feedback.percent_complete,) = _struct_f.unpack(str[start:end])
00576 return self
00577 except struct.error as e:
00578 raise genpy.DeserializationError(e)
00579
00580 _struct_I = genpy.struct_I
00581 _struct_3I = struct.Struct("<3I")
00582 _struct_B = struct.Struct("<B")
00583 _struct_2I = struct.Struct("<2I")
00584 _struct_f = struct.Struct("<f")