00001 """autogenerated by genmsg_py from PoseStampedIdMsg.msg. Do not edit."""
00002 import roslib.message
00003 import struct
00004
00005 import geometry_msgs.msg
00006 import std_msgs.msg
00007
00008 class PoseStampedIdMsg(roslib.message.Message):
00009 _md5sum = "b8aa1da8c5ac88617c490008a96c6564"
00010 _type = "articulation_structure/PoseStampedIdMsg"
00011 _has_header = False
00012 _full_text = """geometry_msgs/PoseStamped pose
00013 uint32 id
00014
00015 ================================================================================
00016 MSG: geometry_msgs/PoseStamped
00017 # A Pose with reference coordinate frame and timestamp
00018 Header header
00019 Pose pose
00020
00021 ================================================================================
00022 MSG: std_msgs/Header
00023 # Standard metadata for higher-level stamped data types.
00024 # This is generally used to communicate timestamped data
00025 # in a particular coordinate frame.
00026 #
00027 # sequence ID: consecutively increasing ID
00028 uint32 seq
00029 #Two-integer timestamp that is expressed as:
00030 # * stamp.secs: seconds (stamp_secs) since epoch
00031 # * stamp.nsecs: nanoseconds since stamp_secs
00032 # time-handling sugar is provided by the client library
00033 time stamp
00034 #Frame this data is associated with
00035 # 0: no frame
00036 # 1: global frame
00037 string frame_id
00038
00039 ================================================================================
00040 MSG: geometry_msgs/Pose
00041 # A representation of pose in free space, composed of postion and orientation.
00042 Point position
00043 Quaternion orientation
00044
00045 ================================================================================
00046 MSG: geometry_msgs/Point
00047 # This contains the position of a point in free space
00048 float64 x
00049 float64 y
00050 float64 z
00051
00052 ================================================================================
00053 MSG: geometry_msgs/Quaternion
00054 # This represents an orientation in free space in quaternion form.
00055
00056 float64 x
00057 float64 y
00058 float64 z
00059 float64 w
00060
00061 """
00062 __slots__ = ['pose','id']
00063 _slot_types = ['geometry_msgs/PoseStamped','uint32']
00064
00065 def __init__(self, *args, **kwds):
00066 """
00067 Constructor. Any message fields that are implicitly/explicitly
00068 set to None will be assigned a default value. The recommend
00069 use is keyword arguments as this is more robust to future message
00070 changes. You cannot mix in-order arguments and keyword arguments.
00071
00072 The available fields are:
00073 pose,id
00074
00075 @param args: complete set of field values, in .msg order
00076 @param kwds: use keyword arguments corresponding to message field names
00077 to set specific fields.
00078 """
00079 if args or kwds:
00080 super(PoseStampedIdMsg, self).__init__(*args, **kwds)
00081
00082 if self.pose is None:
00083 self.pose = geometry_msgs.msg.PoseStamped()
00084 if self.id is None:
00085 self.id = 0
00086 else:
00087 self.pose = geometry_msgs.msg.PoseStamped()
00088 self.id = 0
00089
00090 def _get_types(self):
00091 """
00092 internal API method
00093 """
00094 return self._slot_types
00095
00096 def serialize(self, buff):
00097 """
00098 serialize message into buffer
00099 @param buff: buffer
00100 @type buff: StringIO
00101 """
00102 try:
00103 _x = self
00104 buff.write(_struct_3I.pack(_x.pose.header.seq, _x.pose.header.stamp.secs, _x.pose.header.stamp.nsecs))
00105 _x = self.pose.header.frame_id
00106 length = len(_x)
00107 buff.write(struct.pack('<I%ss'%length, length, _x))
00108 _x = self
00109 buff.write(_struct_7dI.pack(_x.pose.pose.position.x, _x.pose.pose.position.y, _x.pose.pose.position.z, _x.pose.pose.orientation.x, _x.pose.pose.orientation.y, _x.pose.pose.orientation.z, _x.pose.pose.orientation.w, _x.id))
00110 except struct.error, se: self._check_types(se)
00111 except TypeError, te: self._check_types(te)
00112
00113 def deserialize(self, str):
00114 """
00115 unpack serialized message in str into this message instance
00116 @param str: byte array of serialized message
00117 @type str: str
00118 """
00119 try:
00120 if self.pose is None:
00121 self.pose = geometry_msgs.msg.PoseStamped()
00122 end = 0
00123 _x = self
00124 start = end
00125 end += 12
00126 (_x.pose.header.seq, _x.pose.header.stamp.secs, _x.pose.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00127 start = end
00128 end += 4
00129 (length,) = _struct_I.unpack(str[start:end])
00130 start = end
00131 end += length
00132 self.pose.header.frame_id = str[start:end]
00133 _x = self
00134 start = end
00135 end += 60
00136 (_x.pose.pose.position.x, _x.pose.pose.position.y, _x.pose.pose.position.z, _x.pose.pose.orientation.x, _x.pose.pose.orientation.y, _x.pose.pose.orientation.z, _x.pose.pose.orientation.w, _x.id,) = _struct_7dI.unpack(str[start:end])
00137 return self
00138 except struct.error, e:
00139 raise roslib.message.DeserializationError(e)
00140
00141
00142 def serialize_numpy(self, buff, numpy):
00143 """
00144 serialize message with numpy array types into buffer
00145 @param buff: buffer
00146 @type buff: StringIO
00147 @param numpy: numpy python module
00148 @type numpy module
00149 """
00150 try:
00151 _x = self
00152 buff.write(_struct_3I.pack(_x.pose.header.seq, _x.pose.header.stamp.secs, _x.pose.header.stamp.nsecs))
00153 _x = self.pose.header.frame_id
00154 length = len(_x)
00155 buff.write(struct.pack('<I%ss'%length, length, _x))
00156 _x = self
00157 buff.write(_struct_7dI.pack(_x.pose.pose.position.x, _x.pose.pose.position.y, _x.pose.pose.position.z, _x.pose.pose.orientation.x, _x.pose.pose.orientation.y, _x.pose.pose.orientation.z, _x.pose.pose.orientation.w, _x.id))
00158 except struct.error, se: self._check_types(se)
00159 except TypeError, te: self._check_types(te)
00160
00161 def deserialize_numpy(self, str, numpy):
00162 """
00163 unpack serialized message in str into this message instance using numpy for array types
00164 @param str: byte array of serialized message
00165 @type str: str
00166 @param numpy: numpy python module
00167 @type numpy: module
00168 """
00169 try:
00170 if self.pose is None:
00171 self.pose = geometry_msgs.msg.PoseStamped()
00172 end = 0
00173 _x = self
00174 start = end
00175 end += 12
00176 (_x.pose.header.seq, _x.pose.header.stamp.secs, _x.pose.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00177 start = end
00178 end += 4
00179 (length,) = _struct_I.unpack(str[start:end])
00180 start = end
00181 end += length
00182 self.pose.header.frame_id = str[start:end]
00183 _x = self
00184 start = end
00185 end += 60
00186 (_x.pose.pose.position.x, _x.pose.pose.position.y, _x.pose.pose.position.z, _x.pose.pose.orientation.x, _x.pose.pose.orientation.y, _x.pose.pose.orientation.z, _x.pose.pose.orientation.w, _x.id,) = _struct_7dI.unpack(str[start:end])
00187 return self
00188 except struct.error, e:
00189 raise roslib.message.DeserializationError(e)
00190
00191 _struct_I = roslib.message.struct_I
00192 _struct_7dI = struct.Struct("<7dI")
00193 _struct_3I = struct.Struct("<3I")