Go to the documentation of this file.00001
00002
00003
00004
00005
00006
00007
00008
00009
00010
00011
00012
00013
00014
00015
00016
00017
00018
00019
00020
00021
00022
00023
00024
00025
00026
00027
00028
00029
00030
00031
00032
00033
00034
00035
00036
00037
00038 #ifndef PR2_CONTROLLERS_MSGS_MESSAGE_POINTHEADACTIONGOAL_H
00039 #define PR2_CONTROLLERS_MSGS_MESSAGE_POINTHEADACTIONGOAL_H
00040
00041
00042 #include <string>
00043 #include <vector>
00044 #include <map>
00045
00046 #include <ros/types.h>
00047 #include <ros/serialization.h>
00048 #include <ros/builtin_message_traits.h>
00049 #include <ros/message_operations.h>
00050
00051 #include <std_msgs/Header.h>
00052 #include <actionlib_msgs/GoalID.h>
00053 #include <pr2_controllers_msgs/PointHeadGoal.h>
00054
00055 namespace pr2_controllers_msgs
00056 {
00057 template <class ContainerAllocator>
00058 struct PointHeadActionGoal_
00059 {
00060 typedef PointHeadActionGoal_<ContainerAllocator> Type;
00061
00062 PointHeadActionGoal_()
00063 : header()
00064 , goal_id()
00065 , goal() {
00066 }
00067 PointHeadActionGoal_(const ContainerAllocator& _alloc)
00068 : header(_alloc)
00069 , goal_id(_alloc)
00070 , goal(_alloc) {
00071 }
00072
00073
00074
00075 typedef ::std_msgs::Header_<ContainerAllocator> _header_type;
00076 _header_type header;
00077
00078 typedef ::actionlib_msgs::GoalID_<ContainerAllocator> _goal_id_type;
00079 _goal_id_type goal_id;
00080
00081 typedef ::pr2_controllers_msgs::PointHeadGoal_<ContainerAllocator> _goal_type;
00082 _goal_type goal;
00083
00084
00085
00086
00087 typedef boost::shared_ptr< ::pr2_controllers_msgs::PointHeadActionGoal_<ContainerAllocator> > Ptr;
00088 typedef boost::shared_ptr< ::pr2_controllers_msgs::PointHeadActionGoal_<ContainerAllocator> const> ConstPtr;
00089 boost::shared_ptr<std::map<std::string, std::string> > __connection_header;
00090
00091 };
00092
00093 typedef ::pr2_controllers_msgs::PointHeadActionGoal_<std::allocator<void> > PointHeadActionGoal;
00094
00095 typedef boost::shared_ptr< ::pr2_controllers_msgs::PointHeadActionGoal > PointHeadActionGoalPtr;
00096 typedef boost::shared_ptr< ::pr2_controllers_msgs::PointHeadActionGoal const> PointHeadActionGoalConstPtr;
00097
00098
00099
00100
00101
00102 template<typename ContainerAllocator>
00103 std::ostream& operator<<(std::ostream& s, const ::pr2_controllers_msgs::PointHeadActionGoal_<ContainerAllocator> & v)
00104 {
00105 ros::message_operations::Printer< ::pr2_controllers_msgs::PointHeadActionGoal_<ContainerAllocator> >::stream(s, "", v);
00106 return s;
00107 }
00108
00109 }
00110
00111 namespace ros
00112 {
00113 namespace message_traits
00114 {
00115
00116
00117
00118
00119
00120
00121
00122
00123
00124
00125
00126 template <class ContainerAllocator>
00127 struct IsFixedSize< ::pr2_controllers_msgs::PointHeadActionGoal_<ContainerAllocator> >
00128 : FalseType
00129 { };
00130
00131 template <class ContainerAllocator>
00132 struct IsFixedSize< ::pr2_controllers_msgs::PointHeadActionGoal_<ContainerAllocator> const>
00133 : FalseType
00134 { };
00135
00136 template <class ContainerAllocator>
00137 struct IsMessage< ::pr2_controllers_msgs::PointHeadActionGoal_<ContainerAllocator> >
00138 : TrueType
00139 { };
00140
00141 template <class ContainerAllocator>
00142 struct IsMessage< ::pr2_controllers_msgs::PointHeadActionGoal_<ContainerAllocator> const>
00143 : TrueType
00144 { };
00145
00146 template <class ContainerAllocator>
00147 struct HasHeader< ::pr2_controllers_msgs::PointHeadActionGoal_<ContainerAllocator> >
00148 : TrueType
00149 { };
00150
00151 template <class ContainerAllocator>
00152 struct HasHeader< ::pr2_controllers_msgs::PointHeadActionGoal_<ContainerAllocator> const>
00153 : TrueType
00154 { };
00155
00156
00157 template<class ContainerAllocator>
00158 struct MD5Sum< ::pr2_controllers_msgs::PointHeadActionGoal_<ContainerAllocator> >
00159 {
00160 static const char* value()
00161 {
00162 return "b53a8323d0ba7b310ba17a2d3a82a6b8";
00163 }
00164
00165 static const char* value(const ::pr2_controllers_msgs::PointHeadActionGoal_<ContainerAllocator>&) { return value(); }
00166 static const uint64_t static_value1 = 0xb53a8323d0ba7b31ULL;
00167 static const uint64_t static_value2 = 0x0ba17a2d3a82a6b8ULL;
00168 };
00169
00170 template<class ContainerAllocator>
00171 struct DataType< ::pr2_controllers_msgs::PointHeadActionGoal_<ContainerAllocator> >
00172 {
00173 static const char* value()
00174 {
00175 return "pr2_controllers_msgs/PointHeadActionGoal";
00176 }
00177
00178 static const char* value(const ::pr2_controllers_msgs::PointHeadActionGoal_<ContainerAllocator>&) { return value(); }
00179 };
00180
00181 template<class ContainerAllocator>
00182 struct Definition< ::pr2_controllers_msgs::PointHeadActionGoal_<ContainerAllocator> >
00183 {
00184 static const char* value()
00185 {
00186 return "# ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======\n\
00187 \n\
00188 Header header\n\
00189 actionlib_msgs/GoalID goal_id\n\
00190 PointHeadGoal goal\n\
00191 \n\
00192 ================================================================================\n\
00193 MSG: std_msgs/Header\n\
00194 # Standard metadata for higher-level stamped data types.\n\
00195 # This is generally used to communicate timestamped data \n\
00196 # in a particular coordinate frame.\n\
00197 # \n\
00198 # sequence ID: consecutively increasing ID \n\
00199 uint32 seq\n\
00200 #Two-integer timestamp that is expressed as:\n\
00201 # * stamp.secs: seconds (stamp_secs) since epoch\n\
00202 # * stamp.nsecs: nanoseconds since stamp_secs\n\
00203 # time-handling sugar is provided by the client library\n\
00204 time stamp\n\
00205 #Frame this data is associated with\n\
00206 # 0: no frame\n\
00207 # 1: global frame\n\
00208 string frame_id\n\
00209 \n\
00210 ================================================================================\n\
00211 MSG: actionlib_msgs/GoalID\n\
00212 # The stamp should store the time at which this goal was requested.\n\
00213 # It is used by an action server when it tries to preempt all\n\
00214 # goals that were requested before a certain time\n\
00215 time stamp\n\
00216 \n\
00217 # The id provides a way to associate feedback and\n\
00218 # result message with specific goal requests. The id\n\
00219 # specified must be unique.\n\
00220 string id\n\
00221 \n\
00222 \n\
00223 ================================================================================\n\
00224 MSG: pr2_controllers_msgs/PointHeadGoal\n\
00225 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======\n\
00226 geometry_msgs/PointStamped target\n\
00227 geometry_msgs/Vector3 pointing_axis\n\
00228 string pointing_frame\n\
00229 duration min_duration\n\
00230 float64 max_velocity\n\
00231 \n\
00232 ================================================================================\n\
00233 MSG: geometry_msgs/PointStamped\n\
00234 # This represents a Point with reference coordinate frame and timestamp\n\
00235 Header header\n\
00236 Point point\n\
00237 \n\
00238 ================================================================================\n\
00239 MSG: geometry_msgs/Point\n\
00240 # This contains the position of a point in free space\n\
00241 float64 x\n\
00242 float64 y\n\
00243 float64 z\n\
00244 \n\
00245 ================================================================================\n\
00246 MSG: geometry_msgs/Vector3\n\
00247 # This represents a vector in free space. \n\
00248 \n\
00249 float64 x\n\
00250 float64 y\n\
00251 float64 z\n\
00252 ";
00253 }
00254
00255 static const char* value(const ::pr2_controllers_msgs::PointHeadActionGoal_<ContainerAllocator>&) { return value(); }
00256 };
00257
00258 }
00259 }
00260
00261 namespace ros
00262 {
00263 namespace serialization
00264 {
00265
00266 template<class ContainerAllocator> struct Serializer< ::pr2_controllers_msgs::PointHeadActionGoal_<ContainerAllocator> >
00267 {
00268 template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m)
00269 {
00270 stream.next(m.header);
00271 stream.next(m.goal_id);
00272 stream.next(m.goal);
00273 }
00274
00275 ROS_DECLARE_ALLINONE_SERIALIZER;
00276 };
00277
00278 }
00279 }
00280
00281 namespace ros
00282 {
00283 namespace message_operations
00284 {
00285
00286 template<class ContainerAllocator>
00287 struct Printer< ::pr2_controllers_msgs::PointHeadActionGoal_<ContainerAllocator> >
00288 {
00289 template<typename Stream> static void stream(Stream& s, const std::string& indent, const ::pr2_controllers_msgs::PointHeadActionGoal_<ContainerAllocator>& v)
00290 {
00291 s << indent << "header: ";
00292 s << std::endl;
00293 Printer< ::std_msgs::Header_<ContainerAllocator> >::stream(s, indent + " ", v.header);
00294 s << indent << "goal_id: ";
00295 s << std::endl;
00296 Printer< ::actionlib_msgs::GoalID_<ContainerAllocator> >::stream(s, indent + " ", v.goal_id);
00297 s << indent << "goal: ";
00298 s << std::endl;
00299 Printer< ::pr2_controllers_msgs::PointHeadGoal_<ContainerAllocator> >::stream(s, indent + " ", v.goal);
00300 }
00301 };
00302
00303 }
00304 }
00305
00306 #endif // PR2_CONTROLLERS_MSGS_MESSAGE_POINTHEADACTIONGOAL_H