7 #include <QApplication>
8 #include <QProgressDialog>
9 #include "rclcpp/generic_subscription.hpp"
10 #include "rosbag2_transport/qos.hpp"
20 _context = std::make_shared<rclcpp::Context>();
23 auto exec_args = rclcpp::ExecutorOptions();
25 _executor = std::make_unique<rclcpp::executors::MultiThreadedExecutor>(exec_args, 2);
31 using namespace std::chrono;
32 milliseconds wait_time_ms(1000);
34 QProgressDialog progress_dialog;
35 progress_dialog.setLabelText(
"Collecting ROS topic samples to understand data layout.");
36 progress_dialog.setRange(0, wait_time_ms.count());
37 progress_dialog.setAutoClose(
true);
38 progress_dialog.setAutoReset(
true);
39 progress_dialog.show();
41 auto start_time = system_clock::now();
43 while (system_clock::now() - start_time < (wait_time_ms))
45 int msec = duration_cast<milliseconds>(system_clock::now() - start_time).count();
46 progress_dialog.setValue(msec);
47 QApplication::processEvents();
48 if (progress_dialog.wasCanceled())
54 if (progress_dialog.wasCanceled() ==
false)
56 progress_dialog.cancel();
64 auto node_opts = rclcpp::NodeOptions();
66 _node = std::make_shared<rclcpp::Node>(
"plotjuggler", node_opts);
71 std::lock_guard<std::mutex> lock(
mutex());
80 std::vector<std::pair<QString, QString>> dialog_topics;
83 QTimer update_list_timer;
84 update_list_timer.setSingleShot(
false);
85 update_list_timer.setInterval(1000);
86 update_list_timer.start();
88 auto getTopicsFromNode = [&]() {
89 dialog_topics.clear();
90 auto topic_list =
_node->get_topic_names_and_types();
91 for (
const auto&
topic : topic_list)
94 auto topic_name = QString::fromStdString(
topic.first);
96 dialog_topics.push_back({ topic_name,
type_name });
103 connect(&update_list_timer, &QTimer::timeout, getTopicsFromNode);
105 int res = dialog.exec();
107 update_list_timer.stop();
119 for (
const auto&
topic : dialog_topics)
137 _executor->spin_once(std::chrono::milliseconds(5));
175 static std::vector<QAction*> empty;
192 auto bound_callback = [=](std::shared_ptr<rclcpp::SerializedMessage>
msg) {
messageCallback(topic_name,
msg); };
194 auto publisher_info =
_node->get_publishers_info_by_topic(topic_name);
195 auto detected_qos = rosbag2_transport::Rosbag2QoS::adapt_request_to_offers(topic_name, publisher_info);
198 auto subscription =
_node->create_generic_subscription(topic_name,
203 _node->get_node_topics_interface()->add_subscription(subscription,
nullptr);
208 double timestamp =
_node->get_clock()->now().seconds();
211 std::unique_lock<std::mutex> lock(
mutex());
213 auto msg_ptr =
msg.get()->get_rcl_serialized_message();
218 catch (std::runtime_error& ex)
222 QMessageBox::warning(
nullptr, tr(
"Error"),
223 QString(
"rosbag::open thrown an exception:\n") +
224 QString(ex.what()) +
"\nThis message will be shown only once.");
250 QDomElement& parent_element)
const