00001 """autogenerated by genpy from tf2_msgs/LookupTransformAction.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 geometry_msgs.msg
00008 import genpy
00009 import actionlib_msgs.msg
00010 import tf2_msgs.msg
00011 import std_msgs.msg
00012
00013 class LookupTransformAction(genpy.Message):
00014 _md5sum = "7ee01ba91a56c2245c610992dbaa3c37"
00015 _type = "tf2_msgs/LookupTransformAction"
00016 _has_header = False
00017 _full_text = """# ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00018
00019 LookupTransformActionGoal action_goal
00020 LookupTransformActionResult action_result
00021 LookupTransformActionFeedback action_feedback
00022
00023 ================================================================================
00024 MSG: tf2_msgs/LookupTransformActionGoal
00025 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00026
00027 Header header
00028 actionlib_msgs/GoalID goal_id
00029 LookupTransformGoal goal
00030
00031 ================================================================================
00032 MSG: std_msgs/Header
00033 # Standard metadata for higher-level stamped data types.
00034 # This is generally used to communicate timestamped data
00035 # in a particular coordinate frame.
00036 #
00037 # sequence ID: consecutively increasing ID
00038 uint32 seq
00039 #Two-integer timestamp that is expressed as:
00040 # * stamp.secs: seconds (stamp_secs) since epoch
00041 # * stamp.nsecs: nanoseconds since stamp_secs
00042 # time-handling sugar is provided by the client library
00043 time stamp
00044 #Frame this data is associated with
00045 # 0: no frame
00046 # 1: global frame
00047 string frame_id
00048
00049 ================================================================================
00050 MSG: actionlib_msgs/GoalID
00051 # The stamp should store the time at which this goal was requested.
00052 # It is used by an action server when it tries to preempt all
00053 # goals that were requested before a certain time
00054 time stamp
00055
00056 # The id provides a way to associate feedback and
00057 # result message with specific goal requests. The id
00058 # specified must be unique.
00059 string id
00060
00061
00062 ================================================================================
00063 MSG: tf2_msgs/LookupTransformGoal
00064 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00065 #Simple API
00066 string target_frame
00067 string source_frame
00068 time source_time
00069 duration timeout
00070
00071 #Advanced API
00072 time target_time
00073 string fixed_frame
00074
00075 #Whether or not to use the advanced API
00076 bool advanced
00077
00078
00079 ================================================================================
00080 MSG: tf2_msgs/LookupTransformActionResult
00081 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00082
00083 Header header
00084 actionlib_msgs/GoalStatus status
00085 LookupTransformResult result
00086
00087 ================================================================================
00088 MSG: actionlib_msgs/GoalStatus
00089 GoalID goal_id
00090 uint8 status
00091 uint8 PENDING = 0 # The goal has yet to be processed by the action server
00092 uint8 ACTIVE = 1 # The goal is currently being processed by the action server
00093 uint8 PREEMPTED = 2 # The goal received a cancel request after it started executing
00094 # and has since completed its execution (Terminal State)
00095 uint8 SUCCEEDED = 3 # The goal was achieved successfully by the action server (Terminal State)
00096 uint8 ABORTED = 4 # The goal was aborted during execution by the action server due
00097 # to some failure (Terminal State)
00098 uint8 REJECTED = 5 # The goal was rejected by the action server without being processed,
00099 # because the goal was unattainable or invalid (Terminal State)
00100 uint8 PREEMPTING = 6 # The goal received a cancel request after it started executing
00101 # and has not yet completed execution
00102 uint8 RECALLING = 7 # The goal received a cancel request before it started executing,
00103 # but the action server has not yet confirmed that the goal is canceled
00104 uint8 RECALLED = 8 # The goal received a cancel request before it started executing
00105 # and was successfully cancelled (Terminal State)
00106 uint8 LOST = 9 # An action client can determine that a goal is LOST. This should not be
00107 # sent over the wire by an action server
00108
00109 #Allow for the user to associate a string with GoalStatus for debugging
00110 string text
00111
00112
00113 ================================================================================
00114 MSG: tf2_msgs/LookupTransformResult
00115 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00116 geometry_msgs/TransformStamped transform
00117 tf2_msgs/TF2Error error
00118
00119 ================================================================================
00120 MSG: geometry_msgs/TransformStamped
00121 # This expresses a transform from coordinate frame header.frame_id
00122 # to the coordinate frame child_frame_id
00123 #
00124 # This message is mostly used by the
00125 # <a href="http://www.ros.org/wiki/tf">tf</a> package.
00126 # See it's documentation for more information.
00127
00128 Header header
00129 string child_frame_id # the frame id of the child frame
00130 Transform transform
00131
00132 ================================================================================
00133 MSG: geometry_msgs/Transform
00134 # This represents the transform between two coordinate frames in free space.
00135
00136 Vector3 translation
00137 Quaternion rotation
00138
00139 ================================================================================
00140 MSG: geometry_msgs/Vector3
00141 # This represents a vector in free space.
00142
00143 float64 x
00144 float64 y
00145 float64 z
00146 ================================================================================
00147 MSG: geometry_msgs/Quaternion
00148 # This represents an orientation in free space in quaternion form.
00149
00150 float64 x
00151 float64 y
00152 float64 z
00153 float64 w
00154
00155 ================================================================================
00156 MSG: tf2_msgs/TF2Error
00157 uint8 NO_ERROR = 0
00158 uint8 LOOKUP_ERROR = 1
00159 uint8 CONNECTIVITY_ERROR = 2
00160 uint8 EXTRAPOLATION_ERROR = 3
00161 uint8 INVALID_ARGUMENT_ERROR = 4
00162 uint8 TIMEOUT_ERROR = 5
00163 uint8 TRANSFORM_ERROR = 6
00164
00165 uint8 error
00166 string error_string
00167
00168 ================================================================================
00169 MSG: tf2_msgs/LookupTransformActionFeedback
00170 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00171
00172 Header header
00173 actionlib_msgs/GoalStatus status
00174 LookupTransformFeedback feedback
00175
00176 ================================================================================
00177 MSG: tf2_msgs/LookupTransformFeedback
00178 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00179
00180
00181 """
00182 __slots__ = ['action_goal','action_result','action_feedback']
00183 _slot_types = ['tf2_msgs/LookupTransformActionGoal','tf2_msgs/LookupTransformActionResult','tf2_msgs/LookupTransformActionFeedback']
00184
00185 def __init__(self, *args, **kwds):
00186 """
00187 Constructor. Any message fields that are implicitly/explicitly
00188 set to None will be assigned a default value. The recommend
00189 use is keyword arguments as this is more robust to future message
00190 changes. You cannot mix in-order arguments and keyword arguments.
00191
00192 The available fields are:
00193 action_goal,action_result,action_feedback
00194
00195 :param args: complete set of field values, in .msg order
00196 :param kwds: use keyword arguments corresponding to message field names
00197 to set specific fields.
00198 """
00199 if args or kwds:
00200 super(LookupTransformAction, self).__init__(*args, **kwds)
00201
00202 if self.action_goal is None:
00203 self.action_goal = tf2_msgs.msg.LookupTransformActionGoal()
00204 if self.action_result is None:
00205 self.action_result = tf2_msgs.msg.LookupTransformActionResult()
00206 if self.action_feedback is None:
00207 self.action_feedback = tf2_msgs.msg.LookupTransformActionFeedback()
00208 else:
00209 self.action_goal = tf2_msgs.msg.LookupTransformActionGoal()
00210 self.action_result = tf2_msgs.msg.LookupTransformActionResult()
00211 self.action_feedback = tf2_msgs.msg.LookupTransformActionFeedback()
00212
00213 def _get_types(self):
00214 """
00215 internal API method
00216 """
00217 return self._slot_types
00218
00219 def serialize(self, buff):
00220 """
00221 serialize message into buffer
00222 :param buff: buffer, ``StringIO``
00223 """
00224 try:
00225 _x = self
00226 buff.write(_struct_3I.pack(_x.action_goal.header.seq, _x.action_goal.header.stamp.secs, _x.action_goal.header.stamp.nsecs))
00227 _x = self.action_goal.header.frame_id
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 _x = self
00234 buff.write(_struct_2I.pack(_x.action_goal.goal_id.stamp.secs, _x.action_goal.goal_id.stamp.nsecs))
00235 _x = self.action_goal.goal_id.id
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 = self.action_goal.goal.target_frame
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 _x = self.action_goal.goal.source_frame
00248 length = len(_x)
00249 if python3 or type(_x) == unicode:
00250 _x = _x.encode('utf-8')
00251 length = len(_x)
00252 buff.write(struct.pack('<I%ss'%length, length, _x))
00253 _x = self
00254 buff.write(_struct_2I2i2I.pack(_x.action_goal.goal.source_time.secs, _x.action_goal.goal.source_time.nsecs, _x.action_goal.goal.timeout.secs, _x.action_goal.goal.timeout.nsecs, _x.action_goal.goal.target_time.secs, _x.action_goal.goal.target_time.nsecs))
00255 _x = self.action_goal.goal.fixed_frame
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_B3I.pack(_x.action_goal.goal.advanced, _x.action_result.header.seq, _x.action_result.header.stamp.secs, _x.action_result.header.stamp.nsecs))
00263 _x = self.action_result.header.frame_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 _x = self
00270 buff.write(_struct_2I.pack(_x.action_result.status.goal_id.stamp.secs, _x.action_result.status.goal_id.stamp.nsecs))
00271 _x = self.action_result.status.goal_id.id
00272 length = len(_x)
00273 if python3 or type(_x) == unicode:
00274 _x = _x.encode('utf-8')
00275 length = len(_x)
00276 buff.write(struct.pack('<I%ss'%length, length, _x))
00277 buff.write(_struct_B.pack(self.action_result.status.status))
00278 _x = self.action_result.status.text
00279 length = len(_x)
00280 if python3 or type(_x) == unicode:
00281 _x = _x.encode('utf-8')
00282 length = len(_x)
00283 buff.write(struct.pack('<I%ss'%length, length, _x))
00284 _x = self
00285 buff.write(_struct_3I.pack(_x.action_result.result.transform.header.seq, _x.action_result.result.transform.header.stamp.secs, _x.action_result.result.transform.header.stamp.nsecs))
00286 _x = self.action_result.result.transform.header.frame_id
00287 length = len(_x)
00288 if python3 or type(_x) == unicode:
00289 _x = _x.encode('utf-8')
00290 length = len(_x)
00291 buff.write(struct.pack('<I%ss'%length, length, _x))
00292 _x = self.action_result.result.transform.child_frame_id
00293 length = len(_x)
00294 if python3 or type(_x) == unicode:
00295 _x = _x.encode('utf-8')
00296 length = len(_x)
00297 buff.write(struct.pack('<I%ss'%length, length, _x))
00298 _x = self
00299 buff.write(_struct_7dB.pack(_x.action_result.result.transform.transform.translation.x, _x.action_result.result.transform.transform.translation.y, _x.action_result.result.transform.transform.translation.z, _x.action_result.result.transform.transform.rotation.x, _x.action_result.result.transform.transform.rotation.y, _x.action_result.result.transform.transform.rotation.z, _x.action_result.result.transform.transform.rotation.w, _x.action_result.result.error.error))
00300 _x = self.action_result.result.error.error_string
00301 length = len(_x)
00302 if python3 or type(_x) == unicode:
00303 _x = _x.encode('utf-8')
00304 length = len(_x)
00305 buff.write(struct.pack('<I%ss'%length, length, _x))
00306 _x = self
00307 buff.write(_struct_3I.pack(_x.action_feedback.header.seq, _x.action_feedback.header.stamp.secs, _x.action_feedback.header.stamp.nsecs))
00308 _x = self.action_feedback.header.frame_id
00309 length = len(_x)
00310 if python3 or type(_x) == unicode:
00311 _x = _x.encode('utf-8')
00312 length = len(_x)
00313 buff.write(struct.pack('<I%ss'%length, length, _x))
00314 _x = self
00315 buff.write(_struct_2I.pack(_x.action_feedback.status.goal_id.stamp.secs, _x.action_feedback.status.goal_id.stamp.nsecs))
00316 _x = self.action_feedback.status.goal_id.id
00317 length = len(_x)
00318 if python3 or type(_x) == unicode:
00319 _x = _x.encode('utf-8')
00320 length = len(_x)
00321 buff.write(struct.pack('<I%ss'%length, length, _x))
00322 buff.write(_struct_B.pack(self.action_feedback.status.status))
00323 _x = self.action_feedback.status.text
00324 length = len(_x)
00325 if python3 or type(_x) == unicode:
00326 _x = _x.encode('utf-8')
00327 length = len(_x)
00328 buff.write(struct.pack('<I%ss'%length, length, _x))
00329 except struct.error as se: self._check_types(se)
00330 except TypeError as te: self._check_types(te)
00331
00332 def deserialize(self, str):
00333 """
00334 unpack serialized message in str into this message instance
00335 :param str: byte array of serialized message, ``str``
00336 """
00337 try:
00338 if self.action_goal is None:
00339 self.action_goal = tf2_msgs.msg.LookupTransformActionGoal()
00340 if self.action_result is None:
00341 self.action_result = tf2_msgs.msg.LookupTransformActionResult()
00342 if self.action_feedback is None:
00343 self.action_feedback = tf2_msgs.msg.LookupTransformActionFeedback()
00344 end = 0
00345 _x = self
00346 start = end
00347 end += 12
00348 (_x.action_goal.header.seq, _x.action_goal.header.stamp.secs, _x.action_goal.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00349 start = end
00350 end += 4
00351 (length,) = _struct_I.unpack(str[start:end])
00352 start = end
00353 end += length
00354 if python3:
00355 self.action_goal.header.frame_id = str[start:end].decode('utf-8')
00356 else:
00357 self.action_goal.header.frame_id = str[start:end]
00358 _x = self
00359 start = end
00360 end += 8
00361 (_x.action_goal.goal_id.stamp.secs, _x.action_goal.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00362 start = end
00363 end += 4
00364 (length,) = _struct_I.unpack(str[start:end])
00365 start = end
00366 end += length
00367 if python3:
00368 self.action_goal.goal_id.id = str[start:end].decode('utf-8')
00369 else:
00370 self.action_goal.goal_id.id = 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 self.action_goal.goal.target_frame = str[start:end].decode('utf-8')
00378 else:
00379 self.action_goal.goal.target_frame = 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 self.action_goal.goal.source_frame = str[start:end].decode('utf-8')
00387 else:
00388 self.action_goal.goal.source_frame = str[start:end]
00389 _x = self
00390 start = end
00391 end += 24
00392 (_x.action_goal.goal.source_time.secs, _x.action_goal.goal.source_time.nsecs, _x.action_goal.goal.timeout.secs, _x.action_goal.goal.timeout.nsecs, _x.action_goal.goal.target_time.secs, _x.action_goal.goal.target_time.nsecs,) = _struct_2I2i2I.unpack(str[start:end])
00393 start = end
00394 end += 4
00395 (length,) = _struct_I.unpack(str[start:end])
00396 start = end
00397 end += length
00398 if python3:
00399 self.action_goal.goal.fixed_frame = str[start:end].decode('utf-8')
00400 else:
00401 self.action_goal.goal.fixed_frame = str[start:end]
00402 _x = self
00403 start = end
00404 end += 13
00405 (_x.action_goal.goal.advanced, _x.action_result.header.seq, _x.action_result.header.stamp.secs, _x.action_result.header.stamp.nsecs,) = _struct_B3I.unpack(str[start:end])
00406 self.action_goal.goal.advanced = bool(self.action_goal.goal.advanced)
00407 start = end
00408 end += 4
00409 (length,) = _struct_I.unpack(str[start:end])
00410 start = end
00411 end += length
00412 if python3:
00413 self.action_result.header.frame_id = str[start:end].decode('utf-8')
00414 else:
00415 self.action_result.header.frame_id = str[start:end]
00416 _x = self
00417 start = end
00418 end += 8
00419 (_x.action_result.status.goal_id.stamp.secs, _x.action_result.status.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00420 start = end
00421 end += 4
00422 (length,) = _struct_I.unpack(str[start:end])
00423 start = end
00424 end += length
00425 if python3:
00426 self.action_result.status.goal_id.id = str[start:end].decode('utf-8')
00427 else:
00428 self.action_result.status.goal_id.id = str[start:end]
00429 start = end
00430 end += 1
00431 (self.action_result.status.status,) = _struct_B.unpack(str[start:end])
00432 start = end
00433 end += 4
00434 (length,) = _struct_I.unpack(str[start:end])
00435 start = end
00436 end += length
00437 if python3:
00438 self.action_result.status.text = str[start:end].decode('utf-8')
00439 else:
00440 self.action_result.status.text = str[start:end]
00441 _x = self
00442 start = end
00443 end += 12
00444 (_x.action_result.result.transform.header.seq, _x.action_result.result.transform.header.stamp.secs, _x.action_result.result.transform.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00445 start = end
00446 end += 4
00447 (length,) = _struct_I.unpack(str[start:end])
00448 start = end
00449 end += length
00450 if python3:
00451 self.action_result.result.transform.header.frame_id = str[start:end].decode('utf-8')
00452 else:
00453 self.action_result.result.transform.header.frame_id = str[start:end]
00454 start = end
00455 end += 4
00456 (length,) = _struct_I.unpack(str[start:end])
00457 start = end
00458 end += length
00459 if python3:
00460 self.action_result.result.transform.child_frame_id = str[start:end].decode('utf-8')
00461 else:
00462 self.action_result.result.transform.child_frame_id = str[start:end]
00463 _x = self
00464 start = end
00465 end += 57
00466 (_x.action_result.result.transform.transform.translation.x, _x.action_result.result.transform.transform.translation.y, _x.action_result.result.transform.transform.translation.z, _x.action_result.result.transform.transform.rotation.x, _x.action_result.result.transform.transform.rotation.y, _x.action_result.result.transform.transform.rotation.z, _x.action_result.result.transform.transform.rotation.w, _x.action_result.result.error.error,) = _struct_7dB.unpack(str[start:end])
00467 start = end
00468 end += 4
00469 (length,) = _struct_I.unpack(str[start:end])
00470 start = end
00471 end += length
00472 if python3:
00473 self.action_result.result.error.error_string = str[start:end].decode('utf-8')
00474 else:
00475 self.action_result.result.error.error_string = str[start:end]
00476 _x = self
00477 start = end
00478 end += 12
00479 (_x.action_feedback.header.seq, _x.action_feedback.header.stamp.secs, _x.action_feedback.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00480 start = end
00481 end += 4
00482 (length,) = _struct_I.unpack(str[start:end])
00483 start = end
00484 end += length
00485 if python3:
00486 self.action_feedback.header.frame_id = str[start:end].decode('utf-8')
00487 else:
00488 self.action_feedback.header.frame_id = str[start:end]
00489 _x = self
00490 start = end
00491 end += 8
00492 (_x.action_feedback.status.goal_id.stamp.secs, _x.action_feedback.status.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00493 start = end
00494 end += 4
00495 (length,) = _struct_I.unpack(str[start:end])
00496 start = end
00497 end += length
00498 if python3:
00499 self.action_feedback.status.goal_id.id = str[start:end].decode('utf-8')
00500 else:
00501 self.action_feedback.status.goal_id.id = str[start:end]
00502 start = end
00503 end += 1
00504 (self.action_feedback.status.status,) = _struct_B.unpack(str[start:end])
00505 start = end
00506 end += 4
00507 (length,) = _struct_I.unpack(str[start:end])
00508 start = end
00509 end += length
00510 if python3:
00511 self.action_feedback.status.text = str[start:end].decode('utf-8')
00512 else:
00513 self.action_feedback.status.text = str[start:end]
00514 return self
00515 except struct.error as e:
00516 raise genpy.DeserializationError(e)
00517
00518
00519 def serialize_numpy(self, buff, numpy):
00520 """
00521 serialize message with numpy array types into buffer
00522 :param buff: buffer, ``StringIO``
00523 :param numpy: numpy python module
00524 """
00525 try:
00526 _x = self
00527 buff.write(_struct_3I.pack(_x.action_goal.header.seq, _x.action_goal.header.stamp.secs, _x.action_goal.header.stamp.nsecs))
00528 _x = self.action_goal.header.frame_id
00529 length = len(_x)
00530 if python3 or type(_x) == unicode:
00531 _x = _x.encode('utf-8')
00532 length = len(_x)
00533 buff.write(struct.pack('<I%ss'%length, length, _x))
00534 _x = self
00535 buff.write(_struct_2I.pack(_x.action_goal.goal_id.stamp.secs, _x.action_goal.goal_id.stamp.nsecs))
00536 _x = self.action_goal.goal_id.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.action_goal.goal.target_frame
00543 length = len(_x)
00544 if python3 or type(_x) == unicode:
00545 _x = _x.encode('utf-8')
00546 length = len(_x)
00547 buff.write(struct.pack('<I%ss'%length, length, _x))
00548 _x = self.action_goal.goal.source_frame
00549 length = len(_x)
00550 if python3 or type(_x) == unicode:
00551 _x = _x.encode('utf-8')
00552 length = len(_x)
00553 buff.write(struct.pack('<I%ss'%length, length, _x))
00554 _x = self
00555 buff.write(_struct_2I2i2I.pack(_x.action_goal.goal.source_time.secs, _x.action_goal.goal.source_time.nsecs, _x.action_goal.goal.timeout.secs, _x.action_goal.goal.timeout.nsecs, _x.action_goal.goal.target_time.secs, _x.action_goal.goal.target_time.nsecs))
00556 _x = self.action_goal.goal.fixed_frame
00557 length = len(_x)
00558 if python3 or type(_x) == unicode:
00559 _x = _x.encode('utf-8')
00560 length = len(_x)
00561 buff.write(struct.pack('<I%ss'%length, length, _x))
00562 _x = self
00563 buff.write(_struct_B3I.pack(_x.action_goal.goal.advanced, _x.action_result.header.seq, _x.action_result.header.stamp.secs, _x.action_result.header.stamp.nsecs))
00564 _x = self.action_result.header.frame_id
00565 length = len(_x)
00566 if python3 or type(_x) == unicode:
00567 _x = _x.encode('utf-8')
00568 length = len(_x)
00569 buff.write(struct.pack('<I%ss'%length, length, _x))
00570 _x = self
00571 buff.write(_struct_2I.pack(_x.action_result.status.goal_id.stamp.secs, _x.action_result.status.goal_id.stamp.nsecs))
00572 _x = self.action_result.status.goal_id.id
00573 length = len(_x)
00574 if python3 or type(_x) == unicode:
00575 _x = _x.encode('utf-8')
00576 length = len(_x)
00577 buff.write(struct.pack('<I%ss'%length, length, _x))
00578 buff.write(_struct_B.pack(self.action_result.status.status))
00579 _x = self.action_result.status.text
00580 length = len(_x)
00581 if python3 or type(_x) == unicode:
00582 _x = _x.encode('utf-8')
00583 length = len(_x)
00584 buff.write(struct.pack('<I%ss'%length, length, _x))
00585 _x = self
00586 buff.write(_struct_3I.pack(_x.action_result.result.transform.header.seq, _x.action_result.result.transform.header.stamp.secs, _x.action_result.result.transform.header.stamp.nsecs))
00587 _x = self.action_result.result.transform.header.frame_id
00588 length = len(_x)
00589 if python3 or type(_x) == unicode:
00590 _x = _x.encode('utf-8')
00591 length = len(_x)
00592 buff.write(struct.pack('<I%ss'%length, length, _x))
00593 _x = self.action_result.result.transform.child_frame_id
00594 length = len(_x)
00595 if python3 or type(_x) == unicode:
00596 _x = _x.encode('utf-8')
00597 length = len(_x)
00598 buff.write(struct.pack('<I%ss'%length, length, _x))
00599 _x = self
00600 buff.write(_struct_7dB.pack(_x.action_result.result.transform.transform.translation.x, _x.action_result.result.transform.transform.translation.y, _x.action_result.result.transform.transform.translation.z, _x.action_result.result.transform.transform.rotation.x, _x.action_result.result.transform.transform.rotation.y, _x.action_result.result.transform.transform.rotation.z, _x.action_result.result.transform.transform.rotation.w, _x.action_result.result.error.error))
00601 _x = self.action_result.result.error.error_string
00602 length = len(_x)
00603 if python3 or type(_x) == unicode:
00604 _x = _x.encode('utf-8')
00605 length = len(_x)
00606 buff.write(struct.pack('<I%ss'%length, length, _x))
00607 _x = self
00608 buff.write(_struct_3I.pack(_x.action_feedback.header.seq, _x.action_feedback.header.stamp.secs, _x.action_feedback.header.stamp.nsecs))
00609 _x = self.action_feedback.header.frame_id
00610 length = len(_x)
00611 if python3 or type(_x) == unicode:
00612 _x = _x.encode('utf-8')
00613 length = len(_x)
00614 buff.write(struct.pack('<I%ss'%length, length, _x))
00615 _x = self
00616 buff.write(_struct_2I.pack(_x.action_feedback.status.goal_id.stamp.secs, _x.action_feedback.status.goal_id.stamp.nsecs))
00617 _x = self.action_feedback.status.goal_id.id
00618 length = len(_x)
00619 if python3 or type(_x) == unicode:
00620 _x = _x.encode('utf-8')
00621 length = len(_x)
00622 buff.write(struct.pack('<I%ss'%length, length, _x))
00623 buff.write(_struct_B.pack(self.action_feedback.status.status))
00624 _x = self.action_feedback.status.text
00625 length = len(_x)
00626 if python3 or type(_x) == unicode:
00627 _x = _x.encode('utf-8')
00628 length = len(_x)
00629 buff.write(struct.pack('<I%ss'%length, length, _x))
00630 except struct.error as se: self._check_types(se)
00631 except TypeError as te: self._check_types(te)
00632
00633 def deserialize_numpy(self, str, numpy):
00634 """
00635 unpack serialized message in str into this message instance using numpy for array types
00636 :param str: byte array of serialized message, ``str``
00637 :param numpy: numpy python module
00638 """
00639 try:
00640 if self.action_goal is None:
00641 self.action_goal = tf2_msgs.msg.LookupTransformActionGoal()
00642 if self.action_result is None:
00643 self.action_result = tf2_msgs.msg.LookupTransformActionResult()
00644 if self.action_feedback is None:
00645 self.action_feedback = tf2_msgs.msg.LookupTransformActionFeedback()
00646 end = 0
00647 _x = self
00648 start = end
00649 end += 12
00650 (_x.action_goal.header.seq, _x.action_goal.header.stamp.secs, _x.action_goal.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00651 start = end
00652 end += 4
00653 (length,) = _struct_I.unpack(str[start:end])
00654 start = end
00655 end += length
00656 if python3:
00657 self.action_goal.header.frame_id = str[start:end].decode('utf-8')
00658 else:
00659 self.action_goal.header.frame_id = str[start:end]
00660 _x = self
00661 start = end
00662 end += 8
00663 (_x.action_goal.goal_id.stamp.secs, _x.action_goal.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00664 start = end
00665 end += 4
00666 (length,) = _struct_I.unpack(str[start:end])
00667 start = end
00668 end += length
00669 if python3:
00670 self.action_goal.goal_id.id = str[start:end].decode('utf-8')
00671 else:
00672 self.action_goal.goal_id.id = str[start:end]
00673 start = end
00674 end += 4
00675 (length,) = _struct_I.unpack(str[start:end])
00676 start = end
00677 end += length
00678 if python3:
00679 self.action_goal.goal.target_frame = str[start:end].decode('utf-8')
00680 else:
00681 self.action_goal.goal.target_frame = str[start:end]
00682 start = end
00683 end += 4
00684 (length,) = _struct_I.unpack(str[start:end])
00685 start = end
00686 end += length
00687 if python3:
00688 self.action_goal.goal.source_frame = str[start:end].decode('utf-8')
00689 else:
00690 self.action_goal.goal.source_frame = str[start:end]
00691 _x = self
00692 start = end
00693 end += 24
00694 (_x.action_goal.goal.source_time.secs, _x.action_goal.goal.source_time.nsecs, _x.action_goal.goal.timeout.secs, _x.action_goal.goal.timeout.nsecs, _x.action_goal.goal.target_time.secs, _x.action_goal.goal.target_time.nsecs,) = _struct_2I2i2I.unpack(str[start:end])
00695 start = end
00696 end += 4
00697 (length,) = _struct_I.unpack(str[start:end])
00698 start = end
00699 end += length
00700 if python3:
00701 self.action_goal.goal.fixed_frame = str[start:end].decode('utf-8')
00702 else:
00703 self.action_goal.goal.fixed_frame = str[start:end]
00704 _x = self
00705 start = end
00706 end += 13
00707 (_x.action_goal.goal.advanced, _x.action_result.header.seq, _x.action_result.header.stamp.secs, _x.action_result.header.stamp.nsecs,) = _struct_B3I.unpack(str[start:end])
00708 self.action_goal.goal.advanced = bool(self.action_goal.goal.advanced)
00709 start = end
00710 end += 4
00711 (length,) = _struct_I.unpack(str[start:end])
00712 start = end
00713 end += length
00714 if python3:
00715 self.action_result.header.frame_id = str[start:end].decode('utf-8')
00716 else:
00717 self.action_result.header.frame_id = str[start:end]
00718 _x = self
00719 start = end
00720 end += 8
00721 (_x.action_result.status.goal_id.stamp.secs, _x.action_result.status.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00722 start = end
00723 end += 4
00724 (length,) = _struct_I.unpack(str[start:end])
00725 start = end
00726 end += length
00727 if python3:
00728 self.action_result.status.goal_id.id = str[start:end].decode('utf-8')
00729 else:
00730 self.action_result.status.goal_id.id = str[start:end]
00731 start = end
00732 end += 1
00733 (self.action_result.status.status,) = _struct_B.unpack(str[start:end])
00734 start = end
00735 end += 4
00736 (length,) = _struct_I.unpack(str[start:end])
00737 start = end
00738 end += length
00739 if python3:
00740 self.action_result.status.text = str[start:end].decode('utf-8')
00741 else:
00742 self.action_result.status.text = str[start:end]
00743 _x = self
00744 start = end
00745 end += 12
00746 (_x.action_result.result.transform.header.seq, _x.action_result.result.transform.header.stamp.secs, _x.action_result.result.transform.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00747 start = end
00748 end += 4
00749 (length,) = _struct_I.unpack(str[start:end])
00750 start = end
00751 end += length
00752 if python3:
00753 self.action_result.result.transform.header.frame_id = str[start:end].decode('utf-8')
00754 else:
00755 self.action_result.result.transform.header.frame_id = str[start:end]
00756 start = end
00757 end += 4
00758 (length,) = _struct_I.unpack(str[start:end])
00759 start = end
00760 end += length
00761 if python3:
00762 self.action_result.result.transform.child_frame_id = str[start:end].decode('utf-8')
00763 else:
00764 self.action_result.result.transform.child_frame_id = str[start:end]
00765 _x = self
00766 start = end
00767 end += 57
00768 (_x.action_result.result.transform.transform.translation.x, _x.action_result.result.transform.transform.translation.y, _x.action_result.result.transform.transform.translation.z, _x.action_result.result.transform.transform.rotation.x, _x.action_result.result.transform.transform.rotation.y, _x.action_result.result.transform.transform.rotation.z, _x.action_result.result.transform.transform.rotation.w, _x.action_result.result.error.error,) = _struct_7dB.unpack(str[start:end])
00769 start = end
00770 end += 4
00771 (length,) = _struct_I.unpack(str[start:end])
00772 start = end
00773 end += length
00774 if python3:
00775 self.action_result.result.error.error_string = str[start:end].decode('utf-8')
00776 else:
00777 self.action_result.result.error.error_string = str[start:end]
00778 _x = self
00779 start = end
00780 end += 12
00781 (_x.action_feedback.header.seq, _x.action_feedback.header.stamp.secs, _x.action_feedback.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00782 start = end
00783 end += 4
00784 (length,) = _struct_I.unpack(str[start:end])
00785 start = end
00786 end += length
00787 if python3:
00788 self.action_feedback.header.frame_id = str[start:end].decode('utf-8')
00789 else:
00790 self.action_feedback.header.frame_id = str[start:end]
00791 _x = self
00792 start = end
00793 end += 8
00794 (_x.action_feedback.status.goal_id.stamp.secs, _x.action_feedback.status.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00795 start = end
00796 end += 4
00797 (length,) = _struct_I.unpack(str[start:end])
00798 start = end
00799 end += length
00800 if python3:
00801 self.action_feedback.status.goal_id.id = str[start:end].decode('utf-8')
00802 else:
00803 self.action_feedback.status.goal_id.id = str[start:end]
00804 start = end
00805 end += 1
00806 (self.action_feedback.status.status,) = _struct_B.unpack(str[start:end])
00807 start = end
00808 end += 4
00809 (length,) = _struct_I.unpack(str[start:end])
00810 start = end
00811 end += length
00812 if python3:
00813 self.action_feedback.status.text = str[start:end].decode('utf-8')
00814 else:
00815 self.action_feedback.status.text = str[start:end]
00816 return self
00817 except struct.error as e:
00818 raise genpy.DeserializationError(e)
00819
00820 _struct_I = genpy.struct_I
00821 _struct_7dB = struct.Struct("<7dB")
00822 _struct_B = struct.Struct("<B")
00823 _struct_3I = struct.Struct("<3I")
00824 _struct_B3I = struct.Struct("<B3I")
00825 _struct_2I = struct.Struct("<2I")
00826 _struct_2I2i2I = struct.Struct("<2I2i2I")