Public Member Functions | |
Nodelet () | |
virtual void | onInit () |
~Nodelet () | |
Public Member Functions inherited from nodelet::Nodelet | |
void | init (const std::string &name, const M_string &remapping_args, const V_string &my_argv, ros::CallbackQueueInterface *st_queue=NULL, ros::CallbackQueueInterface *mt_queue=NULL) |
Nodelet () | |
Private Member Functions | |
void | reconfigureCB (ros1_template_msgs::FibonacciConfig &config, uint32_t level) |
void | run (double publish_rate, PublisherPtr publisher) |
Private Attributes | |
AtomicFibonacciPtr | atomic_fibonacci_ |
ros::NodeHandle | private_node_handle_ |
std::vector< std::thread > | publish_threads_ |
PublisherPtr | publisher_other_ |
PublisherPtr | publisher_used_interally_ |
std::shared_ptr< dynamic_reconfigure::Server< ros1_template_msgs::FibonacciConfig > > | reconfigure_server_ |
ServicePtr | service_ |
std::atomic< bool > | shutdown_requested_ |
SubscriberPtr | subscriber_ |
Additional Inherited Members | |
Protected Member Functions inherited from nodelet::Nodelet | |
ros::CallbackQueueInterface & | getMTCallbackQueue () const |
ros::NodeHandle & | getMTNodeHandle () const |
ros::NodeHandle & | getMTPrivateNodeHandle () const |
const V_string & | getMyArgv () const |
const std::string & | getName () const |
ros::NodeHandle & | getNodeHandle () const |
ros::NodeHandle & | getPrivateNodeHandle () const |
const M_string & | getRemappingArgs () const |
ros::CallbackQueueInterface & | getSTCallbackQueue () const |
std::string | getSuffixedName (const std::string &suffix) const |
Definition at line 25 of file nodelet.cpp.
|
inline |
Definition at line 28 of file nodelet.cpp.
|
inlinevirtual |
Reimplemented from nodelet::Nodelet.
Definition at line 35 of file nodelet.cpp.
|
inlinevirtual |
Implements nodelet::Nodelet.
Definition at line 46 of file nodelet.cpp.
|
inlineprivate |
Definition at line 104 of file nodelet.cpp.
|
inlineprivate |
Definition at line 94 of file nodelet.cpp.
|
private |
Definition at line 115 of file nodelet.cpp.
|
private |
Definition at line 111 of file nodelet.cpp.
|
private |
Definition at line 118 of file nodelet.cpp.
|
private |
Definition at line 117 of file nodelet.cpp.
|
private |
Definition at line 116 of file nodelet.cpp.
|
private |
Definition at line 113 of file nodelet.cpp.
|
private |
Definition at line 121 of file nodelet.cpp.
|
private |
Definition at line 110 of file nodelet.cpp.
|
private |
Definition at line 120 of file nodelet.cpp.