00001 """autogenerated by genmsg_py from ConfigActionGoal.msg. Do not edit."""
00002 import roslib.message
00003 import struct
00004
00005 import image_cb_detector.msg
00006 import roslib.rostime
00007 import actionlib_msgs.msg
00008 import std_msgs.msg
00009
00010 class ConfigActionGoal(roslib.message.Message):
00011 _md5sum = "47438deb496822a5e3dc575b6081de23"
00012 _type = "image_cb_detector/ConfigActionGoal"
00013 _has_header = True
00014 _full_text = """
00015 Header header
00016 actionlib_msgs/GoalID goal_id
00017 ConfigGoal goal
00018
00019 ================================================================================
00020 MSG: std_msgs/Header
00021 # Standard metadata for higher-level stamped data types.
00022 # This is generally used to communicate timestamped data
00023 # in a particular coordinate frame.
00024 #
00025 # sequence ID: consecutively increasing ID
00026 uint32 seq
00027 #Two-integer timestamp that is expressed as:
00028 # * stamp.secs: seconds (stamp_secs) since epoch
00029 # * stamp.nsecs: nanoseconds since stamp_secs
00030 # time-handling sugar is provided by the client library
00031 time stamp
00032 #Frame this data is associated with
00033 # 0: no frame
00034 # 1: global frame
00035 string frame_id
00036
00037 ================================================================================
00038 MSG: actionlib_msgs/GoalID
00039 # The stamp should store the time at which this goal was requested.
00040 # It is used by an action server when it tries to preempt all
00041 # goals that were requested before a certain time
00042 time stamp
00043
00044 # The id provides a way to associate feedback and
00045 # result message with specific goal requests. The id
00046 # specified must be unique.
00047 string id
00048
00049
00050 ================================================================================
00051 MSG: image_cb_detector/ConfigGoal
00052 uint32 num_x # Number of checkerboard corners in the X direction
00053 uint32 num_y # Number of corners in the Y direction
00054 float32 spacing_x # Spacing between corners in the X direction (meters)
00055 float32 spacing_y # Spacing between corners in the Y direction (meters)
00056
00057 # Specify how many times we want to upsample the image.
00058 # This is often useful for detecting small checkerboards far away
00059 float32 width_scaling
00060 float32 height_scaling
00061
00062 # Configure openCV's subpixel corner detector
00063 uint32 subpixel_window
00064 int32 subpixel_zero_zone
00065
00066
00067 """
00068 __slots__ = ['header','goal_id','goal']
00069 _slot_types = ['Header','actionlib_msgs/GoalID','image_cb_detector/ConfigGoal']
00070
00071 def __init__(self, *args, **kwds):
00072 """
00073 Constructor. Any message fields that are implicitly/explicitly
00074 set to None will be assigned a default value. The recommend
00075 use is keyword arguments as this is more robust to future message
00076 changes. You cannot mix in-order arguments and keyword arguments.
00077
00078 The available fields are:
00079 header,goal_id,goal
00080
00081 @param args: complete set of field values, in .msg order
00082 @param kwds: use keyword arguments corresponding to message field names
00083 to set specific fields.
00084 """
00085 if args or kwds:
00086 super(ConfigActionGoal, self).__init__(*args, **kwds)
00087
00088 if self.header is None:
00089 self.header = std_msgs.msg._Header.Header()
00090 if self.goal_id is None:
00091 self.goal_id = actionlib_msgs.msg.GoalID()
00092 if self.goal is None:
00093 self.goal = image_cb_detector.msg.ConfigGoal()
00094 else:
00095 self.header = std_msgs.msg._Header.Header()
00096 self.goal_id = actionlib_msgs.msg.GoalID()
00097 self.goal = image_cb_detector.msg.ConfigGoal()
00098
00099 def _get_types(self):
00100 """
00101 internal API method
00102 """
00103 return self._slot_types
00104
00105 def serialize(self, buff):
00106 """
00107 serialize message into buffer
00108 @param buff: buffer
00109 @type buff: StringIO
00110 """
00111 try:
00112 _x = self
00113 buff.write(_struct_3I.pack(_x.header.seq, _x.header.stamp.secs, _x.header.stamp.nsecs))
00114 _x = self.header.frame_id
00115 length = len(_x)
00116 buff.write(struct.pack('<I%ss'%length, length, _x))
00117 _x = self
00118 buff.write(_struct_2I.pack(_x.goal_id.stamp.secs, _x.goal_id.stamp.nsecs))
00119 _x = self.goal_id.id
00120 length = len(_x)
00121 buff.write(struct.pack('<I%ss'%length, length, _x))
00122 _x = self
00123 buff.write(_struct_2I4fIi.pack(_x.goal.num_x, _x.goal.num_y, _x.goal.spacing_x, _x.goal.spacing_y, _x.goal.width_scaling, _x.goal.height_scaling, _x.goal.subpixel_window, _x.goal.subpixel_zero_zone))
00124 except struct.error, se: self._check_types(se)
00125 except TypeError, te: self._check_types(te)
00126
00127 def deserialize(self, str):
00128 """
00129 unpack serialized message in str into this message instance
00130 @param str: byte array of serialized message
00131 @type str: str
00132 """
00133 try:
00134 if self.header is None:
00135 self.header = std_msgs.msg._Header.Header()
00136 if self.goal_id is None:
00137 self.goal_id = actionlib_msgs.msg.GoalID()
00138 if self.goal is None:
00139 self.goal = image_cb_detector.msg.ConfigGoal()
00140 end = 0
00141 _x = self
00142 start = end
00143 end += 12
00144 (_x.header.seq, _x.header.stamp.secs, _x.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00145 start = end
00146 end += 4
00147 (length,) = _struct_I.unpack(str[start:end])
00148 start = end
00149 end += length
00150 self.header.frame_id = str[start:end]
00151 _x = self
00152 start = end
00153 end += 8
00154 (_x.goal_id.stamp.secs, _x.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00155 start = end
00156 end += 4
00157 (length,) = _struct_I.unpack(str[start:end])
00158 start = end
00159 end += length
00160 self.goal_id.id = str[start:end]
00161 _x = self
00162 start = end
00163 end += 32
00164 (_x.goal.num_x, _x.goal.num_y, _x.goal.spacing_x, _x.goal.spacing_y, _x.goal.width_scaling, _x.goal.height_scaling, _x.goal.subpixel_window, _x.goal.subpixel_zero_zone,) = _struct_2I4fIi.unpack(str[start:end])
00165 return self
00166 except struct.error, e:
00167 raise roslib.message.DeserializationError(e)
00168
00169
00170 def serialize_numpy(self, buff, numpy):
00171 """
00172 serialize message with numpy array types into buffer
00173 @param buff: buffer
00174 @type buff: StringIO
00175 @param numpy: numpy python module
00176 @type numpy module
00177 """
00178 try:
00179 _x = self
00180 buff.write(_struct_3I.pack(_x.header.seq, _x.header.stamp.secs, _x.header.stamp.nsecs))
00181 _x = self.header.frame_id
00182 length = len(_x)
00183 buff.write(struct.pack('<I%ss'%length, length, _x))
00184 _x = self
00185 buff.write(_struct_2I.pack(_x.goal_id.stamp.secs, _x.goal_id.stamp.nsecs))
00186 _x = self.goal_id.id
00187 length = len(_x)
00188 buff.write(struct.pack('<I%ss'%length, length, _x))
00189 _x = self
00190 buff.write(_struct_2I4fIi.pack(_x.goal.num_x, _x.goal.num_y, _x.goal.spacing_x, _x.goal.spacing_y, _x.goal.width_scaling, _x.goal.height_scaling, _x.goal.subpixel_window, _x.goal.subpixel_zero_zone))
00191 except struct.error, se: self._check_types(se)
00192 except TypeError, te: self._check_types(te)
00193
00194 def deserialize_numpy(self, str, numpy):
00195 """
00196 unpack serialized message in str into this message instance using numpy for array types
00197 @param str: byte array of serialized message
00198 @type str: str
00199 @param numpy: numpy python module
00200 @type numpy: module
00201 """
00202 try:
00203 if self.header is None:
00204 self.header = std_msgs.msg._Header.Header()
00205 if self.goal_id is None:
00206 self.goal_id = actionlib_msgs.msg.GoalID()
00207 if self.goal is None:
00208 self.goal = image_cb_detector.msg.ConfigGoal()
00209 end = 0
00210 _x = self
00211 start = end
00212 end += 12
00213 (_x.header.seq, _x.header.stamp.secs, _x.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00214 start = end
00215 end += 4
00216 (length,) = _struct_I.unpack(str[start:end])
00217 start = end
00218 end += length
00219 self.header.frame_id = str[start:end]
00220 _x = self
00221 start = end
00222 end += 8
00223 (_x.goal_id.stamp.secs, _x.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00224 start = end
00225 end += 4
00226 (length,) = _struct_I.unpack(str[start:end])
00227 start = end
00228 end += length
00229 self.goal_id.id = str[start:end]
00230 _x = self
00231 start = end
00232 end += 32
00233 (_x.goal.num_x, _x.goal.num_y, _x.goal.spacing_x, _x.goal.spacing_y, _x.goal.width_scaling, _x.goal.height_scaling, _x.goal.subpixel_window, _x.goal.subpixel_zero_zone,) = _struct_2I4fIi.unpack(str[start:end])
00234 return self
00235 except struct.error, e:
00236 raise roslib.message.DeserializationError(e)
00237
00238 _struct_I = roslib.message.struct_I
00239 _struct_3I = struct.Struct("<3I")
00240 _struct_2I = struct.Struct("<2I")
00241 _struct_2I4fIi = struct.Struct("<2I4fIi")