1 #ifndef RAM_QT_GUIS_TRAJECTORY_FRAMES_HPP 2 #define RAM_QT_GUIS_TRAJECTORY_FRAMES_HPP 12 #include <QDoubleSpinBox> 13 #include <QHBoxLayout> 14 #include <QScrollArea> 16 #include <QMessageBox> 17 #include <QPushButton> 18 #include <QtConcurrent/QtConcurrentRun> 48 const QString message,
49 const QString info_msg);
void save(rviz::Config config) const
void sendLoadedInformation()
void sendInformationButtonHandler()
void load(const rviz::Config &config)
ros::Publisher trajectory_frame_pub_
void updateInternalParameters()
geometry_msgs::Pose tool_pose_
void sendToolInformation()
geometry_msgs::Pose trajectory_frame_pose_
geometry_msgs::Pose start_pose_pose_
ros::Publisher start_pose_pub_
void displayErrorBoxHandler(const QString title, const QString message, const QString info_msg)
void sendStartPoseInformation()
void sendTrajectoryFrameInformation()
Frames(QWidget *parent=NULL)
void displayErrorMessageBox(const QString, const QString, const QString)