Public Slots | Public Member Functions | Private Member Functions | Private Attributes | List of all members
TopicPublisherROS2 Class Reference

#include <publisher_ros2.h>

Inheritance diagram for TopicPublisherROS2:
Inheritance graph
[legend]

Public Slots

void filterDialog ()
 
void setEnabled (bool enabled) override
 
- Public Slots inherited from PJ::StatePublisher
virtual void setEnabled (bool enabled)=0
 

Public Member Functions

const std::vector< QAction * > & availableActions () override
 
bool enabled () const override
 
const char * name () const override
 
void play (double interval) override
 
 TopicPublisherROS2 ()
 
void updateState (double current_time) override
 
virtual ~TopicPublisherROS2 () override
 
- Public Member Functions inherited from PJ::StatePublisher
void setDataMap (const PlotDataMapRef *datamap)
 
virtual ~StatePublisher ()=default
 
- Public Member Functions inherited from PJ::PlotJugglerPlugin
virtual bool isDebugPlugin ()
 
virtual QWidget * optionsWidget ()
 
 PlotJugglerPlugin ()=default
 
virtual bool xmlLoadState (const QDomElement &parent_element)
 
QDomElement xmlSaveState (QDomDocument &doc) const
 
virtual bool xmlSaveState (QDomDocument &doc, QDomElement &parent_element) const
 

Private Member Functions

void broadcastTF (double current_time)
 
void updatePublishers ()
 

Private Attributes

std::vector< QAction * > _available_actions
 
std::shared_ptr< rclcpp::Context > _context
 
bool _enabled
 
std::unique_ptr< rclcpp::executors::MultiThreadedExecutor > _executor
 
std::shared_ptr< rclcpp::Node_node
 
int _previous_play_index
 
std::unordered_map< std::string, std::shared_ptr< GenericPublisher > > _publishers
 
QAction * _select_topics_to_publish
 
std::shared_ptr< tf2_ros::TransformBroadcaster_tf_broadcaster
 
std::shared_ptr< tf2_ros::StaticTransformBroadcaster_tf_static_broadcaster
 
std::vector< TopicInfo_topics_info
 
std::unordered_map< std::string, bool > _topics_to_publish
 
double previous_time
 

Additional Inherited Members

- Signals inherited from PJ::StatePublisher
void closed ()
 
- Protected Attributes inherited from PJ::StatePublisher
const PlotDataMapRef_datamap
 

Detailed Description

Definition at line 24 of file publisher_ros2.h.

Constructor & Destructor Documentation

◆ TopicPublisherROS2()

TopicPublisherROS2::TopicPublisherROS2 ( )

Definition at line 23 of file publisher_ros2.cpp.

◆ ~TopicPublisherROS2()

TopicPublisherROS2::~TopicPublisherROS2 ( )
overridevirtual

Definition at line 39 of file publisher_ros2.cpp.

Member Function Documentation

◆ availableActions()

const std::vector< QAction * > & TopicPublisherROS2::availableActions ( )
overridevirtual

Reimplemented from PJ::PlotJugglerPlugin.

Definition at line 44 of file publisher_ros2.cpp.

◆ broadcastTF()

void TopicPublisherROS2::broadcastTF ( double  current_time)
private

Definition at line 200 of file publisher_ros2.cpp.

◆ enabled()

bool TopicPublisherROS2::enabled ( ) const
inlineoverridevirtual

Implements PJ::StatePublisher.

Definition at line 42 of file publisher_ros2.h.

◆ filterDialog

void TopicPublisherROS2::filterDialog ( )
slot

Definition at line 134 of file publisher_ros2.cpp.

◆ name()

const char* TopicPublisherROS2::name ( ) const
inlineoverridevirtual

Implements PJ::PlotJugglerPlugin.

Definition at line 37 of file publisher_ros2.h.

◆ play()

void TopicPublisherROS2::play ( double  interval)
overridevirtual

Implements PJ::StatePublisher.

Definition at line 351 of file publisher_ros2.cpp.

◆ setEnabled

void TopicPublisherROS2::setEnabled ( bool  enabled)
overrideslot

Definition at line 84 of file publisher_ros2.cpp.

◆ updatePublishers()

void TopicPublisherROS2::updatePublishers ( )
private

Definition at line 49 of file publisher_ros2.cpp.

◆ updateState()

void TopicPublisherROS2::updateState ( double  current_time)
overridevirtual

Implements PJ::StatePublisher.

Definition at line 301 of file publisher_ros2.cpp.

Member Data Documentation

◆ _available_actions

std::vector<QAction*> TopicPublisherROS2::_available_actions
private

Definition at line 80 of file publisher_ros2.h.

◆ _context

std::shared_ptr<rclcpp::Context> TopicPublisherROS2::_context
private

Definition at line 59 of file publisher_ros2.h.

◆ _enabled

bool TopicPublisherROS2::_enabled
private

Definition at line 63 of file publisher_ros2.h.

◆ _executor

std::unique_ptr<rclcpp::executors::MultiThreadedExecutor> TopicPublisherROS2::_executor
private

Definition at line 60 of file publisher_ros2.h.

◆ _node

std::shared_ptr<rclcpp::Node> TopicPublisherROS2::_node
private

Definition at line 61 of file publisher_ros2.h.

◆ _previous_play_index

int TopicPublisherROS2::_previous_play_index
private

Definition at line 76 of file publisher_ros2.h.

◆ _publishers

std::unordered_map<std::string, std::shared_ptr<GenericPublisher> > TopicPublisherROS2::_publishers
private

Definition at line 68 of file publisher_ros2.h.

◆ _select_topics_to_publish

QAction* TopicPublisherROS2::_select_topics_to_publish
private

Definition at line 70 of file publisher_ros2.h.

◆ _tf_broadcaster

std::shared_ptr<tf2_ros::TransformBroadcaster> TopicPublisherROS2::_tf_broadcaster
private

Definition at line 65 of file publisher_ros2.h.

◆ _tf_static_broadcaster

std::shared_ptr<tf2_ros::StaticTransformBroadcaster> TopicPublisherROS2::_tf_static_broadcaster
private

Definition at line 66 of file publisher_ros2.h.

◆ _topics_info

std::vector<TopicInfo> TopicPublisherROS2::_topics_info
private

Definition at line 78 of file publisher_ros2.h.

◆ _topics_to_publish

std::unordered_map<std::string, bool> TopicPublisherROS2::_topics_to_publish
private

Definition at line 72 of file publisher_ros2.h.

◆ previous_time

double TopicPublisherROS2::previous_time
private

Definition at line 74 of file publisher_ros2.h.


The documentation for this class was generated from the following files:


plotjuggler_ros
Author(s): Davide Faconti
autogenerated on Wed Feb 21 2024 03:22:56