8 setObjectName(
"Frame");
15 tool_ =
new Pose(QString::fromStdString(
"tool"));
19 QLabel* label(
new QLabel(
"Display must be updated to see tool orientation changes when axis" 20 " are displayed on the trajectory."));
21 label->setWordWrap(
true);
24 QVBoxLayout *scroll_widget_layout =
new QVBoxLayout();
25 QWidget *scroll_widget =
new QWidget;
26 scroll_widget->setLayout(scroll_widget_layout);
27 QScrollArea *scroll_area =
new QScrollArea;
28 scroll_area->setWidget(scroll_widget);
29 scroll_area->setWidgetResizable(
true);
30 scroll_area->setFrameShape(QFrame::NoFrame);
32 QVBoxLayout* main_layout =
new QVBoxLayout(
this);
33 main_layout->addWidget(scroll_area);
35 scroll_widget_layout->addStretch(1);
37 scroll_widget_layout->addStretch(1);
39 scroll_widget_layout->addWidget(label);
40 scroll_widget_layout->addStretch(2);
82 "Published message will be lost: ",
95 "Published message will be lost: ",
108 "Published message will be lost: ",
126 Q_EMIT setEnabled(
false);
137 "RViz panel " << objectName().toStdString() +
" did not connect to all the subscribers");
140 ROS_INFO_STREAM(
"RViz panel " << objectName().toStdString() <<
" subscribers connections have been made");
155 Q_EMIT setEnabled(
true);
167 const QString message,
168 const QString info_msg)
170 bool old_state(isEnabled());
171 Q_EMIT setEnabled(
false);
173 msg_box.setWindowTitle(title);
174 msg_box.setText(message);
175 msg_box.setInformativeText(info_msg);
176 msg_box.setIcon(QMessageBox::Critical);
177 msg_box.setStandardButtons(QMessageBox::Ok);
179 Q_EMIT setEnabled(old_state);
void save(rviz::Config config) const
void publish(const boost::shared_ptr< M > &message) const
void sendLoadedInformation()
void poseEigenToMsg(const Eigen::Affine3d &e, geometry_msgs::Pose &m)
void load(const rviz::Config &config)
ros::Publisher trajectory_frame_pub_
void updateInternalParameters()
void getPose(Eigen::Affine3d &pose)
void setTranslationEnabled(const bool)
virtual void setName(const QString &name)
geometry_msgs::Pose tool_pose_
void sendToolInformation()
Publisher advertise(const std::string &topic, uint32_t queue_size, bool latch=false)
geometry_msgs::Pose trajectory_frame_pose_
QVBoxLayout * getLayout()
#define ROS_WARN_STREAM_THROTTLE(rate, args)
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()
uint32_t getNumSubscribers() const
#define ROS_INFO_STREAM(args)
void load(const rviz::Config &)
virtual void save(Config config) const
void setText(const QString name)
std::string getTopic() const
virtual void load(const Config &config)
void sendTrajectoryFrameInformation()
ROSCPP_DECL void spinOnce()
Frames(QWidget *parent=NULL)
#define PLUGINLIB_EXPORT_CLASS(class_type, base_class_type)
void displayErrorMessageBox(const QString, const QString, const QString)