00001 """autogenerated by genpy from face_detector/FaceDetectorAction.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 people_msgs.msg
00008 import actionlib_msgs.msg
00009 import geometry_msgs.msg
00010 import genpy
00011 import face_detector.msg
00012 import std_msgs.msg
00013
00014 class FaceDetectorAction(genpy.Message):
00015 _md5sum = "665c888633df000242196f7098a55805"
00016 _type = "face_detector/FaceDetectorAction"
00017 _has_header = False
00018 _full_text = """# ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00019
00020 FaceDetectorActionGoal action_goal
00021 FaceDetectorActionResult action_result
00022 FaceDetectorActionFeedback action_feedback
00023
00024 ================================================================================
00025 MSG: face_detector/FaceDetectorActionGoal
00026 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00027
00028 Header header
00029 actionlib_msgs/GoalID goal_id
00030 FaceDetectorGoal goal
00031
00032 ================================================================================
00033 MSG: std_msgs/Header
00034 # Standard metadata for higher-level stamped data types.
00035 # This is generally used to communicate timestamped data
00036 # in a particular coordinate frame.
00037 #
00038 # sequence ID: consecutively increasing ID
00039 uint32 seq
00040 #Two-integer timestamp that is expressed as:
00041 # * stamp.secs: seconds (stamp_secs) since epoch
00042 # * stamp.nsecs: nanoseconds since stamp_secs
00043 # time-handling sugar is provided by the client library
00044 time stamp
00045 #Frame this data is associated with
00046 # 0: no frame
00047 # 1: global frame
00048 string frame_id
00049
00050 ================================================================================
00051 MSG: actionlib_msgs/GoalID
00052 # The stamp should store the time at which this goal was requested.
00053 # It is used by an action server when it tries to preempt all
00054 # goals that were requested before a certain time
00055 time stamp
00056
00057 # The id provides a way to associate feedback and
00058 # result message with specific goal requests. The id
00059 # specified must be unique.
00060 string id
00061
00062
00063 ================================================================================
00064 MSG: face_detector/FaceDetectorGoal
00065 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00066 #goal
00067
00068 ================================================================================
00069 MSG: face_detector/FaceDetectorActionResult
00070 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00071
00072 Header header
00073 actionlib_msgs/GoalStatus status
00074 FaceDetectorResult result
00075
00076 ================================================================================
00077 MSG: actionlib_msgs/GoalStatus
00078 GoalID goal_id
00079 uint8 status
00080 uint8 PENDING = 0 # The goal has yet to be processed by the action server
00081 uint8 ACTIVE = 1 # The goal is currently being processed by the action server
00082 uint8 PREEMPTED = 2 # The goal received a cancel request after it started executing
00083 # and has since completed its execution (Terminal State)
00084 uint8 SUCCEEDED = 3 # The goal was achieved successfully by the action server (Terminal State)
00085 uint8 ABORTED = 4 # The goal was aborted during execution by the action server due
00086 # to some failure (Terminal State)
00087 uint8 REJECTED = 5 # The goal was rejected by the action server without being processed,
00088 # because the goal was unattainable or invalid (Terminal State)
00089 uint8 PREEMPTING = 6 # The goal received a cancel request after it started executing
00090 # and has not yet completed execution
00091 uint8 RECALLING = 7 # The goal received a cancel request before it started executing,
00092 # but the action server has not yet confirmed that the goal is canceled
00093 uint8 RECALLED = 8 # The goal received a cancel request before it started executing
00094 # and was successfully cancelled (Terminal State)
00095 uint8 LOST = 9 # An action client can determine that a goal is LOST. This should not be
00096 # sent over the wire by an action server
00097
00098 #Allow for the user to associate a string with GoalStatus for debugging
00099 string text
00100
00101
00102 ================================================================================
00103 MSG: face_detector/FaceDetectorResult
00104 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00105 #result
00106 people_msgs/PositionMeasurement[] face_positions
00107
00108 ================================================================================
00109 MSG: people_msgs/PositionMeasurement
00110 Header header
00111 string name
00112 string object_id
00113 geometry_msgs/Point pos
00114 float64 reliability
00115 float64[9] covariance
00116 byte initialization
00117 ================================================================================
00118 MSG: geometry_msgs/Point
00119 # This contains the position of a point in free space
00120 float64 x
00121 float64 y
00122 float64 z
00123
00124 ================================================================================
00125 MSG: face_detector/FaceDetectorActionFeedback
00126 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00127
00128 Header header
00129 actionlib_msgs/GoalStatus status
00130 FaceDetectorFeedback feedback
00131
00132 ================================================================================
00133 MSG: face_detector/FaceDetectorFeedback
00134 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00135 #feedback
00136
00137
00138 """
00139 __slots__ = ['action_goal','action_result','action_feedback']
00140 _slot_types = ['face_detector/FaceDetectorActionGoal','face_detector/FaceDetectorActionResult','face_detector/FaceDetectorActionFeedback']
00141
00142 def __init__(self, *args, **kwds):
00143 """
00144 Constructor. Any message fields that are implicitly/explicitly
00145 set to None will be assigned a default value. The recommend
00146 use is keyword arguments as this is more robust to future message
00147 changes. You cannot mix in-order arguments and keyword arguments.
00148
00149 The available fields are:
00150 action_goal,action_result,action_feedback
00151
00152 :param args: complete set of field values, in .msg order
00153 :param kwds: use keyword arguments corresponding to message field names
00154 to set specific fields.
00155 """
00156 if args or kwds:
00157 super(FaceDetectorAction, self).__init__(*args, **kwds)
00158
00159 if self.action_goal is None:
00160 self.action_goal = face_detector.msg.FaceDetectorActionGoal()
00161 if self.action_result is None:
00162 self.action_result = face_detector.msg.FaceDetectorActionResult()
00163 if self.action_feedback is None:
00164 self.action_feedback = face_detector.msg.FaceDetectorActionFeedback()
00165 else:
00166 self.action_goal = face_detector.msg.FaceDetectorActionGoal()
00167 self.action_result = face_detector.msg.FaceDetectorActionResult()
00168 self.action_feedback = face_detector.msg.FaceDetectorActionFeedback()
00169
00170 def _get_types(self):
00171 """
00172 internal API method
00173 """
00174 return self._slot_types
00175
00176 def serialize(self, buff):
00177 """
00178 serialize message into buffer
00179 :param buff: buffer, ``StringIO``
00180 """
00181 try:
00182 _x = self
00183 buff.write(_struct_3I.pack(_x.action_goal.header.seq, _x.action_goal.header.stamp.secs, _x.action_goal.header.stamp.nsecs))
00184 _x = self.action_goal.header.frame_id
00185 length = len(_x)
00186 if python3 or type(_x) == unicode:
00187 _x = _x.encode('utf-8')
00188 length = len(_x)
00189 buff.write(struct.pack('<I%ss'%length, length, _x))
00190 _x = self
00191 buff.write(_struct_2I.pack(_x.action_goal.goal_id.stamp.secs, _x.action_goal.goal_id.stamp.nsecs))
00192 _x = self.action_goal.goal_id.id
00193 length = len(_x)
00194 if python3 or type(_x) == unicode:
00195 _x = _x.encode('utf-8')
00196 length = len(_x)
00197 buff.write(struct.pack('<I%ss'%length, length, _x))
00198 _x = self
00199 buff.write(_struct_3I.pack(_x.action_result.header.seq, _x.action_result.header.stamp.secs, _x.action_result.header.stamp.nsecs))
00200 _x = self.action_result.header.frame_id
00201 length = len(_x)
00202 if python3 or type(_x) == unicode:
00203 _x = _x.encode('utf-8')
00204 length = len(_x)
00205 buff.write(struct.pack('<I%ss'%length, length, _x))
00206 _x = self
00207 buff.write(_struct_2I.pack(_x.action_result.status.goal_id.stamp.secs, _x.action_result.status.goal_id.stamp.nsecs))
00208 _x = self.action_result.status.goal_id.id
00209 length = len(_x)
00210 if python3 or type(_x) == unicode:
00211 _x = _x.encode('utf-8')
00212 length = len(_x)
00213 buff.write(struct.pack('<I%ss'%length, length, _x))
00214 buff.write(_struct_B.pack(self.action_result.status.status))
00215 _x = self.action_result.status.text
00216 length = len(_x)
00217 if python3 or type(_x) == unicode:
00218 _x = _x.encode('utf-8')
00219 length = len(_x)
00220 buff.write(struct.pack('<I%ss'%length, length, _x))
00221 length = len(self.action_result.result.face_positions)
00222 buff.write(_struct_I.pack(length))
00223 for val1 in self.action_result.result.face_positions:
00224 _v1 = val1.header
00225 buff.write(_struct_I.pack(_v1.seq))
00226 _v2 = _v1.stamp
00227 _x = _v2
00228 buff.write(_struct_2I.pack(_x.secs, _x.nsecs))
00229 _x = _v1.frame_id
00230 length = len(_x)
00231 if python3 or type(_x) == unicode:
00232 _x = _x.encode('utf-8')
00233 length = len(_x)
00234 buff.write(struct.pack('<I%ss'%length, length, _x))
00235 _x = val1.name
00236 length = len(_x)
00237 if python3 or type(_x) == unicode:
00238 _x = _x.encode('utf-8')
00239 length = len(_x)
00240 buff.write(struct.pack('<I%ss'%length, length, _x))
00241 _x = val1.object_id
00242 length = len(_x)
00243 if python3 or type(_x) == unicode:
00244 _x = _x.encode('utf-8')
00245 length = len(_x)
00246 buff.write(struct.pack('<I%ss'%length, length, _x))
00247 _v3 = val1.pos
00248 _x = _v3
00249 buff.write(_struct_3d.pack(_x.x, _x.y, _x.z))
00250 buff.write(_struct_d.pack(val1.reliability))
00251 buff.write(_struct_9d.pack(*val1.covariance))
00252 buff.write(_struct_b.pack(val1.initialization))
00253 _x = self
00254 buff.write(_struct_3I.pack(_x.action_feedback.header.seq, _x.action_feedback.header.stamp.secs, _x.action_feedback.header.stamp.nsecs))
00255 _x = self.action_feedback.header.frame_id
00256 length = len(_x)
00257 if python3 or type(_x) == unicode:
00258 _x = _x.encode('utf-8')
00259 length = len(_x)
00260 buff.write(struct.pack('<I%ss'%length, length, _x))
00261 _x = self
00262 buff.write(_struct_2I.pack(_x.action_feedback.status.goal_id.stamp.secs, _x.action_feedback.status.goal_id.stamp.nsecs))
00263 _x = self.action_feedback.status.goal_id.id
00264 length = len(_x)
00265 if python3 or type(_x) == unicode:
00266 _x = _x.encode('utf-8')
00267 length = len(_x)
00268 buff.write(struct.pack('<I%ss'%length, length, _x))
00269 buff.write(_struct_B.pack(self.action_feedback.status.status))
00270 _x = self.action_feedback.status.text
00271 length = len(_x)
00272 if python3 or type(_x) == unicode:
00273 _x = _x.encode('utf-8')
00274 length = len(_x)
00275 buff.write(struct.pack('<I%ss'%length, length, _x))
00276 except struct.error as se: self._check_types(se)
00277 except TypeError as te: self._check_types(te)
00278
00279 def deserialize(self, str):
00280 """
00281 unpack serialized message in str into this message instance
00282 :param str: byte array of serialized message, ``str``
00283 """
00284 try:
00285 if self.action_goal is None:
00286 self.action_goal = face_detector.msg.FaceDetectorActionGoal()
00287 if self.action_result is None:
00288 self.action_result = face_detector.msg.FaceDetectorActionResult()
00289 if self.action_feedback is None:
00290 self.action_feedback = face_detector.msg.FaceDetectorActionFeedback()
00291 end = 0
00292 _x = self
00293 start = end
00294 end += 12
00295 (_x.action_goal.header.seq, _x.action_goal.header.stamp.secs, _x.action_goal.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00296 start = end
00297 end += 4
00298 (length,) = _struct_I.unpack(str[start:end])
00299 start = end
00300 end += length
00301 if python3:
00302 self.action_goal.header.frame_id = str[start:end].decode('utf-8')
00303 else:
00304 self.action_goal.header.frame_id = str[start:end]
00305 _x = self
00306 start = end
00307 end += 8
00308 (_x.action_goal.goal_id.stamp.secs, _x.action_goal.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00309 start = end
00310 end += 4
00311 (length,) = _struct_I.unpack(str[start:end])
00312 start = end
00313 end += length
00314 if python3:
00315 self.action_goal.goal_id.id = str[start:end].decode('utf-8')
00316 else:
00317 self.action_goal.goal_id.id = str[start:end]
00318 _x = self
00319 start = end
00320 end += 12
00321 (_x.action_result.header.seq, _x.action_result.header.stamp.secs, _x.action_result.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00322 start = end
00323 end += 4
00324 (length,) = _struct_I.unpack(str[start:end])
00325 start = end
00326 end += length
00327 if python3:
00328 self.action_result.header.frame_id = str[start:end].decode('utf-8')
00329 else:
00330 self.action_result.header.frame_id = str[start:end]
00331 _x = self
00332 start = end
00333 end += 8
00334 (_x.action_result.status.goal_id.stamp.secs, _x.action_result.status.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00335 start = end
00336 end += 4
00337 (length,) = _struct_I.unpack(str[start:end])
00338 start = end
00339 end += length
00340 if python3:
00341 self.action_result.status.goal_id.id = str[start:end].decode('utf-8')
00342 else:
00343 self.action_result.status.goal_id.id = str[start:end]
00344 start = end
00345 end += 1
00346 (self.action_result.status.status,) = _struct_B.unpack(str[start:end])
00347 start = end
00348 end += 4
00349 (length,) = _struct_I.unpack(str[start:end])
00350 start = end
00351 end += length
00352 if python3:
00353 self.action_result.status.text = str[start:end].decode('utf-8')
00354 else:
00355 self.action_result.status.text = str[start:end]
00356 start = end
00357 end += 4
00358 (length,) = _struct_I.unpack(str[start:end])
00359 self.action_result.result.face_positions = []
00360 for i in range(0, length):
00361 val1 = people_msgs.msg.PositionMeasurement()
00362 _v4 = val1.header
00363 start = end
00364 end += 4
00365 (_v4.seq,) = _struct_I.unpack(str[start:end])
00366 _v5 = _v4.stamp
00367 _x = _v5
00368 start = end
00369 end += 8
00370 (_x.secs, _x.nsecs,) = _struct_2I.unpack(str[start:end])
00371 start = end
00372 end += 4
00373 (length,) = _struct_I.unpack(str[start:end])
00374 start = end
00375 end += length
00376 if python3:
00377 _v4.frame_id = str[start:end].decode('utf-8')
00378 else:
00379 _v4.frame_id = str[start:end]
00380 start = end
00381 end += 4
00382 (length,) = _struct_I.unpack(str[start:end])
00383 start = end
00384 end += length
00385 if python3:
00386 val1.name = str[start:end].decode('utf-8')
00387 else:
00388 val1.name = str[start:end]
00389 start = end
00390 end += 4
00391 (length,) = _struct_I.unpack(str[start:end])
00392 start = end
00393 end += length
00394 if python3:
00395 val1.object_id = str[start:end].decode('utf-8')
00396 else:
00397 val1.object_id = str[start:end]
00398 _v6 = val1.pos
00399 _x = _v6
00400 start = end
00401 end += 24
00402 (_x.x, _x.y, _x.z,) = _struct_3d.unpack(str[start:end])
00403 start = end
00404 end += 8
00405 (val1.reliability,) = _struct_d.unpack(str[start:end])
00406 start = end
00407 end += 72
00408 val1.covariance = _struct_9d.unpack(str[start:end])
00409 start = end
00410 end += 1
00411 (val1.initialization,) = _struct_b.unpack(str[start:end])
00412 self.action_result.result.face_positions.append(val1)
00413 _x = self
00414 start = end
00415 end += 12
00416 (_x.action_feedback.header.seq, _x.action_feedback.header.stamp.secs, _x.action_feedback.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00417 start = end
00418 end += 4
00419 (length,) = _struct_I.unpack(str[start:end])
00420 start = end
00421 end += length
00422 if python3:
00423 self.action_feedback.header.frame_id = str[start:end].decode('utf-8')
00424 else:
00425 self.action_feedback.header.frame_id = str[start:end]
00426 _x = self
00427 start = end
00428 end += 8
00429 (_x.action_feedback.status.goal_id.stamp.secs, _x.action_feedback.status.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00430 start = end
00431 end += 4
00432 (length,) = _struct_I.unpack(str[start:end])
00433 start = end
00434 end += length
00435 if python3:
00436 self.action_feedback.status.goal_id.id = str[start:end].decode('utf-8')
00437 else:
00438 self.action_feedback.status.goal_id.id = str[start:end]
00439 start = end
00440 end += 1
00441 (self.action_feedback.status.status,) = _struct_B.unpack(str[start:end])
00442 start = end
00443 end += 4
00444 (length,) = _struct_I.unpack(str[start:end])
00445 start = end
00446 end += length
00447 if python3:
00448 self.action_feedback.status.text = str[start:end].decode('utf-8')
00449 else:
00450 self.action_feedback.status.text = str[start:end]
00451 return self
00452 except struct.error as e:
00453 raise genpy.DeserializationError(e)
00454
00455
00456 def serialize_numpy(self, buff, numpy):
00457 """
00458 serialize message with numpy array types into buffer
00459 :param buff: buffer, ``StringIO``
00460 :param numpy: numpy python module
00461 """
00462 try:
00463 _x = self
00464 buff.write(_struct_3I.pack(_x.action_goal.header.seq, _x.action_goal.header.stamp.secs, _x.action_goal.header.stamp.nsecs))
00465 _x = self.action_goal.header.frame_id
00466 length = len(_x)
00467 if python3 or type(_x) == unicode:
00468 _x = _x.encode('utf-8')
00469 length = len(_x)
00470 buff.write(struct.pack('<I%ss'%length, length, _x))
00471 _x = self
00472 buff.write(_struct_2I.pack(_x.action_goal.goal_id.stamp.secs, _x.action_goal.goal_id.stamp.nsecs))
00473 _x = self.action_goal.goal_id.id
00474 length = len(_x)
00475 if python3 or type(_x) == unicode:
00476 _x = _x.encode('utf-8')
00477 length = len(_x)
00478 buff.write(struct.pack('<I%ss'%length, length, _x))
00479 _x = self
00480 buff.write(_struct_3I.pack(_x.action_result.header.seq, _x.action_result.header.stamp.secs, _x.action_result.header.stamp.nsecs))
00481 _x = self.action_result.header.frame_id
00482 length = len(_x)
00483 if python3 or type(_x) == unicode:
00484 _x = _x.encode('utf-8')
00485 length = len(_x)
00486 buff.write(struct.pack('<I%ss'%length, length, _x))
00487 _x = self
00488 buff.write(_struct_2I.pack(_x.action_result.status.goal_id.stamp.secs, _x.action_result.status.goal_id.stamp.nsecs))
00489 _x = self.action_result.status.goal_id.id
00490 length = len(_x)
00491 if python3 or type(_x) == unicode:
00492 _x = _x.encode('utf-8')
00493 length = len(_x)
00494 buff.write(struct.pack('<I%ss'%length, length, _x))
00495 buff.write(_struct_B.pack(self.action_result.status.status))
00496 _x = self.action_result.status.text
00497 length = len(_x)
00498 if python3 or type(_x) == unicode:
00499 _x = _x.encode('utf-8')
00500 length = len(_x)
00501 buff.write(struct.pack('<I%ss'%length, length, _x))
00502 length = len(self.action_result.result.face_positions)
00503 buff.write(_struct_I.pack(length))
00504 for val1 in self.action_result.result.face_positions:
00505 _v7 = val1.header
00506 buff.write(_struct_I.pack(_v7.seq))
00507 _v8 = _v7.stamp
00508 _x = _v8
00509 buff.write(_struct_2I.pack(_x.secs, _x.nsecs))
00510 _x = _v7.frame_id
00511 length = len(_x)
00512 if python3 or type(_x) == unicode:
00513 _x = _x.encode('utf-8')
00514 length = len(_x)
00515 buff.write(struct.pack('<I%ss'%length, length, _x))
00516 _x = val1.name
00517 length = len(_x)
00518 if python3 or type(_x) == unicode:
00519 _x = _x.encode('utf-8')
00520 length = len(_x)
00521 buff.write(struct.pack('<I%ss'%length, length, _x))
00522 _x = val1.object_id
00523 length = len(_x)
00524 if python3 or type(_x) == unicode:
00525 _x = _x.encode('utf-8')
00526 length = len(_x)
00527 buff.write(struct.pack('<I%ss'%length, length, _x))
00528 _v9 = val1.pos
00529 _x = _v9
00530 buff.write(_struct_3d.pack(_x.x, _x.y, _x.z))
00531 buff.write(_struct_d.pack(val1.reliability))
00532 buff.write(val1.covariance.tostring())
00533 buff.write(_struct_b.pack(val1.initialization))
00534 _x = self
00535 buff.write(_struct_3I.pack(_x.action_feedback.header.seq, _x.action_feedback.header.stamp.secs, _x.action_feedback.header.stamp.nsecs))
00536 _x = self.action_feedback.header.frame_id
00537 length = len(_x)
00538 if python3 or type(_x) == unicode:
00539 _x = _x.encode('utf-8')
00540 length = len(_x)
00541 buff.write(struct.pack('<I%ss'%length, length, _x))
00542 _x = self
00543 buff.write(_struct_2I.pack(_x.action_feedback.status.goal_id.stamp.secs, _x.action_feedback.status.goal_id.stamp.nsecs))
00544 _x = self.action_feedback.status.goal_id.id
00545 length = len(_x)
00546 if python3 or type(_x) == unicode:
00547 _x = _x.encode('utf-8')
00548 length = len(_x)
00549 buff.write(struct.pack('<I%ss'%length, length, _x))
00550 buff.write(_struct_B.pack(self.action_feedback.status.status))
00551 _x = self.action_feedback.status.text
00552 length = len(_x)
00553 if python3 or type(_x) == unicode:
00554 _x = _x.encode('utf-8')
00555 length = len(_x)
00556 buff.write(struct.pack('<I%ss'%length, length, _x))
00557 except struct.error as se: self._check_types(se)
00558 except TypeError as te: self._check_types(te)
00559
00560 def deserialize_numpy(self, str, numpy):
00561 """
00562 unpack serialized message in str into this message instance using numpy for array types
00563 :param str: byte array of serialized message, ``str``
00564 :param numpy: numpy python module
00565 """
00566 try:
00567 if self.action_goal is None:
00568 self.action_goal = face_detector.msg.FaceDetectorActionGoal()
00569 if self.action_result is None:
00570 self.action_result = face_detector.msg.FaceDetectorActionResult()
00571 if self.action_feedback is None:
00572 self.action_feedback = face_detector.msg.FaceDetectorActionFeedback()
00573 end = 0
00574 _x = self
00575 start = end
00576 end += 12
00577 (_x.action_goal.header.seq, _x.action_goal.header.stamp.secs, _x.action_goal.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00578 start = end
00579 end += 4
00580 (length,) = _struct_I.unpack(str[start:end])
00581 start = end
00582 end += length
00583 if python3:
00584 self.action_goal.header.frame_id = str[start:end].decode('utf-8')
00585 else:
00586 self.action_goal.header.frame_id = str[start:end]
00587 _x = self
00588 start = end
00589 end += 8
00590 (_x.action_goal.goal_id.stamp.secs, _x.action_goal.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00591 start = end
00592 end += 4
00593 (length,) = _struct_I.unpack(str[start:end])
00594 start = end
00595 end += length
00596 if python3:
00597 self.action_goal.goal_id.id = str[start:end].decode('utf-8')
00598 else:
00599 self.action_goal.goal_id.id = str[start:end]
00600 _x = self
00601 start = end
00602 end += 12
00603 (_x.action_result.header.seq, _x.action_result.header.stamp.secs, _x.action_result.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00604 start = end
00605 end += 4
00606 (length,) = _struct_I.unpack(str[start:end])
00607 start = end
00608 end += length
00609 if python3:
00610 self.action_result.header.frame_id = str[start:end].decode('utf-8')
00611 else:
00612 self.action_result.header.frame_id = str[start:end]
00613 _x = self
00614 start = end
00615 end += 8
00616 (_x.action_result.status.goal_id.stamp.secs, _x.action_result.status.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00617 start = end
00618 end += 4
00619 (length,) = _struct_I.unpack(str[start:end])
00620 start = end
00621 end += length
00622 if python3:
00623 self.action_result.status.goal_id.id = str[start:end].decode('utf-8')
00624 else:
00625 self.action_result.status.goal_id.id = str[start:end]
00626 start = end
00627 end += 1
00628 (self.action_result.status.status,) = _struct_B.unpack(str[start:end])
00629 start = end
00630 end += 4
00631 (length,) = _struct_I.unpack(str[start:end])
00632 start = end
00633 end += length
00634 if python3:
00635 self.action_result.status.text = str[start:end].decode('utf-8')
00636 else:
00637 self.action_result.status.text = str[start:end]
00638 start = end
00639 end += 4
00640 (length,) = _struct_I.unpack(str[start:end])
00641 self.action_result.result.face_positions = []
00642 for i in range(0, length):
00643 val1 = people_msgs.msg.PositionMeasurement()
00644 _v10 = val1.header
00645 start = end
00646 end += 4
00647 (_v10.seq,) = _struct_I.unpack(str[start:end])
00648 _v11 = _v10.stamp
00649 _x = _v11
00650 start = end
00651 end += 8
00652 (_x.secs, _x.nsecs,) = _struct_2I.unpack(str[start:end])
00653 start = end
00654 end += 4
00655 (length,) = _struct_I.unpack(str[start:end])
00656 start = end
00657 end += length
00658 if python3:
00659 _v10.frame_id = str[start:end].decode('utf-8')
00660 else:
00661 _v10.frame_id = str[start:end]
00662 start = end
00663 end += 4
00664 (length,) = _struct_I.unpack(str[start:end])
00665 start = end
00666 end += length
00667 if python3:
00668 val1.name = str[start:end].decode('utf-8')
00669 else:
00670 val1.name = str[start:end]
00671 start = end
00672 end += 4
00673 (length,) = _struct_I.unpack(str[start:end])
00674 start = end
00675 end += length
00676 if python3:
00677 val1.object_id = str[start:end].decode('utf-8')
00678 else:
00679 val1.object_id = str[start:end]
00680 _v12 = val1.pos
00681 _x = _v12
00682 start = end
00683 end += 24
00684 (_x.x, _x.y, _x.z,) = _struct_3d.unpack(str[start:end])
00685 start = end
00686 end += 8
00687 (val1.reliability,) = _struct_d.unpack(str[start:end])
00688 start = end
00689 end += 72
00690 val1.covariance = numpy.frombuffer(str[start:end], dtype=numpy.float64, count=9)
00691 start = end
00692 end += 1
00693 (val1.initialization,) = _struct_b.unpack(str[start:end])
00694 self.action_result.result.face_positions.append(val1)
00695 _x = self
00696 start = end
00697 end += 12
00698 (_x.action_feedback.header.seq, _x.action_feedback.header.stamp.secs, _x.action_feedback.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00699 start = end
00700 end += 4
00701 (length,) = _struct_I.unpack(str[start:end])
00702 start = end
00703 end += length
00704 if python3:
00705 self.action_feedback.header.frame_id = str[start:end].decode('utf-8')
00706 else:
00707 self.action_feedback.header.frame_id = str[start:end]
00708 _x = self
00709 start = end
00710 end += 8
00711 (_x.action_feedback.status.goal_id.stamp.secs, _x.action_feedback.status.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00712 start = end
00713 end += 4
00714 (length,) = _struct_I.unpack(str[start:end])
00715 start = end
00716 end += length
00717 if python3:
00718 self.action_feedback.status.goal_id.id = str[start:end].decode('utf-8')
00719 else:
00720 self.action_feedback.status.goal_id.id = str[start:end]
00721 start = end
00722 end += 1
00723 (self.action_feedback.status.status,) = _struct_B.unpack(str[start:end])
00724 start = end
00725 end += 4
00726 (length,) = _struct_I.unpack(str[start:end])
00727 start = end
00728 end += length
00729 if python3:
00730 self.action_feedback.status.text = str[start:end].decode('utf-8')
00731 else:
00732 self.action_feedback.status.text = str[start:end]
00733 return self
00734 except struct.error as e:
00735 raise genpy.DeserializationError(e)
00736
00737 _struct_I = genpy.struct_I
00738 _struct_B = struct.Struct("<B")
00739 _struct_d = struct.Struct("<d")
00740 _struct_9d = struct.Struct("<9d")
00741 _struct_3I = struct.Struct("<3I")
00742 _struct_b = struct.Struct("<b")
00743 _struct_2I = struct.Struct("<2I")
00744 _struct_3d = struct.Struct("<3d")