00001 """autogenerated by genpy from zyonz_camera_pose_around_point/GetPoseRequest.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 std_msgs.msg
00009
00010 class GetPoseRequest(genpy.Message):
00011 _md5sum = "d87fdcc7ace13b2e88e34dcc06652e84"
00012 _type = "zyonz_camera_pose_around_point/GetPoseRequest"
00013 _has_header = False
00014 _full_text = """
00015 geometry_msgs/PoseStamped view_point
00016 float64 dist_m
00017 float64 rad_x_rot
00018 float64 rad_y_rot
00019
00020 ================================================================================
00021 MSG: geometry_msgs/PoseStamped
00022 # A Pose with reference coordinate frame and timestamp
00023 Header header
00024 Pose pose
00025
00026 ================================================================================
00027 MSG: std_msgs/Header
00028 # Standard metadata for higher-level stamped data types.
00029 # This is generally used to communicate timestamped data
00030 # in a particular coordinate frame.
00031 #
00032 # sequence ID: consecutively increasing ID
00033 uint32 seq
00034 #Two-integer timestamp that is expressed as:
00035 # * stamp.secs: seconds (stamp_secs) since epoch
00036 # * stamp.nsecs: nanoseconds since stamp_secs
00037 # time-handling sugar is provided by the client library
00038 time stamp
00039 #Frame this data is associated with
00040 # 0: no frame
00041 # 1: global frame
00042 string frame_id
00043
00044 ================================================================================
00045 MSG: geometry_msgs/Pose
00046 # A representation of pose in free space, composed of postion and orientation.
00047 Point position
00048 Quaternion orientation
00049
00050 ================================================================================
00051 MSG: geometry_msgs/Point
00052 # This contains the position of a point in free space
00053 float64 x
00054 float64 y
00055 float64 z
00056
00057 ================================================================================
00058 MSG: geometry_msgs/Quaternion
00059 # This represents an orientation in free space in quaternion form.
00060
00061 float64 x
00062 float64 y
00063 float64 z
00064 float64 w
00065
00066 """
00067 __slots__ = ['view_point','dist_m','rad_x_rot','rad_y_rot']
00068 _slot_types = ['geometry_msgs/PoseStamped','float64','float64','float64']
00069
00070 def __init__(self, *args, **kwds):
00071 """
00072 Constructor. Any message fields that are implicitly/explicitly
00073 set to None will be assigned a default value. The recommend
00074 use is keyword arguments as this is more robust to future message
00075 changes. You cannot mix in-order arguments and keyword arguments.
00076
00077 The available fields are:
00078 view_point,dist_m,rad_x_rot,rad_y_rot
00079
00080 :param args: complete set of field values, in .msg order
00081 :param kwds: use keyword arguments corresponding to message field names
00082 to set specific fields.
00083 """
00084 if args or kwds:
00085 super(GetPoseRequest, self).__init__(*args, **kwds)
00086
00087 if self.view_point is None:
00088 self.view_point = geometry_msgs.msg.PoseStamped()
00089 if self.dist_m is None:
00090 self.dist_m = 0.
00091 if self.rad_x_rot is None:
00092 self.rad_x_rot = 0.
00093 if self.rad_y_rot is None:
00094 self.rad_y_rot = 0.
00095 else:
00096 self.view_point = geometry_msgs.msg.PoseStamped()
00097 self.dist_m = 0.
00098 self.rad_x_rot = 0.
00099 self.rad_y_rot = 0.
00100
00101 def _get_types(self):
00102 """
00103 internal API method
00104 """
00105 return self._slot_types
00106
00107 def serialize(self, buff):
00108 """
00109 serialize message into buffer
00110 :param buff: buffer, ``StringIO``
00111 """
00112 try:
00113 _x = self
00114 buff.write(_struct_3I.pack(_x.view_point.header.seq, _x.view_point.header.stamp.secs, _x.view_point.header.stamp.nsecs))
00115 _x = self.view_point.header.frame_id
00116 length = len(_x)
00117 if python3 or type(_x) == unicode:
00118 _x = _x.encode('utf-8')
00119 length = len(_x)
00120 buff.write(struct.pack('<I%ss'%length, length, _x))
00121 _x = self
00122 buff.write(_struct_10d.pack(_x.view_point.pose.position.x, _x.view_point.pose.position.y, _x.view_point.pose.position.z, _x.view_point.pose.orientation.x, _x.view_point.pose.orientation.y, _x.view_point.pose.orientation.z, _x.view_point.pose.orientation.w, _x.dist_m, _x.rad_x_rot, _x.rad_y_rot))
00123 except struct.error as se: self._check_types(se)
00124 except TypeError as te: self._check_types(te)
00125
00126 def deserialize(self, str):
00127 """
00128 unpack serialized message in str into this message instance
00129 :param str: byte array of serialized message, ``str``
00130 """
00131 try:
00132 if self.view_point is None:
00133 self.view_point = geometry_msgs.msg.PoseStamped()
00134 end = 0
00135 _x = self
00136 start = end
00137 end += 12
00138 (_x.view_point.header.seq, _x.view_point.header.stamp.secs, _x.view_point.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00139 start = end
00140 end += 4
00141 (length,) = _struct_I.unpack(str[start:end])
00142 start = end
00143 end += length
00144 if python3:
00145 self.view_point.header.frame_id = str[start:end].decode('utf-8')
00146 else:
00147 self.view_point.header.frame_id = str[start:end]
00148 _x = self
00149 start = end
00150 end += 80
00151 (_x.view_point.pose.position.x, _x.view_point.pose.position.y, _x.view_point.pose.position.z, _x.view_point.pose.orientation.x, _x.view_point.pose.orientation.y, _x.view_point.pose.orientation.z, _x.view_point.pose.orientation.w, _x.dist_m, _x.rad_x_rot, _x.rad_y_rot,) = _struct_10d.unpack(str[start:end])
00152 return self
00153 except struct.error as e:
00154 raise genpy.DeserializationError(e)
00155
00156
00157 def serialize_numpy(self, buff, numpy):
00158 """
00159 serialize message with numpy array types into buffer
00160 :param buff: buffer, ``StringIO``
00161 :param numpy: numpy python module
00162 """
00163 try:
00164 _x = self
00165 buff.write(_struct_3I.pack(_x.view_point.header.seq, _x.view_point.header.stamp.secs, _x.view_point.header.stamp.nsecs))
00166 _x = self.view_point.header.frame_id
00167 length = len(_x)
00168 if python3 or type(_x) == unicode:
00169 _x = _x.encode('utf-8')
00170 length = len(_x)
00171 buff.write(struct.pack('<I%ss'%length, length, _x))
00172 _x = self
00173 buff.write(_struct_10d.pack(_x.view_point.pose.position.x, _x.view_point.pose.position.y, _x.view_point.pose.position.z, _x.view_point.pose.orientation.x, _x.view_point.pose.orientation.y, _x.view_point.pose.orientation.z, _x.view_point.pose.orientation.w, _x.dist_m, _x.rad_x_rot, _x.rad_y_rot))
00174 except struct.error as se: self._check_types(se)
00175 except TypeError as te: self._check_types(te)
00176
00177 def deserialize_numpy(self, str, numpy):
00178 """
00179 unpack serialized message in str into this message instance using numpy for array types
00180 :param str: byte array of serialized message, ``str``
00181 :param numpy: numpy python module
00182 """
00183 try:
00184 if self.view_point is None:
00185 self.view_point = geometry_msgs.msg.PoseStamped()
00186 end = 0
00187 _x = self
00188 start = end
00189 end += 12
00190 (_x.view_point.header.seq, _x.view_point.header.stamp.secs, _x.view_point.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00191 start = end
00192 end += 4
00193 (length,) = _struct_I.unpack(str[start:end])
00194 start = end
00195 end += length
00196 if python3:
00197 self.view_point.header.frame_id = str[start:end].decode('utf-8')
00198 else:
00199 self.view_point.header.frame_id = str[start:end]
00200 _x = self
00201 start = end
00202 end += 80
00203 (_x.view_point.pose.position.x, _x.view_point.pose.position.y, _x.view_point.pose.position.z, _x.view_point.pose.orientation.x, _x.view_point.pose.orientation.y, _x.view_point.pose.orientation.z, _x.view_point.pose.orientation.w, _x.dist_m, _x.rad_x_rot, _x.rad_y_rot,) = _struct_10d.unpack(str[start:end])
00204 return self
00205 except struct.error as e:
00206 raise genpy.DeserializationError(e)
00207
00208 _struct_I = genpy.struct_I
00209 _struct_3I = struct.Struct("<3I")
00210 _struct_10d = struct.Struct("<10d")
00211 """autogenerated by genpy from zyonz_camera_pose_around_point/GetPoseResponse.msg. Do not edit."""
00212 import sys
00213 python3 = True if sys.hexversion > 0x03000000 else False
00214 import genpy
00215 import struct
00216
00217 import geometry_msgs.msg
00218 import std_msgs.msg
00219
00220 class GetPoseResponse(genpy.Message):
00221 _md5sum = "246a9de5f3aa72a785c6eca7097a1af8"
00222 _type = "zyonz_camera_pose_around_point/GetPoseResponse"
00223 _has_header = False
00224 _full_text = """
00225 geometry_msgs/PoseStamped camera_pose
00226
00227
00228 ================================================================================
00229 MSG: geometry_msgs/PoseStamped
00230 # A Pose with reference coordinate frame and timestamp
00231 Header header
00232 Pose pose
00233
00234 ================================================================================
00235 MSG: std_msgs/Header
00236 # Standard metadata for higher-level stamped data types.
00237 # This is generally used to communicate timestamped data
00238 # in a particular coordinate frame.
00239 #
00240 # sequence ID: consecutively increasing ID
00241 uint32 seq
00242 #Two-integer timestamp that is expressed as:
00243 # * stamp.secs: seconds (stamp_secs) since epoch
00244 # * stamp.nsecs: nanoseconds since stamp_secs
00245 # time-handling sugar is provided by the client library
00246 time stamp
00247 #Frame this data is associated with
00248 # 0: no frame
00249 # 1: global frame
00250 string frame_id
00251
00252 ================================================================================
00253 MSG: geometry_msgs/Pose
00254 # A representation of pose in free space, composed of postion and orientation.
00255 Point position
00256 Quaternion orientation
00257
00258 ================================================================================
00259 MSG: geometry_msgs/Point
00260 # This contains the position of a point in free space
00261 float64 x
00262 float64 y
00263 float64 z
00264
00265 ================================================================================
00266 MSG: geometry_msgs/Quaternion
00267 # This represents an orientation in free space in quaternion form.
00268
00269 float64 x
00270 float64 y
00271 float64 z
00272 float64 w
00273
00274 """
00275 __slots__ = ['camera_pose']
00276 _slot_types = ['geometry_msgs/PoseStamped']
00277
00278 def __init__(self, *args, **kwds):
00279 """
00280 Constructor. Any message fields that are implicitly/explicitly
00281 set to None will be assigned a default value. The recommend
00282 use is keyword arguments as this is more robust to future message
00283 changes. You cannot mix in-order arguments and keyword arguments.
00284
00285 The available fields are:
00286 camera_pose
00287
00288 :param args: complete set of field values, in .msg order
00289 :param kwds: use keyword arguments corresponding to message field names
00290 to set specific fields.
00291 """
00292 if args or kwds:
00293 super(GetPoseResponse, self).__init__(*args, **kwds)
00294
00295 if self.camera_pose is None:
00296 self.camera_pose = geometry_msgs.msg.PoseStamped()
00297 else:
00298 self.camera_pose = geometry_msgs.msg.PoseStamped()
00299
00300 def _get_types(self):
00301 """
00302 internal API method
00303 """
00304 return self._slot_types
00305
00306 def serialize(self, buff):
00307 """
00308 serialize message into buffer
00309 :param buff: buffer, ``StringIO``
00310 """
00311 try:
00312 _x = self
00313 buff.write(_struct_3I.pack(_x.camera_pose.header.seq, _x.camera_pose.header.stamp.secs, _x.camera_pose.header.stamp.nsecs))
00314 _x = self.camera_pose.header.frame_id
00315 length = len(_x)
00316 if python3 or type(_x) == unicode:
00317 _x = _x.encode('utf-8')
00318 length = len(_x)
00319 buff.write(struct.pack('<I%ss'%length, length, _x))
00320 _x = self
00321 buff.write(_struct_7d.pack(_x.camera_pose.pose.position.x, _x.camera_pose.pose.position.y, _x.camera_pose.pose.position.z, _x.camera_pose.pose.orientation.x, _x.camera_pose.pose.orientation.y, _x.camera_pose.pose.orientation.z, _x.camera_pose.pose.orientation.w))
00322 except struct.error as se: self._check_types(se)
00323 except TypeError as te: self._check_types(te)
00324
00325 def deserialize(self, str):
00326 """
00327 unpack serialized message in str into this message instance
00328 :param str: byte array of serialized message, ``str``
00329 """
00330 try:
00331 if self.camera_pose is None:
00332 self.camera_pose = geometry_msgs.msg.PoseStamped()
00333 end = 0
00334 _x = self
00335 start = end
00336 end += 12
00337 (_x.camera_pose.header.seq, _x.camera_pose.header.stamp.secs, _x.camera_pose.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00338 start = end
00339 end += 4
00340 (length,) = _struct_I.unpack(str[start:end])
00341 start = end
00342 end += length
00343 if python3:
00344 self.camera_pose.header.frame_id = str[start:end].decode('utf-8')
00345 else:
00346 self.camera_pose.header.frame_id = str[start:end]
00347 _x = self
00348 start = end
00349 end += 56
00350 (_x.camera_pose.pose.position.x, _x.camera_pose.pose.position.y, _x.camera_pose.pose.position.z, _x.camera_pose.pose.orientation.x, _x.camera_pose.pose.orientation.y, _x.camera_pose.pose.orientation.z, _x.camera_pose.pose.orientation.w,) = _struct_7d.unpack(str[start:end])
00351 return self
00352 except struct.error as e:
00353 raise genpy.DeserializationError(e)
00354
00355
00356 def serialize_numpy(self, buff, numpy):
00357 """
00358 serialize message with numpy array types into buffer
00359 :param buff: buffer, ``StringIO``
00360 :param numpy: numpy python module
00361 """
00362 try:
00363 _x = self
00364 buff.write(_struct_3I.pack(_x.camera_pose.header.seq, _x.camera_pose.header.stamp.secs, _x.camera_pose.header.stamp.nsecs))
00365 _x = self.camera_pose.header.frame_id
00366 length = len(_x)
00367 if python3 or type(_x) == unicode:
00368 _x = _x.encode('utf-8')
00369 length = len(_x)
00370 buff.write(struct.pack('<I%ss'%length, length, _x))
00371 _x = self
00372 buff.write(_struct_7d.pack(_x.camera_pose.pose.position.x, _x.camera_pose.pose.position.y, _x.camera_pose.pose.position.z, _x.camera_pose.pose.orientation.x, _x.camera_pose.pose.orientation.y, _x.camera_pose.pose.orientation.z, _x.camera_pose.pose.orientation.w))
00373 except struct.error as se: self._check_types(se)
00374 except TypeError as te: self._check_types(te)
00375
00376 def deserialize_numpy(self, str, numpy):
00377 """
00378 unpack serialized message in str into this message instance using numpy for array types
00379 :param str: byte array of serialized message, ``str``
00380 :param numpy: numpy python module
00381 """
00382 try:
00383 if self.camera_pose is None:
00384 self.camera_pose = geometry_msgs.msg.PoseStamped()
00385 end = 0
00386 _x = self
00387 start = end
00388 end += 12
00389 (_x.camera_pose.header.seq, _x.camera_pose.header.stamp.secs, _x.camera_pose.header.stamp.nsecs,) = _struct_3I.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.camera_pose.header.frame_id = str[start:end].decode('utf-8')
00397 else:
00398 self.camera_pose.header.frame_id = str[start:end]
00399 _x = self
00400 start = end
00401 end += 56
00402 (_x.camera_pose.pose.position.x, _x.camera_pose.pose.position.y, _x.camera_pose.pose.position.z, _x.camera_pose.pose.orientation.x, _x.camera_pose.pose.orientation.y, _x.camera_pose.pose.orientation.z, _x.camera_pose.pose.orientation.w,) = _struct_7d.unpack(str[start:end])
00403 return self
00404 except struct.error as e:
00405 raise genpy.DeserializationError(e)
00406
00407 _struct_I = genpy.struct_I
00408 _struct_3I = struct.Struct("<3I")
00409 _struct_7d = struct.Struct("<7d")
00410 class GetPose(object):
00411 _type = 'zyonz_camera_pose_around_point/GetPose'
00412 _md5sum = '25411257a55fefcb48accdecf353d3dc'
00413 _request_class = GetPoseRequest
00414 _response_class = GetPoseResponse