_MoveBaseAction.py
Go to the documentation of this file.
00001 """autogenerated by genpy from move_base_msgs/MoveBaseAction.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 move_base_msgs.msg
00009 import genpy
00010 import actionlib_msgs.msg
00011 import std_msgs.msg
00012 
00013 class MoveBaseAction(genpy.Message):
00014   _md5sum = "70b6aca7c7f7746d8d1609ad94c80bb8"
00015   _type = "move_base_msgs/MoveBaseAction"
00016   _has_header = False #flag to mark the presence of a Header object
00017   _full_text = """# ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00018 
00019 MoveBaseActionGoal action_goal
00020 MoveBaseActionResult action_result
00021 MoveBaseActionFeedback action_feedback
00022 
00023 ================================================================================
00024 MSG: move_base_msgs/MoveBaseActionGoal
00025 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00026 
00027 Header header
00028 actionlib_msgs/GoalID goal_id
00029 MoveBaseGoal 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: move_base_msgs/MoveBaseGoal
00064 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00065 geometry_msgs/PoseStamped target_pose
00066 
00067 ================================================================================
00068 MSG: geometry_msgs/PoseStamped
00069 # A Pose with reference coordinate frame and timestamp
00070 Header header
00071 Pose pose
00072 
00073 ================================================================================
00074 MSG: geometry_msgs/Pose
00075 # A representation of pose in free space, composed of postion and orientation. 
00076 Point position
00077 Quaternion orientation
00078 
00079 ================================================================================
00080 MSG: geometry_msgs/Point
00081 # This contains the position of a point in free space
00082 float64 x
00083 float64 y
00084 float64 z
00085 
00086 ================================================================================
00087 MSG: geometry_msgs/Quaternion
00088 # This represents an orientation in free space in quaternion form.
00089 
00090 float64 x
00091 float64 y
00092 float64 z
00093 float64 w
00094 
00095 ================================================================================
00096 MSG: move_base_msgs/MoveBaseActionResult
00097 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00098 
00099 Header header
00100 actionlib_msgs/GoalStatus status
00101 MoveBaseResult result
00102 
00103 ================================================================================
00104 MSG: actionlib_msgs/GoalStatus
00105 GoalID goal_id
00106 uint8 status
00107 uint8 PENDING         = 0   # The goal has yet to be processed by the action server
00108 uint8 ACTIVE          = 1   # The goal is currently being processed by the action server
00109 uint8 PREEMPTED       = 2   # The goal received a cancel request after it started executing
00110                             #   and has since completed its execution (Terminal State)
00111 uint8 SUCCEEDED       = 3   # The goal was achieved successfully by the action server (Terminal State)
00112 uint8 ABORTED         = 4   # The goal was aborted during execution by the action server due
00113                             #    to some failure (Terminal State)
00114 uint8 REJECTED        = 5   # The goal was rejected by the action server without being processed,
00115                             #    because the goal was unattainable or invalid (Terminal State)
00116 uint8 PREEMPTING      = 6   # The goal received a cancel request after it started executing
00117                             #    and has not yet completed execution
00118 uint8 RECALLING       = 7   # The goal received a cancel request before it started executing,
00119                             #    but the action server has not yet confirmed that the goal is canceled
00120 uint8 RECALLED        = 8   # The goal received a cancel request before it started executing
00121                             #    and was successfully cancelled (Terminal State)
00122 uint8 LOST            = 9   # An action client can determine that a goal is LOST. This should not be
00123                             #    sent over the wire by an action server
00124 
00125 #Allow for the user to associate a string with GoalStatus for debugging
00126 string text
00127 
00128 
00129 ================================================================================
00130 MSG: move_base_msgs/MoveBaseResult
00131 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00132 
00133 ================================================================================
00134 MSG: move_base_msgs/MoveBaseActionFeedback
00135 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00136 
00137 Header header
00138 actionlib_msgs/GoalStatus status
00139 MoveBaseFeedback feedback
00140 
00141 ================================================================================
00142 MSG: move_base_msgs/MoveBaseFeedback
00143 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00144 geometry_msgs/PoseStamped base_position
00145 
00146 
00147 """
00148   __slots__ = ['action_goal','action_result','action_feedback']
00149   _slot_types = ['move_base_msgs/MoveBaseActionGoal','move_base_msgs/MoveBaseActionResult','move_base_msgs/MoveBaseActionFeedback']
00150 
00151   def __init__(self, *args, **kwds):
00152     """
00153     Constructor. Any message fields that are implicitly/explicitly
00154     set to None will be assigned a default value. The recommend
00155     use is keyword arguments as this is more robust to future message
00156     changes.  You cannot mix in-order arguments and keyword arguments.
00157 
00158     The available fields are:
00159        action_goal,action_result,action_feedback
00160 
00161     :param args: complete set of field values, in .msg order
00162     :param kwds: use keyword arguments corresponding to message field names
00163     to set specific fields.
00164     """
00165     if args or kwds:
00166       super(MoveBaseAction, self).__init__(*args, **kwds)
00167       #message fields cannot be None, assign default values for those that are
00168       if self.action_goal is None:
00169         self.action_goal = move_base_msgs.msg.MoveBaseActionGoal()
00170       if self.action_result is None:
00171         self.action_result = move_base_msgs.msg.MoveBaseActionResult()
00172       if self.action_feedback is None:
00173         self.action_feedback = move_base_msgs.msg.MoveBaseActionFeedback()
00174     else:
00175       self.action_goal = move_base_msgs.msg.MoveBaseActionGoal()
00176       self.action_result = move_base_msgs.msg.MoveBaseActionResult()
00177       self.action_feedback = move_base_msgs.msg.MoveBaseActionFeedback()
00178 
00179   def _get_types(self):
00180     """
00181     internal API method
00182     """
00183     return self._slot_types
00184 
00185   def serialize(self, buff):
00186     """
00187     serialize message into buffer
00188     :param buff: buffer, ``StringIO``
00189     """
00190     try:
00191       _x = self
00192       buff.write(_struct_3I.pack(_x.action_goal.header.seq, _x.action_goal.header.stamp.secs, _x.action_goal.header.stamp.nsecs))
00193       _x = self.action_goal.header.frame_id
00194       length = len(_x)
00195       if python3 or type(_x) == unicode:
00196         _x = _x.encode('utf-8')
00197         length = len(_x)
00198       buff.write(struct.pack('<I%ss'%length, length, _x))
00199       _x = self
00200       buff.write(_struct_2I.pack(_x.action_goal.goal_id.stamp.secs, _x.action_goal.goal_id.stamp.nsecs))
00201       _x = self.action_goal.goal_id.id
00202       length = len(_x)
00203       if python3 or type(_x) == unicode:
00204         _x = _x.encode('utf-8')
00205         length = len(_x)
00206       buff.write(struct.pack('<I%ss'%length, length, _x))
00207       _x = self
00208       buff.write(_struct_3I.pack(_x.action_goal.goal.target_pose.header.seq, _x.action_goal.goal.target_pose.header.stamp.secs, _x.action_goal.goal.target_pose.header.stamp.nsecs))
00209       _x = self.action_goal.goal.target_pose.header.frame_id
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       _x = self
00216       buff.write(_struct_7d3I.pack(_x.action_goal.goal.target_pose.pose.position.x, _x.action_goal.goal.target_pose.pose.position.y, _x.action_goal.goal.target_pose.pose.position.z, _x.action_goal.goal.target_pose.pose.orientation.x, _x.action_goal.goal.target_pose.pose.orientation.y, _x.action_goal.goal.target_pose.pose.orientation.z, _x.action_goal.goal.target_pose.pose.orientation.w, _x.action_result.header.seq, _x.action_result.header.stamp.secs, _x.action_result.header.stamp.nsecs))
00217       _x = self.action_result.header.frame_id
00218       length = len(_x)
00219       if python3 or type(_x) == unicode:
00220         _x = _x.encode('utf-8')
00221         length = len(_x)
00222       buff.write(struct.pack('<I%ss'%length, length, _x))
00223       _x = self
00224       buff.write(_struct_2I.pack(_x.action_result.status.goal_id.stamp.secs, _x.action_result.status.goal_id.stamp.nsecs))
00225       _x = self.action_result.status.goal_id.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       buff.write(_struct_B.pack(self.action_result.status.status))
00232       _x = self.action_result.status.text
00233       length = len(_x)
00234       if python3 or type(_x) == unicode:
00235         _x = _x.encode('utf-8')
00236         length = len(_x)
00237       buff.write(struct.pack('<I%ss'%length, length, _x))
00238       _x = self
00239       buff.write(_struct_3I.pack(_x.action_feedback.header.seq, _x.action_feedback.header.stamp.secs, _x.action_feedback.header.stamp.nsecs))
00240       _x = self.action_feedback.header.frame_id
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_2I.pack(_x.action_feedback.status.goal_id.stamp.secs, _x.action_feedback.status.goal_id.stamp.nsecs))
00248       _x = self.action_feedback.status.goal_id.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       buff.write(_struct_B.pack(self.action_feedback.status.status))
00255       _x = self.action_feedback.status.text
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_3I.pack(_x.action_feedback.feedback.base_position.header.seq, _x.action_feedback.feedback.base_position.header.stamp.secs, _x.action_feedback.feedback.base_position.header.stamp.nsecs))
00263       _x = self.action_feedback.feedback.base_position.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_7d.pack(_x.action_feedback.feedback.base_position.pose.position.x, _x.action_feedback.feedback.base_position.pose.position.y, _x.action_feedback.feedback.base_position.pose.position.z, _x.action_feedback.feedback.base_position.pose.orientation.x, _x.action_feedback.feedback.base_position.pose.orientation.y, _x.action_feedback.feedback.base_position.pose.orientation.z, _x.action_feedback.feedback.base_position.pose.orientation.w))
00271     except struct.error as se: self._check_types(se)
00272     except TypeError as te: self._check_types(te)
00273 
00274   def deserialize(self, str):
00275     """
00276     unpack serialized message in str into this message instance
00277     :param str: byte array of serialized message, ``str``
00278     """
00279     try:
00280       if self.action_goal is None:
00281         self.action_goal = move_base_msgs.msg.MoveBaseActionGoal()
00282       if self.action_result is None:
00283         self.action_result = move_base_msgs.msg.MoveBaseActionResult()
00284       if self.action_feedback is None:
00285         self.action_feedback = move_base_msgs.msg.MoveBaseActionFeedback()
00286       end = 0
00287       _x = self
00288       start = end
00289       end += 12
00290       (_x.action_goal.header.seq, _x.action_goal.header.stamp.secs, _x.action_goal.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00291       start = end
00292       end += 4
00293       (length,) = _struct_I.unpack(str[start:end])
00294       start = end
00295       end += length
00296       if python3:
00297         self.action_goal.header.frame_id = str[start:end].decode('utf-8')
00298       else:
00299         self.action_goal.header.frame_id = str[start:end]
00300       _x = self
00301       start = end
00302       end += 8
00303       (_x.action_goal.goal_id.stamp.secs, _x.action_goal.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00304       start = end
00305       end += 4
00306       (length,) = _struct_I.unpack(str[start:end])
00307       start = end
00308       end += length
00309       if python3:
00310         self.action_goal.goal_id.id = str[start:end].decode('utf-8')
00311       else:
00312         self.action_goal.goal_id.id = str[start:end]
00313       _x = self
00314       start = end
00315       end += 12
00316       (_x.action_goal.goal.target_pose.header.seq, _x.action_goal.goal.target_pose.header.stamp.secs, _x.action_goal.goal.target_pose.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00317       start = end
00318       end += 4
00319       (length,) = _struct_I.unpack(str[start:end])
00320       start = end
00321       end += length
00322       if python3:
00323         self.action_goal.goal.target_pose.header.frame_id = str[start:end].decode('utf-8')
00324       else:
00325         self.action_goal.goal.target_pose.header.frame_id = str[start:end]
00326       _x = self
00327       start = end
00328       end += 68
00329       (_x.action_goal.goal.target_pose.pose.position.x, _x.action_goal.goal.target_pose.pose.position.y, _x.action_goal.goal.target_pose.pose.position.z, _x.action_goal.goal.target_pose.pose.orientation.x, _x.action_goal.goal.target_pose.pose.orientation.y, _x.action_goal.goal.target_pose.pose.orientation.z, _x.action_goal.goal.target_pose.pose.orientation.w, _x.action_result.header.seq, _x.action_result.header.stamp.secs, _x.action_result.header.stamp.nsecs,) = _struct_7d3I.unpack(str[start:end])
00330       start = end
00331       end += 4
00332       (length,) = _struct_I.unpack(str[start:end])
00333       start = end
00334       end += length
00335       if python3:
00336         self.action_result.header.frame_id = str[start:end].decode('utf-8')
00337       else:
00338         self.action_result.header.frame_id = str[start:end]
00339       _x = self
00340       start = end
00341       end += 8
00342       (_x.action_result.status.goal_id.stamp.secs, _x.action_result.status.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00343       start = end
00344       end += 4
00345       (length,) = _struct_I.unpack(str[start:end])
00346       start = end
00347       end += length
00348       if python3:
00349         self.action_result.status.goal_id.id = str[start:end].decode('utf-8')
00350       else:
00351         self.action_result.status.goal_id.id = str[start:end]
00352       start = end
00353       end += 1
00354       (self.action_result.status.status,) = _struct_B.unpack(str[start:end])
00355       start = end
00356       end += 4
00357       (length,) = _struct_I.unpack(str[start:end])
00358       start = end
00359       end += length
00360       if python3:
00361         self.action_result.status.text = str[start:end].decode('utf-8')
00362       else:
00363         self.action_result.status.text = str[start:end]
00364       _x = self
00365       start = end
00366       end += 12
00367       (_x.action_feedback.header.seq, _x.action_feedback.header.stamp.secs, _x.action_feedback.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00368       start = end
00369       end += 4
00370       (length,) = _struct_I.unpack(str[start:end])
00371       start = end
00372       end += length
00373       if python3:
00374         self.action_feedback.header.frame_id = str[start:end].decode('utf-8')
00375       else:
00376         self.action_feedback.header.frame_id = str[start:end]
00377       _x = self
00378       start = end
00379       end += 8
00380       (_x.action_feedback.status.goal_id.stamp.secs, _x.action_feedback.status.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00381       start = end
00382       end += 4
00383       (length,) = _struct_I.unpack(str[start:end])
00384       start = end
00385       end += length
00386       if python3:
00387         self.action_feedback.status.goal_id.id = str[start:end].decode('utf-8')
00388       else:
00389         self.action_feedback.status.goal_id.id = str[start:end]
00390       start = end
00391       end += 1
00392       (self.action_feedback.status.status,) = _struct_B.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_feedback.status.text = str[start:end].decode('utf-8')
00400       else:
00401         self.action_feedback.status.text = str[start:end]
00402       _x = self
00403       start = end
00404       end += 12
00405       (_x.action_feedback.feedback.base_position.header.seq, _x.action_feedback.feedback.base_position.header.stamp.secs, _x.action_feedback.feedback.base_position.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00406       start = end
00407       end += 4
00408       (length,) = _struct_I.unpack(str[start:end])
00409       start = end
00410       end += length
00411       if python3:
00412         self.action_feedback.feedback.base_position.header.frame_id = str[start:end].decode('utf-8')
00413       else:
00414         self.action_feedback.feedback.base_position.header.frame_id = str[start:end]
00415       _x = self
00416       start = end
00417       end += 56
00418       (_x.action_feedback.feedback.base_position.pose.position.x, _x.action_feedback.feedback.base_position.pose.position.y, _x.action_feedback.feedback.base_position.pose.position.z, _x.action_feedback.feedback.base_position.pose.orientation.x, _x.action_feedback.feedback.base_position.pose.orientation.y, _x.action_feedback.feedback.base_position.pose.orientation.z, _x.action_feedback.feedback.base_position.pose.orientation.w,) = _struct_7d.unpack(str[start:end])
00419       return self
00420     except struct.error as e:
00421       raise genpy.DeserializationError(e) #most likely buffer underfill
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_goal.goal.target_pose.header.seq, _x.action_goal.goal.target_pose.header.stamp.secs, _x.action_goal.goal.target_pose.header.stamp.nsecs))
00449       _x = self.action_goal.goal.target_pose.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_7d3I.pack(_x.action_goal.goal.target_pose.pose.position.x, _x.action_goal.goal.target_pose.pose.position.y, _x.action_goal.goal.target_pose.pose.position.z, _x.action_goal.goal.target_pose.pose.orientation.x, _x.action_goal.goal.target_pose.pose.orientation.y, _x.action_goal.goal.target_pose.pose.orientation.z, _x.action_goal.goal.target_pose.pose.orientation.w, _x.action_result.header.seq, _x.action_result.header.stamp.secs, _x.action_result.header.stamp.nsecs))
00457       _x = self.action_result.header.frame_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       _x = self
00464       buff.write(_struct_2I.pack(_x.action_result.status.goal_id.stamp.secs, _x.action_result.status.goal_id.stamp.nsecs))
00465       _x = self.action_result.status.goal_id.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       buff.write(_struct_B.pack(self.action_result.status.status))
00472       _x = self.action_result.status.text
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       _x = self
00479       buff.write(_struct_3I.pack(_x.action_feedback.header.seq, _x.action_feedback.header.stamp.secs, _x.action_feedback.header.stamp.nsecs))
00480       _x = self.action_feedback.header.frame_id
00481       length = len(_x)
00482       if python3 or type(_x) == unicode:
00483         _x = _x.encode('utf-8')
00484         length = len(_x)
00485       buff.write(struct.pack('<I%ss'%length, length, _x))
00486       _x = self
00487       buff.write(_struct_2I.pack(_x.action_feedback.status.goal_id.stamp.secs, _x.action_feedback.status.goal_id.stamp.nsecs))
00488       _x = self.action_feedback.status.goal_id.id
00489       length = len(_x)
00490       if python3 or type(_x) == unicode:
00491         _x = _x.encode('utf-8')
00492         length = len(_x)
00493       buff.write(struct.pack('<I%ss'%length, length, _x))
00494       buff.write(_struct_B.pack(self.action_feedback.status.status))
00495       _x = self.action_feedback.status.text
00496       length = len(_x)
00497       if python3 or type(_x) == unicode:
00498         _x = _x.encode('utf-8')
00499         length = len(_x)
00500       buff.write(struct.pack('<I%ss'%length, length, _x))
00501       _x = self
00502       buff.write(_struct_3I.pack(_x.action_feedback.feedback.base_position.header.seq, _x.action_feedback.feedback.base_position.header.stamp.secs, _x.action_feedback.feedback.base_position.header.stamp.nsecs))
00503       _x = self.action_feedback.feedback.base_position.header.frame_id
00504       length = len(_x)
00505       if python3 or type(_x) == unicode:
00506         _x = _x.encode('utf-8')
00507         length = len(_x)
00508       buff.write(struct.pack('<I%ss'%length, length, _x))
00509       _x = self
00510       buff.write(_struct_7d.pack(_x.action_feedback.feedback.base_position.pose.position.x, _x.action_feedback.feedback.base_position.pose.position.y, _x.action_feedback.feedback.base_position.pose.position.z, _x.action_feedback.feedback.base_position.pose.orientation.x, _x.action_feedback.feedback.base_position.pose.orientation.y, _x.action_feedback.feedback.base_position.pose.orientation.z, _x.action_feedback.feedback.base_position.pose.orientation.w))
00511     except struct.error as se: self._check_types(se)
00512     except TypeError as te: self._check_types(te)
00513 
00514   def deserialize_numpy(self, str, numpy):
00515     """
00516     unpack serialized message in str into this message instance using numpy for array types
00517     :param str: byte array of serialized message, ``str``
00518     :param numpy: numpy python module
00519     """
00520     try:
00521       if self.action_goal is None:
00522         self.action_goal = move_base_msgs.msg.MoveBaseActionGoal()
00523       if self.action_result is None:
00524         self.action_result = move_base_msgs.msg.MoveBaseActionResult()
00525       if self.action_feedback is None:
00526         self.action_feedback = move_base_msgs.msg.MoveBaseActionFeedback()
00527       end = 0
00528       _x = self
00529       start = end
00530       end += 12
00531       (_x.action_goal.header.seq, _x.action_goal.header.stamp.secs, _x.action_goal.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00532       start = end
00533       end += 4
00534       (length,) = _struct_I.unpack(str[start:end])
00535       start = end
00536       end += length
00537       if python3:
00538         self.action_goal.header.frame_id = str[start:end].decode('utf-8')
00539       else:
00540         self.action_goal.header.frame_id = str[start:end]
00541       _x = self
00542       start = end
00543       end += 8
00544       (_x.action_goal.goal_id.stamp.secs, _x.action_goal.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00545       start = end
00546       end += 4
00547       (length,) = _struct_I.unpack(str[start:end])
00548       start = end
00549       end += length
00550       if python3:
00551         self.action_goal.goal_id.id = str[start:end].decode('utf-8')
00552       else:
00553         self.action_goal.goal_id.id = str[start:end]
00554       _x = self
00555       start = end
00556       end += 12
00557       (_x.action_goal.goal.target_pose.header.seq, _x.action_goal.goal.target_pose.header.stamp.secs, _x.action_goal.goal.target_pose.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00558       start = end
00559       end += 4
00560       (length,) = _struct_I.unpack(str[start:end])
00561       start = end
00562       end += length
00563       if python3:
00564         self.action_goal.goal.target_pose.header.frame_id = str[start:end].decode('utf-8')
00565       else:
00566         self.action_goal.goal.target_pose.header.frame_id = str[start:end]
00567       _x = self
00568       start = end
00569       end += 68
00570       (_x.action_goal.goal.target_pose.pose.position.x, _x.action_goal.goal.target_pose.pose.position.y, _x.action_goal.goal.target_pose.pose.position.z, _x.action_goal.goal.target_pose.pose.orientation.x, _x.action_goal.goal.target_pose.pose.orientation.y, _x.action_goal.goal.target_pose.pose.orientation.z, _x.action_goal.goal.target_pose.pose.orientation.w, _x.action_result.header.seq, _x.action_result.header.stamp.secs, _x.action_result.header.stamp.nsecs,) = _struct_7d3I.unpack(str[start:end])
00571       start = end
00572       end += 4
00573       (length,) = _struct_I.unpack(str[start:end])
00574       start = end
00575       end += length
00576       if python3:
00577         self.action_result.header.frame_id = str[start:end].decode('utf-8')
00578       else:
00579         self.action_result.header.frame_id = str[start:end]
00580       _x = self
00581       start = end
00582       end += 8
00583       (_x.action_result.status.goal_id.stamp.secs, _x.action_result.status.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00584       start = end
00585       end += 4
00586       (length,) = _struct_I.unpack(str[start:end])
00587       start = end
00588       end += length
00589       if python3:
00590         self.action_result.status.goal_id.id = str[start:end].decode('utf-8')
00591       else:
00592         self.action_result.status.goal_id.id = str[start:end]
00593       start = end
00594       end += 1
00595       (self.action_result.status.status,) = _struct_B.unpack(str[start:end])
00596       start = end
00597       end += 4
00598       (length,) = _struct_I.unpack(str[start:end])
00599       start = end
00600       end += length
00601       if python3:
00602         self.action_result.status.text = str[start:end].decode('utf-8')
00603       else:
00604         self.action_result.status.text = str[start:end]
00605       _x = self
00606       start = end
00607       end += 12
00608       (_x.action_feedback.header.seq, _x.action_feedback.header.stamp.secs, _x.action_feedback.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00609       start = end
00610       end += 4
00611       (length,) = _struct_I.unpack(str[start:end])
00612       start = end
00613       end += length
00614       if python3:
00615         self.action_feedback.header.frame_id = str[start:end].decode('utf-8')
00616       else:
00617         self.action_feedback.header.frame_id = str[start:end]
00618       _x = self
00619       start = end
00620       end += 8
00621       (_x.action_feedback.status.goal_id.stamp.secs, _x.action_feedback.status.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00622       start = end
00623       end += 4
00624       (length,) = _struct_I.unpack(str[start:end])
00625       start = end
00626       end += length
00627       if python3:
00628         self.action_feedback.status.goal_id.id = str[start:end].decode('utf-8')
00629       else:
00630         self.action_feedback.status.goal_id.id = str[start:end]
00631       start = end
00632       end += 1
00633       (self.action_feedback.status.status,) = _struct_B.unpack(str[start:end])
00634       start = end
00635       end += 4
00636       (length,) = _struct_I.unpack(str[start:end])
00637       start = end
00638       end += length
00639       if python3:
00640         self.action_feedback.status.text = str[start:end].decode('utf-8')
00641       else:
00642         self.action_feedback.status.text = str[start:end]
00643       _x = self
00644       start = end
00645       end += 12
00646       (_x.action_feedback.feedback.base_position.header.seq, _x.action_feedback.feedback.base_position.header.stamp.secs, _x.action_feedback.feedback.base_position.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00647       start = end
00648       end += 4
00649       (length,) = _struct_I.unpack(str[start:end])
00650       start = end
00651       end += length
00652       if python3:
00653         self.action_feedback.feedback.base_position.header.frame_id = str[start:end].decode('utf-8')
00654       else:
00655         self.action_feedback.feedback.base_position.header.frame_id = str[start:end]
00656       _x = self
00657       start = end
00658       end += 56
00659       (_x.action_feedback.feedback.base_position.pose.position.x, _x.action_feedback.feedback.base_position.pose.position.y, _x.action_feedback.feedback.base_position.pose.position.z, _x.action_feedback.feedback.base_position.pose.orientation.x, _x.action_feedback.feedback.base_position.pose.orientation.y, _x.action_feedback.feedback.base_position.pose.orientation.z, _x.action_feedback.feedback.base_position.pose.orientation.w,) = _struct_7d.unpack(str[start:end])
00660       return self
00661     except struct.error as e:
00662       raise genpy.DeserializationError(e) #most likely buffer underfill
00663 
00664 _struct_I = genpy.struct_I
00665 _struct_3I = struct.Struct("<3I")
00666 _struct_B = struct.Struct("<B")
00667 _struct_7d = struct.Struct("<7d")
00668 _struct_2I = struct.Struct("<2I")
00669 _struct_7d3I = struct.Struct("<7d3I")


move_base_msgs
Author(s): Eitan Marder-Eppstein
autogenerated on Sat Dec 28 2013 17:13:58