geometryPosesCreatorGui.h
Go to the documentation of this file.
00001 #include <QDialog>
00002 #include <QString>
00003 #include <QStatusBar>
00004 #include "ui_geometryPosesCreatorGui.h"
00005 #include <string>
00006 #include <geometry_msgs/PoseStamped.h>
00007 #include <ros/ros.h>
00008 #include <tf/transform_listener.h>
00009 #include "hardcoded_facts/geometryPoses.h"
00010 #include <vector>
00011 
00012 class GeometryPosesCreatorGui : public QDialog, protected Ui::mainDia
00013 {
00014    Q_OBJECT
00015 
00016    public:
00017       GeometryPosesCreatorGui(const std::string & ff, const std::string & tf);
00018       ~GeometryPosesCreatorGui();
00019 
00020       void showMessage(QString msg);
00021 
00022    protected Q_SLOTS:
00023       void on_savePoseBtn_clicked();
00024       void on_writeFileBtn_clicked();
00025 
00026    protected:
00027       ros::NodeHandle nh;
00028       tf::TransformListener tf_listener;
00029 
00030       std::string fixed_frame;
00031       std::string target_frame;
00032 
00033       std::vector<GeometryPoses::NamedPose> poses;
00034 
00035       QStatusBar* _statusBar;
00036 };
00037 
 All Classes Namespaces Files Functions Variables Typedefs Enumerations Properties Friends


hardcoded_facts
Author(s): Christian Dornhege
autogenerated on Wed Dec 26 2012 15:46:04