00001 """autogenerated by genpy from roboframenet_msgs/FilledSemanticFrameAction.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 roboframenet_msgs.msg
00008 import genpy
00009 import actionlib_msgs.msg
00010 import std_msgs.msg
00011
00012 class FilledSemanticFrameAction(genpy.Message):
00013 _md5sum = "155f2082a80e8d33020a74c63f2ac0f6"
00014 _type = "roboframenet_msgs/FilledSemanticFrameAction"
00015 _has_header = False
00016 _full_text = """# ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00017
00018 FilledSemanticFrameActionGoal action_goal
00019 FilledSemanticFrameActionResult action_result
00020 FilledSemanticFrameActionFeedback action_feedback
00021
00022 ================================================================================
00023 MSG: roboframenet_msgs/FilledSemanticFrameActionGoal
00024 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00025
00026 Header header
00027 actionlib_msgs/GoalID goal_id
00028 FilledSemanticFrameGoal 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: roboframenet_msgs/FilledSemanticFrameGoal
00063 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00064 # goal
00065 FilledSemanticFrame frame
00066
00067 ================================================================================
00068 MSG: roboframenet_msgs/FilledSemanticFrame
00069 string name
00070 FilledFrameElement[] frame_elements
00071 string[] action_server_topics
00072
00073 ================================================================================
00074 MSG: roboframenet_msgs/FilledFrameElement
00075 string name # eg object, recipient
00076 string argument # eg apple, bob
00077
00078 ================================================================================
00079 MSG: roboframenet_msgs/FilledSemanticFrameActionResult
00080 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00081
00082 Header header
00083 actionlib_msgs/GoalStatus status
00084 FilledSemanticFrameResult result
00085
00086 ================================================================================
00087 MSG: actionlib_msgs/GoalStatus
00088 GoalID goal_id
00089 uint8 status
00090 uint8 PENDING = 0 # The goal has yet to be processed by the action server
00091 uint8 ACTIVE = 1 # The goal is currently being processed by the action server
00092 uint8 PREEMPTED = 2 # The goal received a cancel request after it started executing
00093 # and has since completed its execution (Terminal State)
00094 uint8 SUCCEEDED = 3 # The goal was achieved successfully by the action server (Terminal State)
00095 uint8 ABORTED = 4 # The goal was aborted during execution by the action server due
00096 # to some failure (Terminal State)
00097 uint8 REJECTED = 5 # The goal was rejected by the action server without being processed,
00098 # because the goal was unattainable or invalid (Terminal State)
00099 uint8 PREEMPTING = 6 # The goal received a cancel request after it started executing
00100 # and has not yet completed execution
00101 uint8 RECALLING = 7 # The goal received a cancel request before it started executing,
00102 # but the action server has not yet confirmed that the goal is canceled
00103 uint8 RECALLED = 8 # The goal received a cancel request before it started executing
00104 # and was successfully cancelled (Terminal State)
00105 uint8 LOST = 9 # An action client can determine that a goal is LOST. This should not be
00106 # sent over the wire by an action server
00107
00108 #Allow for the user to associate a string with GoalStatus for debugging
00109 string text
00110
00111
00112 ================================================================================
00113 MSG: roboframenet_msgs/FilledSemanticFrameResult
00114 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00115 # result
00116 bool success
00117
00118 ================================================================================
00119 MSG: roboframenet_msgs/FilledSemanticFrameActionFeedback
00120 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00121
00122 Header header
00123 actionlib_msgs/GoalStatus status
00124 FilledSemanticFrameFeedback feedback
00125
00126 ================================================================================
00127 MSG: roboframenet_msgs/FilledSemanticFrameFeedback
00128 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00129 # feedback
00130 bool is_succeeding
00131
00132
00133
00134 """
00135 __slots__ = ['action_goal','action_result','action_feedback']
00136 _slot_types = ['roboframenet_msgs/FilledSemanticFrameActionGoal','roboframenet_msgs/FilledSemanticFrameActionResult','roboframenet_msgs/FilledSemanticFrameActionFeedback']
00137
00138 def __init__(self, *args, **kwds):
00139 """
00140 Constructor. Any message fields that are implicitly/explicitly
00141 set to None will be assigned a default value. The recommend
00142 use is keyword arguments as this is more robust to future message
00143 changes. You cannot mix in-order arguments and keyword arguments.
00144
00145 The available fields are:
00146 action_goal,action_result,action_feedback
00147
00148 :param args: complete set of field values, in .msg order
00149 :param kwds: use keyword arguments corresponding to message field names
00150 to set specific fields.
00151 """
00152 if args or kwds:
00153 super(FilledSemanticFrameAction, self).__init__(*args, **kwds)
00154
00155 if self.action_goal is None:
00156 self.action_goal = roboframenet_msgs.msg.FilledSemanticFrameActionGoal()
00157 if self.action_result is None:
00158 self.action_result = roboframenet_msgs.msg.FilledSemanticFrameActionResult()
00159 if self.action_feedback is None:
00160 self.action_feedback = roboframenet_msgs.msg.FilledSemanticFrameActionFeedback()
00161 else:
00162 self.action_goal = roboframenet_msgs.msg.FilledSemanticFrameActionGoal()
00163 self.action_result = roboframenet_msgs.msg.FilledSemanticFrameActionResult()
00164 self.action_feedback = roboframenet_msgs.msg.FilledSemanticFrameActionFeedback()
00165
00166 def _get_types(self):
00167 """
00168 internal API method
00169 """
00170 return self._slot_types
00171
00172 def serialize(self, buff):
00173 """
00174 serialize message into buffer
00175 :param buff: buffer, ``StringIO``
00176 """
00177 try:
00178 _x = self
00179 buff.write(_struct_3I.pack(_x.action_goal.header.seq, _x.action_goal.header.stamp.secs, _x.action_goal.header.stamp.nsecs))
00180 _x = self.action_goal.header.frame_id
00181 length = len(_x)
00182 if python3 or type(_x) == unicode:
00183 _x = _x.encode('utf-8')
00184 length = len(_x)
00185 buff.write(struct.pack('<I%ss'%length, length, _x))
00186 _x = self
00187 buff.write(_struct_2I.pack(_x.action_goal.goal_id.stamp.secs, _x.action_goal.goal_id.stamp.nsecs))
00188 _x = self.action_goal.goal_id.id
00189 length = len(_x)
00190 if python3 or type(_x) == unicode:
00191 _x = _x.encode('utf-8')
00192 length = len(_x)
00193 buff.write(struct.pack('<I%ss'%length, length, _x))
00194 _x = self.action_goal.goal.frame.name
00195 length = len(_x)
00196 if python3 or type(_x) == unicode:
00197 _x = _x.encode('utf-8')
00198 length = len(_x)
00199 buff.write(struct.pack('<I%ss'%length, length, _x))
00200 length = len(self.action_goal.goal.frame.frame_elements)
00201 buff.write(_struct_I.pack(length))
00202 for val1 in self.action_goal.goal.frame.frame_elements:
00203 _x = val1.name
00204 length = len(_x)
00205 if python3 or type(_x) == unicode:
00206 _x = _x.encode('utf-8')
00207 length = len(_x)
00208 buff.write(struct.pack('<I%ss'%length, length, _x))
00209 _x = val1.argument
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 length = len(self.action_goal.goal.frame.action_server_topics)
00216 buff.write(_struct_I.pack(length))
00217 for val1 in self.action_goal.goal.frame.action_server_topics:
00218 length = len(val1)
00219 if python3 or type(val1) == unicode:
00220 val1 = val1.encode('utf-8')
00221 length = len(val1)
00222 buff.write(struct.pack('<I%ss'%length, length, val1))
00223 _x = self
00224 buff.write(_struct_3I.pack(_x.action_result.header.seq, _x.action_result.header.stamp.secs, _x.action_result.header.stamp.nsecs))
00225 _x = self.action_result.header.frame_id
00226 length = len(_x)
00227 if python3 or type(_x) == unicode:
00228 _x = _x.encode('utf-8')
00229 length = len(_x)
00230 buff.write(struct.pack('<I%ss'%length, length, _x))
00231 _x = self
00232 buff.write(_struct_2I.pack(_x.action_result.status.goal_id.stamp.secs, _x.action_result.status.goal_id.stamp.nsecs))
00233 _x = self.action_result.status.goal_id.id
00234 length = len(_x)
00235 if python3 or type(_x) == unicode:
00236 _x = _x.encode('utf-8')
00237 length = len(_x)
00238 buff.write(struct.pack('<I%ss'%length, length, _x))
00239 buff.write(_struct_B.pack(self.action_result.status.status))
00240 _x = self.action_result.status.text
00241 length = len(_x)
00242 if python3 or type(_x) == unicode:
00243 _x = _x.encode('utf-8')
00244 length = len(_x)
00245 buff.write(struct.pack('<I%ss'%length, length, _x))
00246 _x = self
00247 buff.write(_struct_B3I.pack(_x.action_result.result.success, _x.action_feedback.header.seq, _x.action_feedback.header.stamp.secs, _x.action_feedback.header.stamp.nsecs))
00248 _x = self.action_feedback.header.frame_id
00249 length = len(_x)
00250 if python3 or type(_x) == unicode:
00251 _x = _x.encode('utf-8')
00252 length = len(_x)
00253 buff.write(struct.pack('<I%ss'%length, length, _x))
00254 _x = self
00255 buff.write(_struct_2I.pack(_x.action_feedback.status.goal_id.stamp.secs, _x.action_feedback.status.goal_id.stamp.nsecs))
00256 _x = self.action_feedback.status.goal_id.id
00257 length = len(_x)
00258 if python3 or type(_x) == unicode:
00259 _x = _x.encode('utf-8')
00260 length = len(_x)
00261 buff.write(struct.pack('<I%ss'%length, length, _x))
00262 buff.write(_struct_B.pack(self.action_feedback.status.status))
00263 _x = self.action_feedback.status.text
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.feedback.is_succeeding))
00270 except struct.error as se: self._check_types(se)
00271 except TypeError as te: self._check_types(te)
00272
00273 def deserialize(self, str):
00274 """
00275 unpack serialized message in str into this message instance
00276 :param str: byte array of serialized message, ``str``
00277 """
00278 try:
00279 if self.action_goal is None:
00280 self.action_goal = roboframenet_msgs.msg.FilledSemanticFrameActionGoal()
00281 if self.action_result is None:
00282 self.action_result = roboframenet_msgs.msg.FilledSemanticFrameActionResult()
00283 if self.action_feedback is None:
00284 self.action_feedback = roboframenet_msgs.msg.FilledSemanticFrameActionFeedback()
00285 end = 0
00286 _x = self
00287 start = end
00288 end += 12
00289 (_x.action_goal.header.seq, _x.action_goal.header.stamp.secs, _x.action_goal.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00290 start = end
00291 end += 4
00292 (length,) = _struct_I.unpack(str[start:end])
00293 start = end
00294 end += length
00295 if python3:
00296 self.action_goal.header.frame_id = str[start:end].decode('utf-8')
00297 else:
00298 self.action_goal.header.frame_id = str[start:end]
00299 _x = self
00300 start = end
00301 end += 8
00302 (_x.action_goal.goal_id.stamp.secs, _x.action_goal.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00303 start = end
00304 end += 4
00305 (length,) = _struct_I.unpack(str[start:end])
00306 start = end
00307 end += length
00308 if python3:
00309 self.action_goal.goal_id.id = str[start:end].decode('utf-8')
00310 else:
00311 self.action_goal.goal_id.id = str[start:end]
00312 start = end
00313 end += 4
00314 (length,) = _struct_I.unpack(str[start:end])
00315 start = end
00316 end += length
00317 if python3:
00318 self.action_goal.goal.frame.name = str[start:end].decode('utf-8')
00319 else:
00320 self.action_goal.goal.frame.name = str[start:end]
00321 start = end
00322 end += 4
00323 (length,) = _struct_I.unpack(str[start:end])
00324 self.action_goal.goal.frame.frame_elements = []
00325 for i in range(0, length):
00326 val1 = roboframenet_msgs.msg.FilledFrameElement()
00327 start = end
00328 end += 4
00329 (length,) = _struct_I.unpack(str[start:end])
00330 start = end
00331 end += length
00332 if python3:
00333 val1.name = str[start:end].decode('utf-8')
00334 else:
00335 val1.name = str[start:end]
00336 start = end
00337 end += 4
00338 (length,) = _struct_I.unpack(str[start:end])
00339 start = end
00340 end += length
00341 if python3:
00342 val1.argument = str[start:end].decode('utf-8')
00343 else:
00344 val1.argument = str[start:end]
00345 self.action_goal.goal.frame.frame_elements.append(val1)
00346 start = end
00347 end += 4
00348 (length,) = _struct_I.unpack(str[start:end])
00349 self.action_goal.goal.frame.action_server_topics = []
00350 for i in range(0, length):
00351 start = end
00352 end += 4
00353 (length,) = _struct_I.unpack(str[start:end])
00354 start = end
00355 end += length
00356 if python3:
00357 val1 = str[start:end].decode('utf-8')
00358 else:
00359 val1 = str[start:end]
00360 self.action_goal.goal.frame.action_server_topics.append(val1)
00361 _x = self
00362 start = end
00363 end += 12
00364 (_x.action_result.header.seq, _x.action_result.header.stamp.secs, _x.action_result.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00365 start = end
00366 end += 4
00367 (length,) = _struct_I.unpack(str[start:end])
00368 start = end
00369 end += length
00370 if python3:
00371 self.action_result.header.frame_id = str[start:end].decode('utf-8')
00372 else:
00373 self.action_result.header.frame_id = str[start:end]
00374 _x = self
00375 start = end
00376 end += 8
00377 (_x.action_result.status.goal_id.stamp.secs, _x.action_result.status.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
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.action_result.status.goal_id.id = str[start:end].decode('utf-8')
00385 else:
00386 self.action_result.status.goal_id.id = str[start:end]
00387 start = end
00388 end += 1
00389 (self.action_result.status.status,) = _struct_B.unpack(str[start:end])
00390 start = end
00391 end += 4
00392 (length,) = _struct_I.unpack(str[start:end])
00393 start = end
00394 end += length
00395 if python3:
00396 self.action_result.status.text = str[start:end].decode('utf-8')
00397 else:
00398 self.action_result.status.text = str[start:end]
00399 _x = self
00400 start = end
00401 end += 13
00402 (_x.action_result.result.success, _x.action_feedback.header.seq, _x.action_feedback.header.stamp.secs, _x.action_feedback.header.stamp.nsecs,) = _struct_B3I.unpack(str[start:end])
00403 self.action_result.result.success = bool(self.action_result.result.success)
00404 start = end
00405 end += 4
00406 (length,) = _struct_I.unpack(str[start:end])
00407 start = end
00408 end += length
00409 if python3:
00410 self.action_feedback.header.frame_id = str[start:end].decode('utf-8')
00411 else:
00412 self.action_feedback.header.frame_id = str[start:end]
00413 _x = self
00414 start = end
00415 end += 8
00416 (_x.action_feedback.status.goal_id.stamp.secs, _x.action_feedback.status.goal_id.stamp.nsecs,) = _struct_2I.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.status.goal_id.id = str[start:end].decode('utf-8')
00424 else:
00425 self.action_feedback.status.goal_id.id = str[start:end]
00426 start = end
00427 end += 1
00428 (self.action_feedback.status.status,) = _struct_B.unpack(str[start:end])
00429 start = end
00430 end += 4
00431 (length,) = _struct_I.unpack(str[start:end])
00432 start = end
00433 end += length
00434 if python3:
00435 self.action_feedback.status.text = str[start:end].decode('utf-8')
00436 else:
00437 self.action_feedback.status.text = str[start:end]
00438 start = end
00439 end += 1
00440 (self.action_feedback.feedback.is_succeeding,) = _struct_B.unpack(str[start:end])
00441 self.action_feedback.feedback.is_succeeding = bool(self.action_feedback.feedback.is_succeeding)
00442 return self
00443 except struct.error as e:
00444 raise genpy.DeserializationError(e)
00445
00446
00447 def serialize_numpy(self, buff, numpy):
00448 """
00449 serialize message with numpy array types into buffer
00450 :param buff: buffer, ``StringIO``
00451 :param numpy: numpy python module
00452 """
00453 try:
00454 _x = self
00455 buff.write(_struct_3I.pack(_x.action_goal.header.seq, _x.action_goal.header.stamp.secs, _x.action_goal.header.stamp.nsecs))
00456 _x = self.action_goal.header.frame_id
00457 length = len(_x)
00458 if python3 or type(_x) == unicode:
00459 _x = _x.encode('utf-8')
00460 length = len(_x)
00461 buff.write(struct.pack('<I%ss'%length, length, _x))
00462 _x = self
00463 buff.write(_struct_2I.pack(_x.action_goal.goal_id.stamp.secs, _x.action_goal.goal_id.stamp.nsecs))
00464 _x = self.action_goal.goal_id.id
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.action_goal.goal.frame.name
00471 length = len(_x)
00472 if python3 or type(_x) == unicode:
00473 _x = _x.encode('utf-8')
00474 length = len(_x)
00475 buff.write(struct.pack('<I%ss'%length, length, _x))
00476 length = len(self.action_goal.goal.frame.frame_elements)
00477 buff.write(_struct_I.pack(length))
00478 for val1 in self.action_goal.goal.frame.frame_elements:
00479 _x = val1.name
00480 length = len(_x)
00481 if python3 or type(_x) == unicode:
00482 _x = _x.encode('utf-8')
00483 length = len(_x)
00484 buff.write(struct.pack('<I%ss'%length, length, _x))
00485 _x = val1.argument
00486 length = len(_x)
00487 if python3 or type(_x) == unicode:
00488 _x = _x.encode('utf-8')
00489 length = len(_x)
00490 buff.write(struct.pack('<I%ss'%length, length, _x))
00491 length = len(self.action_goal.goal.frame.action_server_topics)
00492 buff.write(_struct_I.pack(length))
00493 for val1 in self.action_goal.goal.frame.action_server_topics:
00494 length = len(val1)
00495 if python3 or type(val1) == unicode:
00496 val1 = val1.encode('utf-8')
00497 length = len(val1)
00498 buff.write(struct.pack('<I%ss'%length, length, val1))
00499 _x = self
00500 buff.write(_struct_3I.pack(_x.action_result.header.seq, _x.action_result.header.stamp.secs, _x.action_result.header.stamp.nsecs))
00501 _x = self.action_result.header.frame_id
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 _x = self
00508 buff.write(_struct_2I.pack(_x.action_result.status.goal_id.stamp.secs, _x.action_result.status.goal_id.stamp.nsecs))
00509 _x = self.action_result.status.goal_id.id
00510 length = len(_x)
00511 if python3 or type(_x) == unicode:
00512 _x = _x.encode('utf-8')
00513 length = len(_x)
00514 buff.write(struct.pack('<I%ss'%length, length, _x))
00515 buff.write(_struct_B.pack(self.action_result.status.status))
00516 _x = self.action_result.status.text
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 = self
00523 buff.write(_struct_B3I.pack(_x.action_result.result.success, _x.action_feedback.header.seq, _x.action_feedback.header.stamp.secs, _x.action_feedback.header.stamp.nsecs))
00524 _x = self.action_feedback.header.frame_id
00525 length = len(_x)
00526 if python3 or type(_x) == unicode:
00527 _x = _x.encode('utf-8')
00528 length = len(_x)
00529 buff.write(struct.pack('<I%ss'%length, length, _x))
00530 _x = self
00531 buff.write(_struct_2I.pack(_x.action_feedback.status.goal_id.stamp.secs, _x.action_feedback.status.goal_id.stamp.nsecs))
00532 _x = self.action_feedback.status.goal_id.id
00533 length = len(_x)
00534 if python3 or type(_x) == unicode:
00535 _x = _x.encode('utf-8')
00536 length = len(_x)
00537 buff.write(struct.pack('<I%ss'%length, length, _x))
00538 buff.write(_struct_B.pack(self.action_feedback.status.status))
00539 _x = self.action_feedback.status.text
00540 length = len(_x)
00541 if python3 or type(_x) == unicode:
00542 _x = _x.encode('utf-8')
00543 length = len(_x)
00544 buff.write(struct.pack('<I%ss'%length, length, _x))
00545 buff.write(_struct_B.pack(self.action_feedback.feedback.is_succeeding))
00546 except struct.error as se: self._check_types(se)
00547 except TypeError as te: self._check_types(te)
00548
00549 def deserialize_numpy(self, str, numpy):
00550 """
00551 unpack serialized message in str into this message instance using numpy for array types
00552 :param str: byte array of serialized message, ``str``
00553 :param numpy: numpy python module
00554 """
00555 try:
00556 if self.action_goal is None:
00557 self.action_goal = roboframenet_msgs.msg.FilledSemanticFrameActionGoal()
00558 if self.action_result is None:
00559 self.action_result = roboframenet_msgs.msg.FilledSemanticFrameActionResult()
00560 if self.action_feedback is None:
00561 self.action_feedback = roboframenet_msgs.msg.FilledSemanticFrameActionFeedback()
00562 end = 0
00563 _x = self
00564 start = end
00565 end += 12
00566 (_x.action_goal.header.seq, _x.action_goal.header.stamp.secs, _x.action_goal.header.stamp.nsecs,) = _struct_3I.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_goal.header.frame_id = str[start:end].decode('utf-8')
00574 else:
00575 self.action_goal.header.frame_id = str[start:end]
00576 _x = self
00577 start = end
00578 end += 8
00579 (_x.action_goal.goal_id.stamp.secs, _x.action_goal.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00580 start = end
00581 end += 4
00582 (length,) = _struct_I.unpack(str[start:end])
00583 start = end
00584 end += length
00585 if python3:
00586 self.action_goal.goal_id.id = str[start:end].decode('utf-8')
00587 else:
00588 self.action_goal.goal_id.id = str[start:end]
00589 start = end
00590 end += 4
00591 (length,) = _struct_I.unpack(str[start:end])
00592 start = end
00593 end += length
00594 if python3:
00595 self.action_goal.goal.frame.name = str[start:end].decode('utf-8')
00596 else:
00597 self.action_goal.goal.frame.name = str[start:end]
00598 start = end
00599 end += 4
00600 (length,) = _struct_I.unpack(str[start:end])
00601 self.action_goal.goal.frame.frame_elements = []
00602 for i in range(0, length):
00603 val1 = roboframenet_msgs.msg.FilledFrameElement()
00604 start = end
00605 end += 4
00606 (length,) = _struct_I.unpack(str[start:end])
00607 start = end
00608 end += length
00609 if python3:
00610 val1.name = str[start:end].decode('utf-8')
00611 else:
00612 val1.name = str[start:end]
00613 start = end
00614 end += 4
00615 (length,) = _struct_I.unpack(str[start:end])
00616 start = end
00617 end += length
00618 if python3:
00619 val1.argument = str[start:end].decode('utf-8')
00620 else:
00621 val1.argument = str[start:end]
00622 self.action_goal.goal.frame.frame_elements.append(val1)
00623 start = end
00624 end += 4
00625 (length,) = _struct_I.unpack(str[start:end])
00626 self.action_goal.goal.frame.action_server_topics = []
00627 for i in range(0, length):
00628 start = end
00629 end += 4
00630 (length,) = _struct_I.unpack(str[start:end])
00631 start = end
00632 end += length
00633 if python3:
00634 val1 = str[start:end].decode('utf-8')
00635 else:
00636 val1 = str[start:end]
00637 self.action_goal.goal.frame.action_server_topics.append(val1)
00638 _x = self
00639 start = end
00640 end += 12
00641 (_x.action_result.header.seq, _x.action_result.header.stamp.secs, _x.action_result.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00642 start = end
00643 end += 4
00644 (length,) = _struct_I.unpack(str[start:end])
00645 start = end
00646 end += length
00647 if python3:
00648 self.action_result.header.frame_id = str[start:end].decode('utf-8')
00649 else:
00650 self.action_result.header.frame_id = str[start:end]
00651 _x = self
00652 start = end
00653 end += 8
00654 (_x.action_result.status.goal_id.stamp.secs, _x.action_result.status.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00655 start = end
00656 end += 4
00657 (length,) = _struct_I.unpack(str[start:end])
00658 start = end
00659 end += length
00660 if python3:
00661 self.action_result.status.goal_id.id = str[start:end].decode('utf-8')
00662 else:
00663 self.action_result.status.goal_id.id = str[start:end]
00664 start = end
00665 end += 1
00666 (self.action_result.status.status,) = _struct_B.unpack(str[start:end])
00667 start = end
00668 end += 4
00669 (length,) = _struct_I.unpack(str[start:end])
00670 start = end
00671 end += length
00672 if python3:
00673 self.action_result.status.text = str[start:end].decode('utf-8')
00674 else:
00675 self.action_result.status.text = str[start:end]
00676 _x = self
00677 start = end
00678 end += 13
00679 (_x.action_result.result.success, _x.action_feedback.header.seq, _x.action_feedback.header.stamp.secs, _x.action_feedback.header.stamp.nsecs,) = _struct_B3I.unpack(str[start:end])
00680 self.action_result.result.success = bool(self.action_result.result.success)
00681 start = end
00682 end += 4
00683 (length,) = _struct_I.unpack(str[start:end])
00684 start = end
00685 end += length
00686 if python3:
00687 self.action_feedback.header.frame_id = str[start:end].decode('utf-8')
00688 else:
00689 self.action_feedback.header.frame_id = str[start:end]
00690 _x = self
00691 start = end
00692 end += 8
00693 (_x.action_feedback.status.goal_id.stamp.secs, _x.action_feedback.status.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00694 start = end
00695 end += 4
00696 (length,) = _struct_I.unpack(str[start:end])
00697 start = end
00698 end += length
00699 if python3:
00700 self.action_feedback.status.goal_id.id = str[start:end].decode('utf-8')
00701 else:
00702 self.action_feedback.status.goal_id.id = str[start:end]
00703 start = end
00704 end += 1
00705 (self.action_feedback.status.status,) = _struct_B.unpack(str[start:end])
00706 start = end
00707 end += 4
00708 (length,) = _struct_I.unpack(str[start:end])
00709 start = end
00710 end += length
00711 if python3:
00712 self.action_feedback.status.text = str[start:end].decode('utf-8')
00713 else:
00714 self.action_feedback.status.text = str[start:end]
00715 start = end
00716 end += 1
00717 (self.action_feedback.feedback.is_succeeding,) = _struct_B.unpack(str[start:end])
00718 self.action_feedback.feedback.is_succeeding = bool(self.action_feedback.feedback.is_succeeding)
00719 return self
00720 except struct.error as e:
00721 raise genpy.DeserializationError(e)
00722
00723 _struct_I = genpy.struct_I
00724 _struct_3I = struct.Struct("<3I")
00725 _struct_B = struct.Struct("<B")
00726 _struct_2I = struct.Struct("<2I")
00727 _struct_B3I = struct.Struct("<B3I")