Public Member Functions | Private Member Functions | Private Attributes | List of all members
ros1_ros_cpptemplate::Nodelet Class Reference
Inheritance diagram for ros1_ros_cpptemplate::Nodelet:
Inheritance graph
[legend]

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::CallbackQueueInterfacegetMTCallbackQueue () const
 
ros::NodeHandlegetMTNodeHandle () const
 
ros::NodeHandlegetMTPrivateNodeHandle () const
 
const V_stringgetMyArgv () const
 
const std::string & getName () const
 
ros::NodeHandlegetNodeHandle () const
 
ros::NodeHandlegetPrivateNodeHandle () const
 
const M_stringgetRemappingArgs () const
 
ros::CallbackQueueInterfacegetSTCallbackQueue () const
 
std::string getSuffixedName (const std::string &suffix) const
 

Detailed Description

Definition at line 25 of file nodelet.cpp.

Constructor & Destructor Documentation

ros1_ros_cpptemplate::Nodelet::Nodelet ( )
inline

Definition at line 28 of file nodelet.cpp.

ros1_ros_cpptemplate::Nodelet::~Nodelet ( )
inlinevirtual

Reimplemented from nodelet::Nodelet.

Definition at line 35 of file nodelet.cpp.

Member Function Documentation

virtual void ros1_ros_cpptemplate::Nodelet::onInit ( )
inlinevirtual

Implements nodelet::Nodelet.

Definition at line 46 of file nodelet.cpp.

void ros1_ros_cpptemplate::Nodelet::reconfigureCB ( ros1_template_msgs::FibonacciConfig &  config,
uint32_t  level 
)
inlineprivate

Definition at line 104 of file nodelet.cpp.

void ros1_ros_cpptemplate::Nodelet::run ( double  publish_rate,
PublisherPtr  publisher 
)
inlineprivate

Definition at line 94 of file nodelet.cpp.

Member Data Documentation

AtomicFibonacciPtr ros1_ros_cpptemplate::Nodelet::atomic_fibonacci_
private

Definition at line 115 of file nodelet.cpp.

ros::NodeHandle ros1_ros_cpptemplate::Nodelet::private_node_handle_
private

Definition at line 111 of file nodelet.cpp.

std::vector<std::thread> ros1_ros_cpptemplate::Nodelet::publish_threads_
private

Definition at line 118 of file nodelet.cpp.

PublisherPtr ros1_ros_cpptemplate::Nodelet::publisher_other_
private

Definition at line 117 of file nodelet.cpp.

PublisherPtr ros1_ros_cpptemplate::Nodelet::publisher_used_interally_
private

Definition at line 116 of file nodelet.cpp.

std::shared_ptr<dynamic_reconfigure::Server<ros1_template_msgs::FibonacciConfig> > ros1_ros_cpptemplate::Nodelet::reconfigure_server_
private

Definition at line 113 of file nodelet.cpp.

ServicePtr ros1_ros_cpptemplate::Nodelet::service_
private

Definition at line 121 of file nodelet.cpp.

std::atomic<bool> ros1_ros_cpptemplate::Nodelet::shutdown_requested_
private

Definition at line 110 of file nodelet.cpp.

SubscriberPtr ros1_ros_cpptemplate::Nodelet::subscriber_
private

Definition at line 120 of file nodelet.cpp.


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


ros1_ros_cpptemplate
Author(s): Alexander Reimann
autogenerated on Sat Sep 2 2017 02:38:06