TKStateToStampedPose.hpp
Go to the documentation of this file.
00001 /*
00002  * TKStateToStampedPose.hpp
00003  *
00004  *  Created on: Feb 15, 2012
00005  *      Author: mriedel
00006  */
00007 
00008 #ifndef TKSTATETOSTAMPEDPOSE_HPP_
00009 #define TKSTATETOSTAMPEDPOSE_HPP_
00010 
00011 #include <telekyb_base/TeleKyb.hpp>
00012 #include <telekyb_base/Options.hpp>
00013 
00014 #include <geometry_msgs/PoseStamped.h>
00015 #include <telekyb_msgs/TKState.h>
00016 
00017 using namespace telekyb;
00018 
00019 class TKStateToStampedPoseOptions : public OptionContainer
00020 {
00021 public:
00022         Option<std::string>* tInputState;
00023         Option<std::string>* tOutputPose;
00024         TKStateToStampedPoseOptions();
00025 };
00026 
00027 class TKStateToStampedPose {
00028 private:
00029         TKStateToStampedPoseOptions options;
00030 
00031         ros::NodeHandle n;
00032         ros::Subscriber stateSub;
00033         ros::Publisher posePub;
00034 
00035         void tkStateCB(const telekyb_msgs::TKState::ConstPtr& msg);
00036 
00037 public:
00038         TKStateToStampedPose();
00039         virtual ~TKStateToStampedPose();
00040 };
00041 
00042 #endif /* TKSTATETOSTAMPEDPOSE_HPP_ */
 All Classes Namespaces Files Functions Variables Typedefs Enumerations Friends


tk_conversion
Author(s): Martin Riedel
autogenerated on Mon Nov 11 2013 11:14:33