Go to the documentation of this file. 1 #ifndef STATE_PUBLISHER_ROS2TOPIC_H
2 #define STATE_PUBLISHER_ROS2TOPIC_H
7 #include <unordered_set>
9 #include <rclcpp/rclcpp.hpp>
10 #include <rclcpp/publisher.hpp>
11 #include <rosbag2_storage/serialized_bag_message.hpp>
12 #include <rosbag2_storage/storage_options.hpp>
21 using MessageRefPtr = std::shared_ptr<rosbag2_storage::SerializedBagMessage>;
27 Q_PLUGIN_METADATA(IID
"facontidavide.PlotJuggler3.StatePublisher")
37 const char*
name()
const override
39 return "ROS2 Topic Re-Publisher";
49 void play(
double interval)
override;
60 std::unique_ptr<rclcpp::executors::MultiThreadedExecutor>
_executor;
61 std::shared_ptr<rclcpp::Node>
_node;
68 std::unordered_map<std::string, std::shared_ptr<GenericPublisher>>
_publishers;
87 #endif // STATE_PUBLISHER_ROS2TOPIC_H
void setEnabled(bool enabled) override
virtual ~TopicPublisherROS2() override
std::vector< QAction * > _available_actions
std::shared_ptr< rosbag2_storage::SerializedBagMessage > MessageRefPtr
std::shared_ptr< rclcpp::Node > _node
bool enabled() const override
void updateState(double current_time) override
const std::vector< QAction * > & availableActions() override
std::vector< TopicInfo > _topics_info
QAction * _select_topics_to_publish
const char * name() const override
void broadcastTF(double current_time)
std::shared_ptr< rclcpp::Context > _context
void play(double interval) override
std::shared_ptr< tf2_ros::StaticTransformBroadcaster > _tf_static_broadcaster
std::unordered_map< std::string, bool > _topics_to_publish
std::shared_ptr< tf2_ros::TransformBroadcaster > _tf_broadcaster
std::unique_ptr< rclcpp::executors::MultiThreadedExecutor > _executor
std::unordered_map< std::string, std::shared_ptr< GenericPublisher > > _publishers
plotjuggler_ros
Author(s): Davide Faconti
autogenerated on Sat May 24 2025 02:24:01