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_PR2GRIPPERCOMMANDACTIONRESULT_H
00039 #define PR2_CONTROLLERS_MSGS_MESSAGE_PR2GRIPPERCOMMANDACTIONRESULT_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/GoalStatus.h>
00053 #include <pr2_controllers_msgs/Pr2GripperCommandResult.h>
00054
00055 namespace pr2_controllers_msgs
00056 {
00057 template <class ContainerAllocator>
00058 struct Pr2GripperCommandActionResult_
00059 {
00060 typedef Pr2GripperCommandActionResult_<ContainerAllocator> Type;
00061
00062 Pr2GripperCommandActionResult_()
00063 : header()
00064 , status()
00065 , result() {
00066 }
00067 Pr2GripperCommandActionResult_(const ContainerAllocator& _alloc)
00068 : header(_alloc)
00069 , status(_alloc)
00070 , result(_alloc) {
00071 }
00072
00073
00074
00075 typedef ::std_msgs::Header_<ContainerAllocator> _header_type;
00076 _header_type header;
00077
00078 typedef ::actionlib_msgs::GoalStatus_<ContainerAllocator> _status_type;
00079 _status_type status;
00080
00081 typedef ::pr2_controllers_msgs::Pr2GripperCommandResult_<ContainerAllocator> _result_type;
00082 _result_type result;
00083
00084
00085
00086
00087 typedef boost::shared_ptr< ::pr2_controllers_msgs::Pr2GripperCommandActionResult_<ContainerAllocator> > Ptr;
00088 typedef boost::shared_ptr< ::pr2_controllers_msgs::Pr2GripperCommandActionResult_<ContainerAllocator> const> ConstPtr;
00089 boost::shared_ptr<std::map<std::string, std::string> > __connection_header;
00090
00091 };
00092
00093 typedef ::pr2_controllers_msgs::Pr2GripperCommandActionResult_<std::allocator<void> > Pr2GripperCommandActionResult;
00094
00095 typedef boost::shared_ptr< ::pr2_controllers_msgs::Pr2GripperCommandActionResult > Pr2GripperCommandActionResultPtr;
00096 typedef boost::shared_ptr< ::pr2_controllers_msgs::Pr2GripperCommandActionResult const> Pr2GripperCommandActionResultConstPtr;
00097
00098
00099
00100
00101
00102 template<typename ContainerAllocator>
00103 std::ostream& operator<<(std::ostream& s, const ::pr2_controllers_msgs::Pr2GripperCommandActionResult_<ContainerAllocator> & v)
00104 {
00105 ros::message_operations::Printer< ::pr2_controllers_msgs::Pr2GripperCommandActionResult_<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::Pr2GripperCommandActionResult_<ContainerAllocator> >
00128 : FalseType
00129 { };
00130
00131 template <class ContainerAllocator>
00132 struct IsFixedSize< ::pr2_controllers_msgs::Pr2GripperCommandActionResult_<ContainerAllocator> const>
00133 : FalseType
00134 { };
00135
00136 template <class ContainerAllocator>
00137 struct IsMessage< ::pr2_controllers_msgs::Pr2GripperCommandActionResult_<ContainerAllocator> >
00138 : TrueType
00139 { };
00140
00141 template <class ContainerAllocator>
00142 struct IsMessage< ::pr2_controllers_msgs::Pr2GripperCommandActionResult_<ContainerAllocator> const>
00143 : TrueType
00144 { };
00145
00146 template <class ContainerAllocator>
00147 struct HasHeader< ::pr2_controllers_msgs::Pr2GripperCommandActionResult_<ContainerAllocator> >
00148 : TrueType
00149 { };
00150
00151 template <class ContainerAllocator>
00152 struct HasHeader< ::pr2_controllers_msgs::Pr2GripperCommandActionResult_<ContainerAllocator> const>
00153 : TrueType
00154 { };
00155
00156
00157 template<class ContainerAllocator>
00158 struct MD5Sum< ::pr2_controllers_msgs::Pr2GripperCommandActionResult_<ContainerAllocator> >
00159 {
00160 static const char* value()
00161 {
00162 return "143702cb2df0f163c5283cedc5efc6b6";
00163 }
00164
00165 static const char* value(const ::pr2_controllers_msgs::Pr2GripperCommandActionResult_<ContainerAllocator>&) { return value(); }
00166 static const uint64_t static_value1 = 0x143702cb2df0f163ULL;
00167 static const uint64_t static_value2 = 0xc5283cedc5efc6b6ULL;
00168 };
00169
00170 template<class ContainerAllocator>
00171 struct DataType< ::pr2_controllers_msgs::Pr2GripperCommandActionResult_<ContainerAllocator> >
00172 {
00173 static const char* value()
00174 {
00175 return "pr2_controllers_msgs/Pr2GripperCommandActionResult";
00176 }
00177
00178 static const char* value(const ::pr2_controllers_msgs::Pr2GripperCommandActionResult_<ContainerAllocator>&) { return value(); }
00179 };
00180
00181 template<class ContainerAllocator>
00182 struct Definition< ::pr2_controllers_msgs::Pr2GripperCommandActionResult_<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/GoalStatus status\n\
00190 Pr2GripperCommandResult result\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/GoalStatus\n\
00212 GoalID goal_id\n\
00213 uint8 status\n\
00214 uint8 PENDING = 0 # The goal has yet to be processed by the action server\n\
00215 uint8 ACTIVE = 1 # The goal is currently being processed by the action server\n\
00216 uint8 PREEMPTED = 2 # The goal received a cancel request after it started executing\n\
00217 # and has since completed its execution (Terminal State)\n\
00218 uint8 SUCCEEDED = 3 # The goal was achieved successfully by the action server (Terminal State)\n\
00219 uint8 ABORTED = 4 # The goal was aborted during execution by the action server due\n\
00220 # to some failure (Terminal State)\n\
00221 uint8 REJECTED = 5 # The goal was rejected by the action server without being processed,\n\
00222 # because the goal was unattainable or invalid (Terminal State)\n\
00223 uint8 PREEMPTING = 6 # The goal received a cancel request after it started executing\n\
00224 # and has not yet completed execution\n\
00225 uint8 RECALLING = 7 # The goal received a cancel request before it started executing,\n\
00226 # but the action server has not yet confirmed that the goal is canceled\n\
00227 uint8 RECALLED = 8 # The goal received a cancel request before it started executing\n\
00228 # and was successfully cancelled (Terminal State)\n\
00229 uint8 LOST = 9 # An action client can determine that a goal is LOST. This should not be\n\
00230 # sent over the wire by an action server\n\
00231 \n\
00232 #Allow for the user to associate a string with GoalStatus for debugging\n\
00233 string text\n\
00234 \n\
00235 \n\
00236 ================================================================================\n\
00237 MSG: actionlib_msgs/GoalID\n\
00238 # The stamp should store the time at which this goal was requested.\n\
00239 # It is used by an action server when it tries to preempt all\n\
00240 # goals that were requested before a certain time\n\
00241 time stamp\n\
00242 \n\
00243 # The id provides a way to associate feedback and\n\
00244 # result message with specific goal requests. The id\n\
00245 # specified must be unique.\n\
00246 string id\n\
00247 \n\
00248 \n\
00249 ================================================================================\n\
00250 MSG: pr2_controllers_msgs/Pr2GripperCommandResult\n\
00251 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======\n\
00252 float64 position # The current gripper gap size (in meters)\n\
00253 float64 effort # The current effort exerted (in Newtons)\n\
00254 bool stalled # True iff the gripper is exerting max effort and not moving\n\
00255 bool reached_goal # True iff the gripper position has reached the commanded setpoint\n\
00256 \n\
00257 ";
00258 }
00259
00260 static const char* value(const ::pr2_controllers_msgs::Pr2GripperCommandActionResult_<ContainerAllocator>&) { return value(); }
00261 };
00262
00263 }
00264 }
00265
00266 namespace ros
00267 {
00268 namespace serialization
00269 {
00270
00271 template<class ContainerAllocator> struct Serializer< ::pr2_controllers_msgs::Pr2GripperCommandActionResult_<ContainerAllocator> >
00272 {
00273 template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m)
00274 {
00275 stream.next(m.header);
00276 stream.next(m.status);
00277 stream.next(m.result);
00278 }
00279
00280 ROS_DECLARE_ALLINONE_SERIALIZER;
00281 };
00282
00283 }
00284 }
00285
00286 namespace ros
00287 {
00288 namespace message_operations
00289 {
00290
00291 template<class ContainerAllocator>
00292 struct Printer< ::pr2_controllers_msgs::Pr2GripperCommandActionResult_<ContainerAllocator> >
00293 {
00294 template<typename Stream> static void stream(Stream& s, const std::string& indent, const ::pr2_controllers_msgs::Pr2GripperCommandActionResult_<ContainerAllocator>& v)
00295 {
00296 s << indent << "header: ";
00297 s << std::endl;
00298 Printer< ::std_msgs::Header_<ContainerAllocator> >::stream(s, indent + " ", v.header);
00299 s << indent << "status: ";
00300 s << std::endl;
00301 Printer< ::actionlib_msgs::GoalStatus_<ContainerAllocator> >::stream(s, indent + " ", v.status);
00302 s << indent << "result: ";
00303 s << std::endl;
00304 Printer< ::pr2_controllers_msgs::Pr2GripperCommandResult_<ContainerAllocator> >::stream(s, indent + " ", v.result);
00305 }
00306 };
00307
00308 }
00309 }
00310
00311 #endif // PR2_CONTROLLERS_MSGS_MESSAGE_PR2GRIPPERCOMMANDACTIONRESULT_H