$search
00001 """autogenerated by genmsg_py from ElevationMapMetaData.msg. Do not edit.""" 00002 import roslib.message 00003 import struct 00004 00005 import geometry_msgs.msg 00006 import roslib.rostime 00007 00008 class ElevationMapMetaData(roslib.message.Message): 00009 _md5sum = "6c887873faf3a1d55d884bdcc92b9241" 00010 _type = "hector_elevation_msgs/ElevationMapMetaData" 00011 _has_header = False #flag to mark the presence of a Header object 00012 _full_text = """# This hold basic information about the characterists of the EvaluationGrid 00013 00014 # The time at which the map was loaded 00015 time map_load_time 00016 # Map resolution in xy plane [m/cell] 00017 float64 resolution_xy 00018 # Map resolution in height [m/cell] 00019 float64 resolution_z 00020 # min observed height [m] 00021 float64 min_elevation 00022 # max observed height [m] 00023 float64 max_elevation 00024 # Height zero value. For example 16384. 00025 int16 zero_elevation 00026 # Map width [cells] 00027 uint32 width 00028 # Map height [cells] 00029 uint32 height 00030 # The origin of the map [m, m, rad]. This is the real-world pose of the 00031 # cell (0,0) in the map. 00032 geometry_msgs/Pose origin 00033 00034 00035 00036 ================================================================================ 00037 MSG: geometry_msgs/Pose 00038 # A representation of pose in free space, composed of postion and orientation. 00039 Point position 00040 Quaternion orientation 00041 00042 ================================================================================ 00043 MSG: geometry_msgs/Point 00044 # This contains the position of a point in free space 00045 float64 x 00046 float64 y 00047 float64 z 00048 00049 ================================================================================ 00050 MSG: geometry_msgs/Quaternion 00051 # This represents an orientation in free space in quaternion form. 00052 00053 float64 x 00054 float64 y 00055 float64 z 00056 float64 w 00057 00058 """ 00059 __slots__ = ['map_load_time','resolution_xy','resolution_z','min_elevation','max_elevation','zero_elevation','width','height','origin'] 00060 _slot_types = ['time','float64','float64','float64','float64','int16','uint32','uint32','geometry_msgs/Pose'] 00061 00062 def __init__(self, *args, **kwds): 00063 """ 00064 Constructor. Any message fields that are implicitly/explicitly 00065 set to None will be assigned a default value. The recommend 00066 use is keyword arguments as this is more robust to future message 00067 changes. You cannot mix in-order arguments and keyword arguments. 00068 00069 The available fields are: 00070 map_load_time,resolution_xy,resolution_z,min_elevation,max_elevation,zero_elevation,width,height,origin 00071 00072 @param args: complete set of field values, in .msg order 00073 @param kwds: use keyword arguments corresponding to message field names 00074 to set specific fields. 00075 """ 00076 if args or kwds: 00077 super(ElevationMapMetaData, self).__init__(*args, **kwds) 00078 #message fields cannot be None, assign default values for those that are 00079 if self.map_load_time is None: 00080 self.map_load_time = roslib.rostime.Time() 00081 if self.resolution_xy is None: 00082 self.resolution_xy = 0. 00083 if self.resolution_z is None: 00084 self.resolution_z = 0. 00085 if self.min_elevation is None: 00086 self.min_elevation = 0. 00087 if self.max_elevation is None: 00088 self.max_elevation = 0. 00089 if self.zero_elevation is None: 00090 self.zero_elevation = 0 00091 if self.width is None: 00092 self.width = 0 00093 if self.height is None: 00094 self.height = 0 00095 if self.origin is None: 00096 self.origin = geometry_msgs.msg.Pose() 00097 else: 00098 self.map_load_time = roslib.rostime.Time() 00099 self.resolution_xy = 0. 00100 self.resolution_z = 0. 00101 self.min_elevation = 0. 00102 self.max_elevation = 0. 00103 self.zero_elevation = 0 00104 self.width = 0 00105 self.height = 0 00106 self.origin = geometry_msgs.msg.Pose() 00107 00108 def _get_types(self): 00109 """ 00110 internal API method 00111 """ 00112 return self._slot_types 00113 00114 def serialize(self, buff): 00115 """ 00116 serialize message into buffer 00117 @param buff: buffer 00118 @type buff: StringIO 00119 """ 00120 try: 00121 _x = self 00122 buff.write(_struct_2I4dh2I7d.pack(_x.map_load_time.secs, _x.map_load_time.nsecs, _x.resolution_xy, _x.resolution_z, _x.min_elevation, _x.max_elevation, _x.zero_elevation, _x.width, _x.height, _x.origin.position.x, _x.origin.position.y, _x.origin.position.z, _x.origin.orientation.x, _x.origin.orientation.y, _x.origin.orientation.z, _x.origin.orientation.w)) 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 00130 @type str: str 00131 """ 00132 try: 00133 if self.map_load_time is None: 00134 self.map_load_time = roslib.rostime.Time() 00135 if self.origin is None: 00136 self.origin = geometry_msgs.msg.Pose() 00137 end = 0 00138 _x = self 00139 start = end 00140 end += 106 00141 (_x.map_load_time.secs, _x.map_load_time.nsecs, _x.resolution_xy, _x.resolution_z, _x.min_elevation, _x.max_elevation, _x.zero_elevation, _x.width, _x.height, _x.origin.position.x, _x.origin.position.y, _x.origin.position.z, _x.origin.orientation.x, _x.origin.orientation.y, _x.origin.orientation.z, _x.origin.orientation.w,) = _struct_2I4dh2I7d.unpack(str[start:end]) 00142 self.map_load_time.canon() 00143 return self 00144 except struct.error as e: 00145 raise roslib.message.DeserializationError(e) #most likely buffer underfill 00146 00147 00148 def serialize_numpy(self, buff, numpy): 00149 """ 00150 serialize message with numpy array types into buffer 00151 @param buff: buffer 00152 @type buff: StringIO 00153 @param numpy: numpy python module 00154 @type numpy module 00155 """ 00156 try: 00157 _x = self 00158 buff.write(_struct_2I4dh2I7d.pack(_x.map_load_time.secs, _x.map_load_time.nsecs, _x.resolution_xy, _x.resolution_z, _x.min_elevation, _x.max_elevation, _x.zero_elevation, _x.width, _x.height, _x.origin.position.x, _x.origin.position.y, _x.origin.position.z, _x.origin.orientation.x, _x.origin.orientation.y, _x.origin.orientation.z, _x.origin.orientation.w)) 00159 except struct.error as se: self._check_types(se) 00160 except TypeError as te: self._check_types(te) 00161 00162 def deserialize_numpy(self, str, numpy): 00163 """ 00164 unpack serialized message in str into this message instance using numpy for array types 00165 @param str: byte array of serialized message 00166 @type str: str 00167 @param numpy: numpy python module 00168 @type numpy: module 00169 """ 00170 try: 00171 if self.map_load_time is None: 00172 self.map_load_time = roslib.rostime.Time() 00173 if self.origin is None: 00174 self.origin = geometry_msgs.msg.Pose() 00175 end = 0 00176 _x = self 00177 start = end 00178 end += 106 00179 (_x.map_load_time.secs, _x.map_load_time.nsecs, _x.resolution_xy, _x.resolution_z, _x.min_elevation, _x.max_elevation, _x.zero_elevation, _x.width, _x.height, _x.origin.position.x, _x.origin.position.y, _x.origin.position.z, _x.origin.orientation.x, _x.origin.orientation.y, _x.origin.orientation.z, _x.origin.orientation.w,) = _struct_2I4dh2I7d.unpack(str[start:end]) 00180 self.map_load_time.canon() 00181 return self 00182 except struct.error as e: 00183 raise roslib.message.DeserializationError(e) #most likely buffer underfill 00184 00185 _struct_I = roslib.message.struct_I 00186 _struct_2I4dh2I7d = struct.Struct("<2I4dh2I7d")