00001 """autogenerated by genpy from iri_perception_msgs/peopleTrackAction.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 actionlib_msgs.msg
00008 import genpy
00009 import iri_perception_msgs.msg
00010 import std_msgs.msg
00011
00012 class peopleTrackAction(genpy.Message):
00013 _md5sum = "5298736c3ca78ba472cc45ad505b6b38"
00014 _type = "iri_perception_msgs/peopleTrackAction"
00015 _has_header = False
00016 _full_text = """# ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00017
00018 peopleTrackActionGoal action_goal
00019 peopleTrackActionResult action_result
00020 peopleTrackActionFeedback action_feedback
00021
00022 ================================================================================
00023 MSG: iri_perception_msgs/peopleTrackActionGoal
00024 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00025
00026 Header header
00027 actionlib_msgs/GoalID goal_id
00028 peopleTrackGoal 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: iri_perception_msgs/peopleTrackGoal
00063 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00064 #goal definition
00065
00066 ================================================================================
00067 MSG: iri_perception_msgs/peopleTrackActionResult
00068 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00069
00070 Header header
00071 actionlib_msgs/GoalStatus status
00072 peopleTrackResult result
00073
00074 ================================================================================
00075 MSG: actionlib_msgs/GoalStatus
00076 GoalID goal_id
00077 uint8 status
00078 uint8 PENDING = 0 # The goal has yet to be processed by the action server
00079 uint8 ACTIVE = 1 # The goal is currently being processed by the action server
00080 uint8 PREEMPTED = 2 # The goal received a cancel request after it started executing
00081 # and has since completed its execution (Terminal State)
00082 uint8 SUCCEEDED = 3 # The goal was achieved successfully by the action server (Terminal State)
00083 uint8 ABORTED = 4 # The goal was aborted during execution by the action server due
00084 # to some failure (Terminal State)
00085 uint8 REJECTED = 5 # The goal was rejected by the action server without being processed,
00086 # because the goal was unattainable or invalid (Terminal State)
00087 uint8 PREEMPTING = 6 # The goal received a cancel request after it started executing
00088 # and has not yet completed execution
00089 uint8 RECALLING = 7 # The goal received a cancel request before it started executing,
00090 # but the action server has not yet confirmed that the goal is canceled
00091 uint8 RECALLED = 8 # The goal received a cancel request before it started executing
00092 # and was successfully cancelled (Terminal State)
00093 uint8 LOST = 9 # An action client can determine that a goal is LOST. This should not be
00094 # sent over the wire by an action server
00095
00096 #Allow for the user to associate a string with GoalStatus for debugging
00097 string text
00098
00099
00100 ================================================================================
00101 MSG: iri_perception_msgs/peopleTrackResult
00102 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00103 #result definition
00104 peopleTrackingArray ps
00105
00106 ================================================================================
00107 MSG: iri_perception_msgs/peopleTrackingArray
00108 # timestamp, frame id
00109 Header header
00110
00111 #set of targets being tracked
00112 peopleTracking[] peopleSet
00113 ================================================================================
00114 MSG: iri_perception_msgs/peopleTracking
00115 #target id
00116 int32 targetId
00117
00118 #target status is a bitwise OR of the following values
00119 # TO_BE_REMOVED = 0x01,
00120 # OCCLUDDED = 0x02,
00121 # CANDIDATE = 0x04,
00122 # LEGGED_TARGET = 0x08,
00123 # VISUALLY_CONFIRMED = 0x10,
00124 # FRIEND_IN_SIGHT = 0x20,
00125 # BACK_LEARNT = 0x40,
00126 # FACE_LEARNT = 0x80
00127 int32 targetStatus
00128
00129 #target 2D position
00130 float64 x
00131 float64 y
00132
00133 #target 2D linear velocity
00134 float64 vx
00135 float64 vy
00136
00137 #(x,y,vx,vy) covariance matrix
00138 float64[16] covariances
00139 ================================================================================
00140 MSG: iri_perception_msgs/peopleTrackActionFeedback
00141 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00142
00143 Header header
00144 actionlib_msgs/GoalStatus status
00145 peopleTrackFeedback feedback
00146
00147 ================================================================================
00148 MSG: iri_perception_msgs/peopleTrackFeedback
00149 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00150 #feedback
00151
00152
00153
00154 """
00155 __slots__ = ['action_goal','action_result','action_feedback']
00156 _slot_types = ['iri_perception_msgs/peopleTrackActionGoal','iri_perception_msgs/peopleTrackActionResult','iri_perception_msgs/peopleTrackActionFeedback']
00157
00158 def __init__(self, *args, **kwds):
00159 """
00160 Constructor. Any message fields that are implicitly/explicitly
00161 set to None will be assigned a default value. The recommend
00162 use is keyword arguments as this is more robust to future message
00163 changes. You cannot mix in-order arguments and keyword arguments.
00164
00165 The available fields are:
00166 action_goal,action_result,action_feedback
00167
00168 :param args: complete set of field values, in .msg order
00169 :param kwds: use keyword arguments corresponding to message field names
00170 to set specific fields.
00171 """
00172 if args or kwds:
00173 super(peopleTrackAction, self).__init__(*args, **kwds)
00174
00175 if self.action_goal is None:
00176 self.action_goal = iri_perception_msgs.msg.peopleTrackActionGoal()
00177 if self.action_result is None:
00178 self.action_result = iri_perception_msgs.msg.peopleTrackActionResult()
00179 if self.action_feedback is None:
00180 self.action_feedback = iri_perception_msgs.msg.peopleTrackActionFeedback()
00181 else:
00182 self.action_goal = iri_perception_msgs.msg.peopleTrackActionGoal()
00183 self.action_result = iri_perception_msgs.msg.peopleTrackActionResult()
00184 self.action_feedback = iri_perception_msgs.msg.peopleTrackActionFeedback()
00185
00186 def _get_types(self):
00187 """
00188 internal API method
00189 """
00190 return self._slot_types
00191
00192 def serialize(self, buff):
00193 """
00194 serialize message into buffer
00195 :param buff: buffer, ``StringIO``
00196 """
00197 try:
00198 _x = self
00199 buff.write(_struct_3I.pack(_x.action_goal.header.seq, _x.action_goal.header.stamp.secs, _x.action_goal.header.stamp.nsecs))
00200 _x = self.action_goal.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_goal.goal_id.stamp.secs, _x.action_goal.goal_id.stamp.nsecs))
00208 _x = self.action_goal.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 _x = self
00215 buff.write(_struct_3I.pack(_x.action_result.header.seq, _x.action_result.header.stamp.secs, _x.action_result.header.stamp.nsecs))
00216 _x = self.action_result.header.frame_id
00217 length = len(_x)
00218 if python3 or type(_x) == unicode:
00219 _x = _x.encode('utf-8')
00220 length = len(_x)
00221 buff.write(struct.pack('<I%ss'%length, length, _x))
00222 _x = self
00223 buff.write(_struct_2I.pack(_x.action_result.status.goal_id.stamp.secs, _x.action_result.status.goal_id.stamp.nsecs))
00224 _x = self.action_result.status.goal_id.id
00225 length = len(_x)
00226 if python3 or type(_x) == unicode:
00227 _x = _x.encode('utf-8')
00228 length = len(_x)
00229 buff.write(struct.pack('<I%ss'%length, length, _x))
00230 buff.write(_struct_B.pack(self.action_result.status.status))
00231 _x = self.action_result.status.text
00232 length = len(_x)
00233 if python3 or type(_x) == unicode:
00234 _x = _x.encode('utf-8')
00235 length = len(_x)
00236 buff.write(struct.pack('<I%ss'%length, length, _x))
00237 _x = self
00238 buff.write(_struct_3I.pack(_x.action_result.result.ps.header.seq, _x.action_result.result.ps.header.stamp.secs, _x.action_result.result.ps.header.stamp.nsecs))
00239 _x = self.action_result.result.ps.header.frame_id
00240 length = len(_x)
00241 if python3 or type(_x) == unicode:
00242 _x = _x.encode('utf-8')
00243 length = len(_x)
00244 buff.write(struct.pack('<I%ss'%length, length, _x))
00245 length = len(self.action_result.result.ps.peopleSet)
00246 buff.write(_struct_I.pack(length))
00247 for val1 in self.action_result.result.ps.peopleSet:
00248 _x = val1
00249 buff.write(_struct_2i4d.pack(_x.targetId, _x.targetStatus, _x.x, _x.y, _x.vx, _x.vy))
00250 buff.write(_struct_16d.pack(*val1.covariances))
00251 _x = self
00252 buff.write(_struct_3I.pack(_x.action_feedback.header.seq, _x.action_feedback.header.stamp.secs, _x.action_feedback.header.stamp.nsecs))
00253 _x = self.action_feedback.header.frame_id
00254 length = len(_x)
00255 if python3 or type(_x) == unicode:
00256 _x = _x.encode('utf-8')
00257 length = len(_x)
00258 buff.write(struct.pack('<I%ss'%length, length, _x))
00259 _x = self
00260 buff.write(_struct_2I.pack(_x.action_feedback.status.goal_id.stamp.secs, _x.action_feedback.status.goal_id.stamp.nsecs))
00261 _x = self.action_feedback.status.goal_id.id
00262 length = len(_x)
00263 if python3 or type(_x) == unicode:
00264 _x = _x.encode('utf-8')
00265 length = len(_x)
00266 buff.write(struct.pack('<I%ss'%length, length, _x))
00267 buff.write(_struct_B.pack(self.action_feedback.status.status))
00268 _x = self.action_feedback.status.text
00269 length = len(_x)
00270 if python3 or type(_x) == unicode:
00271 _x = _x.encode('utf-8')
00272 length = len(_x)
00273 buff.write(struct.pack('<I%ss'%length, length, _x))
00274 except struct.error as se: self._check_types(se)
00275 except TypeError as te: self._check_types(te)
00276
00277 def deserialize(self, str):
00278 """
00279 unpack serialized message in str into this message instance
00280 :param str: byte array of serialized message, ``str``
00281 """
00282 try:
00283 if self.action_goal is None:
00284 self.action_goal = iri_perception_msgs.msg.peopleTrackActionGoal()
00285 if self.action_result is None:
00286 self.action_result = iri_perception_msgs.msg.peopleTrackActionResult()
00287 if self.action_feedback is None:
00288 self.action_feedback = iri_perception_msgs.msg.peopleTrackActionFeedback()
00289 end = 0
00290 _x = self
00291 start = end
00292 end += 12
00293 (_x.action_goal.header.seq, _x.action_goal.header.stamp.secs, _x.action_goal.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00294 start = end
00295 end += 4
00296 (length,) = _struct_I.unpack(str[start:end])
00297 start = end
00298 end += length
00299 if python3:
00300 self.action_goal.header.frame_id = str[start:end].decode('utf-8')
00301 else:
00302 self.action_goal.header.frame_id = str[start:end]
00303 _x = self
00304 start = end
00305 end += 8
00306 (_x.action_goal.goal_id.stamp.secs, _x.action_goal.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00307 start = end
00308 end += 4
00309 (length,) = _struct_I.unpack(str[start:end])
00310 start = end
00311 end += length
00312 if python3:
00313 self.action_goal.goal_id.id = str[start:end].decode('utf-8')
00314 else:
00315 self.action_goal.goal_id.id = str[start:end]
00316 _x = self
00317 start = end
00318 end += 12
00319 (_x.action_result.header.seq, _x.action_result.header.stamp.secs, _x.action_result.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00320 start = end
00321 end += 4
00322 (length,) = _struct_I.unpack(str[start:end])
00323 start = end
00324 end += length
00325 if python3:
00326 self.action_result.header.frame_id = str[start:end].decode('utf-8')
00327 else:
00328 self.action_result.header.frame_id = str[start:end]
00329 _x = self
00330 start = end
00331 end += 8
00332 (_x.action_result.status.goal_id.stamp.secs, _x.action_result.status.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00333 start = end
00334 end += 4
00335 (length,) = _struct_I.unpack(str[start:end])
00336 start = end
00337 end += length
00338 if python3:
00339 self.action_result.status.goal_id.id = str[start:end].decode('utf-8')
00340 else:
00341 self.action_result.status.goal_id.id = str[start:end]
00342 start = end
00343 end += 1
00344 (self.action_result.status.status,) = _struct_B.unpack(str[start:end])
00345 start = end
00346 end += 4
00347 (length,) = _struct_I.unpack(str[start:end])
00348 start = end
00349 end += length
00350 if python3:
00351 self.action_result.status.text = str[start:end].decode('utf-8')
00352 else:
00353 self.action_result.status.text = str[start:end]
00354 _x = self
00355 start = end
00356 end += 12
00357 (_x.action_result.result.ps.header.seq, _x.action_result.result.ps.header.stamp.secs, _x.action_result.result.ps.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00358 start = end
00359 end += 4
00360 (length,) = _struct_I.unpack(str[start:end])
00361 start = end
00362 end += length
00363 if python3:
00364 self.action_result.result.ps.header.frame_id = str[start:end].decode('utf-8')
00365 else:
00366 self.action_result.result.ps.header.frame_id = str[start:end]
00367 start = end
00368 end += 4
00369 (length,) = _struct_I.unpack(str[start:end])
00370 self.action_result.result.ps.peopleSet = []
00371 for i in range(0, length):
00372 val1 = iri_perception_msgs.msg.peopleTracking()
00373 _x = val1
00374 start = end
00375 end += 40
00376 (_x.targetId, _x.targetStatus, _x.x, _x.y, _x.vx, _x.vy,) = _struct_2i4d.unpack(str[start:end])
00377 start = end
00378 end += 128
00379 val1.covariances = _struct_16d.unpack(str[start:end])
00380 self.action_result.result.ps.peopleSet.append(val1)
00381 _x = self
00382 start = end
00383 end += 12
00384 (_x.action_feedback.header.seq, _x.action_feedback.header.stamp.secs, _x.action_feedback.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00385 start = end
00386 end += 4
00387 (length,) = _struct_I.unpack(str[start:end])
00388 start = end
00389 end += length
00390 if python3:
00391 self.action_feedback.header.frame_id = str[start:end].decode('utf-8')
00392 else:
00393 self.action_feedback.header.frame_id = str[start:end]
00394 _x = self
00395 start = end
00396 end += 8
00397 (_x.action_feedback.status.goal_id.stamp.secs, _x.action_feedback.status.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00398 start = end
00399 end += 4
00400 (length,) = _struct_I.unpack(str[start:end])
00401 start = end
00402 end += length
00403 if python3:
00404 self.action_feedback.status.goal_id.id = str[start:end].decode('utf-8')
00405 else:
00406 self.action_feedback.status.goal_id.id = str[start:end]
00407 start = end
00408 end += 1
00409 (self.action_feedback.status.status,) = _struct_B.unpack(str[start:end])
00410 start = end
00411 end += 4
00412 (length,) = _struct_I.unpack(str[start:end])
00413 start = end
00414 end += length
00415 if python3:
00416 self.action_feedback.status.text = str[start:end].decode('utf-8')
00417 else:
00418 self.action_feedback.status.text = str[start:end]
00419 return self
00420 except struct.error as e:
00421 raise genpy.DeserializationError(e)
00422
00423
00424 def serialize_numpy(self, buff, numpy):
00425 """
00426 serialize message with numpy array types into buffer
00427 :param buff: buffer, ``StringIO``
00428 :param numpy: numpy python module
00429 """
00430 try:
00431 _x = self
00432 buff.write(_struct_3I.pack(_x.action_goal.header.seq, _x.action_goal.header.stamp.secs, _x.action_goal.header.stamp.nsecs))
00433 _x = self.action_goal.header.frame_id
00434 length = len(_x)
00435 if python3 or type(_x) == unicode:
00436 _x = _x.encode('utf-8')
00437 length = len(_x)
00438 buff.write(struct.pack('<I%ss'%length, length, _x))
00439 _x = self
00440 buff.write(_struct_2I.pack(_x.action_goal.goal_id.stamp.secs, _x.action_goal.goal_id.stamp.nsecs))
00441 _x = self.action_goal.goal_id.id
00442 length = len(_x)
00443 if python3 or type(_x) == unicode:
00444 _x = _x.encode('utf-8')
00445 length = len(_x)
00446 buff.write(struct.pack('<I%ss'%length, length, _x))
00447 _x = self
00448 buff.write(_struct_3I.pack(_x.action_result.header.seq, _x.action_result.header.stamp.secs, _x.action_result.header.stamp.nsecs))
00449 _x = self.action_result.header.frame_id
00450 length = len(_x)
00451 if python3 or type(_x) == unicode:
00452 _x = _x.encode('utf-8')
00453 length = len(_x)
00454 buff.write(struct.pack('<I%ss'%length, length, _x))
00455 _x = self
00456 buff.write(_struct_2I.pack(_x.action_result.status.goal_id.stamp.secs, _x.action_result.status.goal_id.stamp.nsecs))
00457 _x = self.action_result.status.goal_id.id
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 buff.write(_struct_B.pack(self.action_result.status.status))
00464 _x = self.action_result.status.text
00465 length = len(_x)
00466 if python3 or type(_x) == unicode:
00467 _x = _x.encode('utf-8')
00468 length = len(_x)
00469 buff.write(struct.pack('<I%ss'%length, length, _x))
00470 _x = self
00471 buff.write(_struct_3I.pack(_x.action_result.result.ps.header.seq, _x.action_result.result.ps.header.stamp.secs, _x.action_result.result.ps.header.stamp.nsecs))
00472 _x = self.action_result.result.ps.header.frame_id
00473 length = len(_x)
00474 if python3 or type(_x) == unicode:
00475 _x = _x.encode('utf-8')
00476 length = len(_x)
00477 buff.write(struct.pack('<I%ss'%length, length, _x))
00478 length = len(self.action_result.result.ps.peopleSet)
00479 buff.write(_struct_I.pack(length))
00480 for val1 in self.action_result.result.ps.peopleSet:
00481 _x = val1
00482 buff.write(_struct_2i4d.pack(_x.targetId, _x.targetStatus, _x.x, _x.y, _x.vx, _x.vy))
00483 buff.write(val1.covariances.tostring())
00484 _x = self
00485 buff.write(_struct_3I.pack(_x.action_feedback.header.seq, _x.action_feedback.header.stamp.secs, _x.action_feedback.header.stamp.nsecs))
00486 _x = self.action_feedback.header.frame_id
00487 length = len(_x)
00488 if python3 or type(_x) == unicode:
00489 _x = _x.encode('utf-8')
00490 length = len(_x)
00491 buff.write(struct.pack('<I%ss'%length, length, _x))
00492 _x = self
00493 buff.write(_struct_2I.pack(_x.action_feedback.status.goal_id.stamp.secs, _x.action_feedback.status.goal_id.stamp.nsecs))
00494 _x = self.action_feedback.status.goal_id.id
00495 length = len(_x)
00496 if python3 or type(_x) == unicode:
00497 _x = _x.encode('utf-8')
00498 length = len(_x)
00499 buff.write(struct.pack('<I%ss'%length, length, _x))
00500 buff.write(_struct_B.pack(self.action_feedback.status.status))
00501 _x = self.action_feedback.status.text
00502 length = len(_x)
00503 if python3 or type(_x) == unicode:
00504 _x = _x.encode('utf-8')
00505 length = len(_x)
00506 buff.write(struct.pack('<I%ss'%length, length, _x))
00507 except struct.error as se: self._check_types(se)
00508 except TypeError as te: self._check_types(te)
00509
00510 def deserialize_numpy(self, str, numpy):
00511 """
00512 unpack serialized message in str into this message instance using numpy for array types
00513 :param str: byte array of serialized message, ``str``
00514 :param numpy: numpy python module
00515 """
00516 try:
00517 if self.action_goal is None:
00518 self.action_goal = iri_perception_msgs.msg.peopleTrackActionGoal()
00519 if self.action_result is None:
00520 self.action_result = iri_perception_msgs.msg.peopleTrackActionResult()
00521 if self.action_feedback is None:
00522 self.action_feedback = iri_perception_msgs.msg.peopleTrackActionFeedback()
00523 end = 0
00524 _x = self
00525 start = end
00526 end += 12
00527 (_x.action_goal.header.seq, _x.action_goal.header.stamp.secs, _x.action_goal.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00528 start = end
00529 end += 4
00530 (length,) = _struct_I.unpack(str[start:end])
00531 start = end
00532 end += length
00533 if python3:
00534 self.action_goal.header.frame_id = str[start:end].decode('utf-8')
00535 else:
00536 self.action_goal.header.frame_id = str[start:end]
00537 _x = self
00538 start = end
00539 end += 8
00540 (_x.action_goal.goal_id.stamp.secs, _x.action_goal.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00541 start = end
00542 end += 4
00543 (length,) = _struct_I.unpack(str[start:end])
00544 start = end
00545 end += length
00546 if python3:
00547 self.action_goal.goal_id.id = str[start:end].decode('utf-8')
00548 else:
00549 self.action_goal.goal_id.id = str[start:end]
00550 _x = self
00551 start = end
00552 end += 12
00553 (_x.action_result.header.seq, _x.action_result.header.stamp.secs, _x.action_result.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00554 start = end
00555 end += 4
00556 (length,) = _struct_I.unpack(str[start:end])
00557 start = end
00558 end += length
00559 if python3:
00560 self.action_result.header.frame_id = str[start:end].decode('utf-8')
00561 else:
00562 self.action_result.header.frame_id = str[start:end]
00563 _x = self
00564 start = end
00565 end += 8
00566 (_x.action_result.status.goal_id.stamp.secs, _x.action_result.status.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00567 start = end
00568 end += 4
00569 (length,) = _struct_I.unpack(str[start:end])
00570 start = end
00571 end += length
00572 if python3:
00573 self.action_result.status.goal_id.id = str[start:end].decode('utf-8')
00574 else:
00575 self.action_result.status.goal_id.id = str[start:end]
00576 start = end
00577 end += 1
00578 (self.action_result.status.status,) = _struct_B.unpack(str[start:end])
00579 start = end
00580 end += 4
00581 (length,) = _struct_I.unpack(str[start:end])
00582 start = end
00583 end += length
00584 if python3:
00585 self.action_result.status.text = str[start:end].decode('utf-8')
00586 else:
00587 self.action_result.status.text = str[start:end]
00588 _x = self
00589 start = end
00590 end += 12
00591 (_x.action_result.result.ps.header.seq, _x.action_result.result.ps.header.stamp.secs, _x.action_result.result.ps.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00592 start = end
00593 end += 4
00594 (length,) = _struct_I.unpack(str[start:end])
00595 start = end
00596 end += length
00597 if python3:
00598 self.action_result.result.ps.header.frame_id = str[start:end].decode('utf-8')
00599 else:
00600 self.action_result.result.ps.header.frame_id = str[start:end]
00601 start = end
00602 end += 4
00603 (length,) = _struct_I.unpack(str[start:end])
00604 self.action_result.result.ps.peopleSet = []
00605 for i in range(0, length):
00606 val1 = iri_perception_msgs.msg.peopleTracking()
00607 _x = val1
00608 start = end
00609 end += 40
00610 (_x.targetId, _x.targetStatus, _x.x, _x.y, _x.vx, _x.vy,) = _struct_2i4d.unpack(str[start:end])
00611 start = end
00612 end += 128
00613 val1.covariances = numpy.frombuffer(str[start:end], dtype=numpy.float64, count=16)
00614 self.action_result.result.ps.peopleSet.append(val1)
00615 _x = self
00616 start = end
00617 end += 12
00618 (_x.action_feedback.header.seq, _x.action_feedback.header.stamp.secs, _x.action_feedback.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00619 start = end
00620 end += 4
00621 (length,) = _struct_I.unpack(str[start:end])
00622 start = end
00623 end += length
00624 if python3:
00625 self.action_feedback.header.frame_id = str[start:end].decode('utf-8')
00626 else:
00627 self.action_feedback.header.frame_id = str[start:end]
00628 _x = self
00629 start = end
00630 end += 8
00631 (_x.action_feedback.status.goal_id.stamp.secs, _x.action_feedback.status.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00632 start = end
00633 end += 4
00634 (length,) = _struct_I.unpack(str[start:end])
00635 start = end
00636 end += length
00637 if python3:
00638 self.action_feedback.status.goal_id.id = str[start:end].decode('utf-8')
00639 else:
00640 self.action_feedback.status.goal_id.id = str[start:end]
00641 start = end
00642 end += 1
00643 (self.action_feedback.status.status,) = _struct_B.unpack(str[start:end])
00644 start = end
00645 end += 4
00646 (length,) = _struct_I.unpack(str[start:end])
00647 start = end
00648 end += length
00649 if python3:
00650 self.action_feedback.status.text = str[start:end].decode('utf-8')
00651 else:
00652 self.action_feedback.status.text = str[start:end]
00653 return self
00654 except struct.error as e:
00655 raise genpy.DeserializationError(e)
00656
00657 _struct_I = genpy.struct_I
00658 _struct_16d = struct.Struct("<16d")
00659 _struct_2i4d = struct.Struct("<2i4d")
00660 _struct_3I = struct.Struct("<3I")
00661 _struct_B = struct.Struct("<B")
00662 _struct_2I = struct.Struct("<2I")