_LogAndMonitorInfo.py
Go to the documentation of this file.
00001 """autogenerated by genpy from hrl_haptic_manipulation_in_clutter_srvs/LogAndMonitorInfoRequest.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 
00009 class LogAndMonitorInfoRequest(genpy.Message):
00010   _md5sum = "e045f94af367795b99be0b4906cfb194"
00011   _type = "hrl_haptic_manipulation_in_clutter_srvs/LogAndMonitorInfoRequest"
00012   _has_header = False #flag to mark the presence of a Header object
00013   _full_text = """
00014 
00015 
00016 
00017 
00018 string logging_name
00019 
00020 
00021 geometry_msgs/Pose torso_pose
00022 
00023 
00024 
00025 geometry_msgs/Point local_goal
00026 
00027 
00028 
00029 
00030 
00031 
00032 
00033 float64 stopping_force
00034 
00035 float64 ee_motion_threshold
00036 
00037 ================================================================================
00038 MSG: geometry_msgs/Pose
00039 # A representation of pose in free space, composed of postion and orientation. 
00040 Point position
00041 Quaternion orientation
00042 
00043 ================================================================================
00044 MSG: geometry_msgs/Point
00045 # This contains the position of a point in free space
00046 float64 x
00047 float64 y
00048 float64 z
00049 
00050 ================================================================================
00051 MSG: geometry_msgs/Quaternion
00052 # This represents an orientation in free space in quaternion form.
00053 
00054 float64 x
00055 float64 y
00056 float64 z
00057 float64 w
00058 
00059 """
00060   __slots__ = ['logging_name','torso_pose','local_goal','stopping_force','ee_motion_threshold']
00061   _slot_types = ['string','geometry_msgs/Pose','geometry_msgs/Point','float64','float64']
00062 
00063   def __init__(self, *args, **kwds):
00064     """
00065     Constructor. Any message fields that are implicitly/explicitly
00066     set to None will be assigned a default value. The recommend
00067     use is keyword arguments as this is more robust to future message
00068     changes.  You cannot mix in-order arguments and keyword arguments.
00069 
00070     The available fields are:
00071        logging_name,torso_pose,local_goal,stopping_force,ee_motion_threshold
00072 
00073     :param args: complete set of field values, in .msg order
00074     :param kwds: use keyword arguments corresponding to message field names
00075     to set specific fields.
00076     """
00077     if args or kwds:
00078       super(LogAndMonitorInfoRequest, self).__init__(*args, **kwds)
00079       #message fields cannot be None, assign default values for those that are
00080       if self.logging_name is None:
00081         self.logging_name = ''
00082       if self.torso_pose is None:
00083         self.torso_pose = geometry_msgs.msg.Pose()
00084       if self.local_goal is None:
00085         self.local_goal = geometry_msgs.msg.Point()
00086       if self.stopping_force is None:
00087         self.stopping_force = 0.
00088       if self.ee_motion_threshold is None:
00089         self.ee_motion_threshold = 0.
00090     else:
00091       self.logging_name = ''
00092       self.torso_pose = geometry_msgs.msg.Pose()
00093       self.local_goal = geometry_msgs.msg.Point()
00094       self.stopping_force = 0.
00095       self.ee_motion_threshold = 0.
00096 
00097   def _get_types(self):
00098     """
00099     internal API method
00100     """
00101     return self._slot_types
00102 
00103   def serialize(self, buff):
00104     """
00105     serialize message into buffer
00106     :param buff: buffer, ``StringIO``
00107     """
00108     try:
00109       _x = self.logging_name
00110       length = len(_x)
00111       if python3 or type(_x) == unicode:
00112         _x = _x.encode('utf-8')
00113         length = len(_x)
00114       buff.write(struct.pack('<I%ss'%length, length, _x))
00115       _x = self
00116       buff.write(_struct_12d.pack(_x.torso_pose.position.x, _x.torso_pose.position.y, _x.torso_pose.position.z, _x.torso_pose.orientation.x, _x.torso_pose.orientation.y, _x.torso_pose.orientation.z, _x.torso_pose.orientation.w, _x.local_goal.x, _x.local_goal.y, _x.local_goal.z, _x.stopping_force, _x.ee_motion_threshold))
00117     except struct.error as se: self._check_types(se)
00118     except TypeError as te: self._check_types(te)
00119 
00120   def deserialize(self, str):
00121     """
00122     unpack serialized message in str into this message instance
00123     :param str: byte array of serialized message, ``str``
00124     """
00125     try:
00126       if self.torso_pose is None:
00127         self.torso_pose = geometry_msgs.msg.Pose()
00128       if self.local_goal is None:
00129         self.local_goal = geometry_msgs.msg.Point()
00130       end = 0
00131       start = end
00132       end += 4
00133       (length,) = _struct_I.unpack(str[start:end])
00134       start = end
00135       end += length
00136       if python3:
00137         self.logging_name = str[start:end].decode('utf-8')
00138       else:
00139         self.logging_name = str[start:end]
00140       _x = self
00141       start = end
00142       end += 96
00143       (_x.torso_pose.position.x, _x.torso_pose.position.y, _x.torso_pose.position.z, _x.torso_pose.orientation.x, _x.torso_pose.orientation.y, _x.torso_pose.orientation.z, _x.torso_pose.orientation.w, _x.local_goal.x, _x.local_goal.y, _x.local_goal.z, _x.stopping_force, _x.ee_motion_threshold,) = _struct_12d.unpack(str[start:end])
00144       return self
00145     except struct.error as e:
00146       raise genpy.DeserializationError(e) #most likely buffer underfill
00147 
00148 
00149   def serialize_numpy(self, buff, numpy):
00150     """
00151     serialize message with numpy array types into buffer
00152     :param buff: buffer, ``StringIO``
00153     :param numpy: numpy python module
00154     """
00155     try:
00156       _x = self.logging_name
00157       length = len(_x)
00158       if python3 or type(_x) == unicode:
00159         _x = _x.encode('utf-8')
00160         length = len(_x)
00161       buff.write(struct.pack('<I%ss'%length, length, _x))
00162       _x = self
00163       buff.write(_struct_12d.pack(_x.torso_pose.position.x, _x.torso_pose.position.y, _x.torso_pose.position.z, _x.torso_pose.orientation.x, _x.torso_pose.orientation.y, _x.torso_pose.orientation.z, _x.torso_pose.orientation.w, _x.local_goal.x, _x.local_goal.y, _x.local_goal.z, _x.stopping_force, _x.ee_motion_threshold))
00164     except struct.error as se: self._check_types(se)
00165     except TypeError as te: self._check_types(te)
00166 
00167   def deserialize_numpy(self, str, numpy):
00168     """
00169     unpack serialized message in str into this message instance using numpy for array types
00170     :param str: byte array of serialized message, ``str``
00171     :param numpy: numpy python module
00172     """
00173     try:
00174       if self.torso_pose is None:
00175         self.torso_pose = geometry_msgs.msg.Pose()
00176       if self.local_goal is None:
00177         self.local_goal = geometry_msgs.msg.Point()
00178       end = 0
00179       start = end
00180       end += 4
00181       (length,) = _struct_I.unpack(str[start:end])
00182       start = end
00183       end += length
00184       if python3:
00185         self.logging_name = str[start:end].decode('utf-8')
00186       else:
00187         self.logging_name = str[start:end]
00188       _x = self
00189       start = end
00190       end += 96
00191       (_x.torso_pose.position.x, _x.torso_pose.position.y, _x.torso_pose.position.z, _x.torso_pose.orientation.x, _x.torso_pose.orientation.y, _x.torso_pose.orientation.z, _x.torso_pose.orientation.w, _x.local_goal.x, _x.local_goal.y, _x.local_goal.z, _x.stopping_force, _x.ee_motion_threshold,) = _struct_12d.unpack(str[start:end])
00192       return self
00193     except struct.error as e:
00194       raise genpy.DeserializationError(e) #most likely buffer underfill
00195 
00196 _struct_I = genpy.struct_I
00197 _struct_12d = struct.Struct("<12d")
00198 """autogenerated by genpy from hrl_haptic_manipulation_in_clutter_srvs/LogAndMonitorInfoResponse.msg. Do not edit."""
00199 import sys
00200 python3 = True if sys.hexversion > 0x03000000 else False
00201 import genpy
00202 import struct
00203 
00204 
00205 class LogAndMonitorInfoResponse(genpy.Message):
00206   _md5sum = "d41d8cd98f00b204e9800998ecf8427e"
00207   _type = "hrl_haptic_manipulation_in_clutter_srvs/LogAndMonitorInfoResponse"
00208   _has_header = False #flag to mark the presence of a Header object
00209   _full_text = """
00210 
00211 
00212 """
00213   __slots__ = []
00214   _slot_types = []
00215 
00216   def __init__(self, *args, **kwds):
00217     """
00218     Constructor. Any message fields that are implicitly/explicitly
00219     set to None will be assigned a default value. The recommend
00220     use is keyword arguments as this is more robust to future message
00221     changes.  You cannot mix in-order arguments and keyword arguments.
00222 
00223     The available fields are:
00224        
00225 
00226     :param args: complete set of field values, in .msg order
00227     :param kwds: use keyword arguments corresponding to message field names
00228     to set specific fields.
00229     """
00230     if args or kwds:
00231       super(LogAndMonitorInfoResponse, self).__init__(*args, **kwds)
00232 
00233   def _get_types(self):
00234     """
00235     internal API method
00236     """
00237     return self._slot_types
00238 
00239   def serialize(self, buff):
00240     """
00241     serialize message into buffer
00242     :param buff: buffer, ``StringIO``
00243     """
00244     try:
00245       pass
00246     except struct.error as se: self._check_types(se)
00247     except TypeError as te: self._check_types(te)
00248 
00249   def deserialize(self, str):
00250     """
00251     unpack serialized message in str into this message instance
00252     :param str: byte array of serialized message, ``str``
00253     """
00254     try:
00255       end = 0
00256       return self
00257     except struct.error as e:
00258       raise genpy.DeserializationError(e) #most likely buffer underfill
00259 
00260 
00261   def serialize_numpy(self, buff, numpy):
00262     """
00263     serialize message with numpy array types into buffer
00264     :param buff: buffer, ``StringIO``
00265     :param numpy: numpy python module
00266     """
00267     try:
00268       pass
00269     except struct.error as se: self._check_types(se)
00270     except TypeError as te: self._check_types(te)
00271 
00272   def deserialize_numpy(self, str, numpy):
00273     """
00274     unpack serialized message in str into this message instance using numpy for array types
00275     :param str: byte array of serialized message, ``str``
00276     :param numpy: numpy python module
00277     """
00278     try:
00279       end = 0
00280       return self
00281     except struct.error as e:
00282       raise genpy.DeserializationError(e) #most likely buffer underfill
00283 
00284 _struct_I = genpy.struct_I
00285 class LogAndMonitorInfo(object):
00286   _type          = 'hrl_haptic_manipulation_in_clutter_srvs/LogAndMonitorInfo'
00287   _md5sum = 'e045f94af367795b99be0b4906cfb194'
00288   _request_class  = LogAndMonitorInfoRequest
00289   _response_class = LogAndMonitorInfoResponse


hrl_haptic_manipulation_in_clutter_srvs
Author(s): Advait Jain. Advisor: Prof. Charlie Kemp. Healthcare Robotics Lab, Georgia Tech
autogenerated on Wed Nov 27 2013 12:08:22