Signals | Public Member Functions | Public Attributes | Protected Attributes | Private Slots | Private Member Functions | Private Attributes | List of all members
topics_rviz_plugin::TopicInfo Class Reference

#include <topic_info.hpp>

Inheritance diagram for topics_rviz_plugin::TopicInfo:
Inheritance graph
[legend]

Signals

void adjustLCDNumberOfDigits (const long unsigned number)
 

Public Member Functions

ros::Duration maximumRefreshRate ()
 
void setMaximumRefreshRate (const ros::Duration d)
 
 TopicInfo (const std::string topic_name, const std::string topic_type, const ros::Duration refresh_duration=ros::Duration(0))
 
virtual ~TopicInfo ()
 

Public Attributes

std::shared_ptr< QWidget > display_
 
std::shared_ptr< QLabel > label_
 
const std::string topic_name_
 
const std::string topic_type_
 

Protected Attributes

ros::NodeHandle nh_
 
ros::Subscriber sub_
 

Private Slots

void adjustLCDNumberOfDigitsHandler (const long unsigned number)
 

Private Member Functions

void boolCallback (const std_msgs::BoolConstPtr &msg)
 
void durationCallback (const std_msgs::DurationConstPtr &msg)
 
void float32Callback (const std_msgs::Float32ConstPtr &msg)
 
void float64Callback (const std_msgs::Float64ConstPtr &msg)
 
void int16Callback (const std_msgs::Int16ConstPtr &msg)
 
void int32Callback (const std_msgs::Int32ConstPtr &msg)
 
void int64Callback (const std_msgs::Int64ConstPtr &msg)
 
void int8Callback (const std_msgs::Int8ConstPtr &msg)
 
bool refresh ()
 
void stringCallback (const std_msgs::StringConstPtr &msg)
 
void timeCallback (const std_msgs::TimeConstPtr &msg)
 
void uint16Callback (const std_msgs::UInt16ConstPtr &msg)
 
void uint32Callback (const std_msgs::UInt32ConstPtr &msg)
 
void uint64Callback (const std_msgs::UInt64ConstPtr &msg)
 
void uint8Callback (const std_msgs::UInt8ConstPtr &msg)
 

Private Attributes

ros::Time last_ = ros::Time::now()
 
ros::Duration refresh_duration_
 

Detailed Description

Definition at line 26 of file topic_info.hpp.

Constructor & Destructor Documentation

◆ TopicInfo()

topics_rviz_plugin::TopicInfo::TopicInfo ( const std::string  topic_name,
const std::string  topic_type,
const ros::Duration  refresh_duration = ros::Duration(0) 
)

Definition at line 6 of file topic_info.cpp.

◆ ~TopicInfo()

topics_rviz_plugin::TopicInfo::~TopicInfo ( )
virtual

Definition at line 84 of file topic_info.cpp.

Member Function Documentation

◆ adjustLCDNumberOfDigits

void topics_rviz_plugin::TopicInfo::adjustLCDNumberOfDigits ( const long unsigned  number)
signal

◆ adjustLCDNumberOfDigitsHandler

void topics_rviz_plugin::TopicInfo::adjustLCDNumberOfDigitsHandler ( const long unsigned  number)
privateslot

Definition at line 120 of file topic_info.cpp.

◆ boolCallback()

void topics_rviz_plugin::TopicInfo::boolCallback ( const std_msgs::BoolConstPtr &  msg)
private

Definition at line 139 of file topic_info.cpp.

◆ durationCallback()

void topics_rviz_plugin::TopicInfo::durationCallback ( const std_msgs::DurationConstPtr &  msg)
private

Definition at line 152 of file topic_info.cpp.

◆ float32Callback()

void topics_rviz_plugin::TopicInfo::float32Callback ( const std_msgs::Float32ConstPtr &  msg)
private

Definition at line 164 of file topic_info.cpp.

◆ float64Callback()

void topics_rviz_plugin::TopicInfo::float64Callback ( const std_msgs::Float64ConstPtr &  msg)
private

Definition at line 175 of file topic_info.cpp.

◆ int16Callback()

void topics_rviz_plugin::TopicInfo::int16Callback ( const std_msgs::Int16ConstPtr &  msg)
private

Definition at line 197 of file topic_info.cpp.

◆ int32Callback()

void topics_rviz_plugin::TopicInfo::int32Callback ( const std_msgs::Int32ConstPtr &  msg)
private

Definition at line 208 of file topic_info.cpp.

◆ int64Callback()

void topics_rviz_plugin::TopicInfo::int64Callback ( const std_msgs::Int64ConstPtr &  msg)
private

Definition at line 219 of file topic_info.cpp.

◆ int8Callback()

void topics_rviz_plugin::TopicInfo::int8Callback ( const std_msgs::Int8ConstPtr &  msg)
private

Definition at line 186 of file topic_info.cpp.

◆ maximumRefreshRate()

ros::Duration topics_rviz_plugin::TopicInfo::maximumRefreshRate ( )

Definition at line 97 of file topic_info.cpp.

◆ refresh()

bool topics_rviz_plugin::TopicInfo::refresh ( )
private

Definition at line 103 of file topic_info.cpp.

◆ setMaximumRefreshRate()

void topics_rviz_plugin::TopicInfo::setMaximumRefreshRate ( const ros::Duration  d)

Definition at line 90 of file topic_info.cpp.

◆ stringCallback()

void topics_rviz_plugin::TopicInfo::stringCallback ( const std_msgs::StringConstPtr &  msg)
private

Definition at line 231 of file topic_info.cpp.

◆ timeCallback()

void topics_rviz_plugin::TopicInfo::timeCallback ( const std_msgs::TimeConstPtr &  msg)
private

Definition at line 240 of file topic_info.cpp.

◆ uint16Callback()

void topics_rviz_plugin::TopicInfo::uint16Callback ( const std_msgs::UInt16ConstPtr &  msg)
private

Definition at line 261 of file topic_info.cpp.

◆ uint32Callback()

void topics_rviz_plugin::TopicInfo::uint32Callback ( const std_msgs::UInt32ConstPtr &  msg)
private

Definition at line 271 of file topic_info.cpp.

◆ uint64Callback()

void topics_rviz_plugin::TopicInfo::uint64Callback ( const std_msgs::UInt64ConstPtr &  msg)
private

Definition at line 282 of file topic_info.cpp.

◆ uint8Callback()

void topics_rviz_plugin::TopicInfo::uint8Callback ( const std_msgs::UInt8ConstPtr &  msg)
private

Definition at line 251 of file topic_info.cpp.

Member Data Documentation

◆ display_

std::shared_ptr<QWidget> topics_rviz_plugin::TopicInfo::display_

Definition at line 43 of file topic_info.hpp.

◆ label_

std::shared_ptr<QLabel> topics_rviz_plugin::TopicInfo::label_

Definition at line 42 of file topic_info.hpp.

◆ last_

ros::Time topics_rviz_plugin::TopicInfo::last_ = ros::Time::now()
private

Definition at line 56 of file topic_info.hpp.

◆ nh_

ros::NodeHandle topics_rviz_plugin::TopicInfo::nh_
protected

Definition at line 49 of file topic_info.hpp.

◆ refresh_duration_

ros::Duration topics_rviz_plugin::TopicInfo::refresh_duration_
private

Definition at line 57 of file topic_info.hpp.

◆ sub_

ros::Subscriber topics_rviz_plugin::TopicInfo::sub_
protected

Definition at line 50 of file topic_info.hpp.

◆ topic_name_

const std::string topics_rviz_plugin::TopicInfo::topic_name_

Definition at line 40 of file topic_info.hpp.

◆ topic_type_

const std::string topics_rviz_plugin::TopicInfo::topic_type_

Definition at line 41 of file topic_info.hpp.


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


topics_rviz_plugin
Author(s): Victor Lamoine - Institut Maupertuis
autogenerated on Mon Feb 28 2022 23:53:11