Public Member Functions | List of all members
TestLazySubscriber< M > Class Template Reference
Inheritance diagram for TestLazySubscriber< M >:
Inheritance graph
[legend]

Public Member Functions

 TestLazySubscriber (ros::NodeHandle publisherNh, const std::string &publisherTopic, typename cras::ConditionalSubscriber::ConnectFn connectFn, typename cras::ConditionalSubscriber::DisconnectFn disconnectFn=[](ros::Subscriber &sub) { sub.shutdown();}, const cras::LogHelperPtr &logHelper=std::make_shared< cras::NodeLogHelper >())
 
- Public Member Functions inherited from cras::LazySubscriberBase< M >
 LazySubscriberBase (::ros::NodeHandle publisherNh, const ::std::string &publisherTopic, typename ::cras::ConditionalSubscriber::ConnectFn connectFn, const ::cras::LogHelperPtr &logHelper=::std::make_shared<::cras::NodeLogHelper >())
 Create the lazy subscriber that subscribes only when publisherTopic has subscribers. More...
 
 LazySubscriberBase (::ros::NodeHandle publisherNh, const ::std::string &publisherTopic, typename ::cras::ConditionalSubscriber::ConnectFn connectFn, typename ::cras::ConditionalSubscriber::DisconnectFn disconnectFn, const ::cras::LogHelperPtr &logHelper=::std::make_shared<::cras::NodeLogHelper >())
 Create the lazy subscriber that subscribes only when publisherTopic has subscribers. More...
 
- Public Member Functions inherited from cras::ConditionalSubscriber
 ConditionalSubscriber (ConnectFn connectFn, const ::cras::LogHelperPtr &logHelper=::std::make_shared<::cras::NodeLogHelper >())
 Create the conditional subscriber. More...
 
 ConditionalSubscriber (ConnectFn connectFn, DisconnectFn disconnectFn, const ::cras::LogHelperPtr &logHelper=::std::make_shared<::cras::NodeLogHelper >())
 Create the conditional subscriber. More...
 
bool isLazy () const
 Tell whether this subscriber has the lazy behavior enabled. More...
 
bool isSubscribed () const
 Whether the subscriber is currently subscribed to its topic or not. More...
 
void setLazy (bool lazy)
 Set whether the subscriber behaves in the lazy way. More...
 
virtual ~ConditionalSubscriber ()
 Destroy this object and unsubscribe the subscriber if it was subscribed. More...
 
- Public Member Functions inherited from cras::HasLogger
::cras::LogHelperConstPtr getCrasLogger () const
 
 HasLogger (const ::cras::LogHelperPtr &log)
 
void setCrasLogger (const ::cras::LogHelperPtr &log)
 

Additional Inherited Members

- Public Types inherited from cras::ConditionalSubscriber
typedef ::std::function< void(::ros::Subscriber &sub)> ConnectFn
 Type of the function that connects the subscriber. More...
 
typedef ::std::function< void(::ros::Subscriber &sub)> DisconnectFn
 Type of the function that disconnects the subscriber. More...
 
- Protected Member Functions inherited from cras::LazySubscriberBase< M >
void connectCb (const ::ros::SingleSubscriberPublisher &)
 The callback called when a new subscriber appears or disappears. More...
 
bool shouldBeSubscribed () const override
 Tell whether the subscriber should be subscribed or not. More...
 
- Protected Member Functions inherited from cras::ConditionalSubscriber
void connectNoLock ()
 Connect the subscriber to its input. More...
 
void disconnectNoLock ()
 Disconnect the subscriber from its input. More...
 
virtual bool shouldBeSubscribed () const =0
 Tell whether the subscriber should be subscribed or not. More...
 
void updateSubscription ()
 The callback called when the condition might have changed. More...
 
void updateSubscriptionNoLock ()
 The callback called when the condition might have changed. More...
 
- Protected Attributes inherited from cras::LazySubscriberBase< M >
::ros::Publisher pub
 The publisher whose number of subscribers decides whether to connect or not. It is not used to publish any actual messages. More...
 
- Protected Attributes inherited from cras::ConditionalSubscriber
ConnectFn connectFn
 The function used to establish connection. More...
 
mutable ::std::mutex connectMutex
 Mutex protecting sub and subscribed. More...
 
DisconnectFn disconnectFn
 The function used to close connection. More...
 
bool lazy {true}
 Whether the lazy behavior is enabled (if false, the subscriber is always subscribed). More...
 
::ros::Subscriber sub
 The underlying subscriber (valid only when subscribed is true). More...
 
bool subscribed {false}
 Whether the subscriber is currently subscribed to its topic or not. More...
 
- Protected Attributes inherited from cras::HasLogger
::cras::LogHelperPtr log
 

Detailed Description

template<typename M>
class TestLazySubscriber< M >

Definition at line 58 of file test_lazy_subscriber.cpp.

Constructor & Destructor Documentation

◆ TestLazySubscriber()

template<typename M >
TestLazySubscriber< M >::TestLazySubscriber ( ros::NodeHandle  publisherNh,
const std::string &  publisherTopic,
typename cras::ConditionalSubscriber::ConnectFn  connectFn,
typename cras::ConditionalSubscriber::DisconnectFn  disconnectFn = [](ros::Subscribersub) { sub.shutdown(); },
const cras::LogHelperPtr logHelper = std::make_shared<cras::NodeLogHelper>() 
)
inline

Definition at line 61 of file test_lazy_subscriber.cpp.


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


cras_topic_tools
Author(s): Martin Pecka
autogenerated on Sun Mar 2 2025 03:51:09