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

Public Member Functions

 Plus ()
 
- 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 ()
 
virtual ~Nodelet ()
 

Private Member Functions

void callback (const std_msgs::Float64::ConstPtr &input)
 
virtual void onInit ()
 

Private Attributes

ros::Publisher pub
 
ros::Subscriber sub
 
double value_
 

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 42 of file plus.cpp.

Constructor & Destructor Documentation

test_nodelet::Plus::Plus ( )
inline

Definition at line 45 of file plus.cpp.

Member Function Documentation

void test_nodelet::Plus::callback ( const std_msgs::Float64::ConstPtr &  input)
inlineprivate

Definition at line 58 of file plus.cpp.

virtual void test_nodelet::Plus::onInit ( )
inlineprivatevirtual

Implements nodelet::Nodelet.

Definition at line 50 of file plus.cpp.

Member Data Documentation

ros::Publisher test_nodelet::Plus::pub
private

Definition at line 66 of file plus.cpp.

ros::Subscriber test_nodelet::Plus::sub
private

Definition at line 67 of file plus.cpp.

double test_nodelet::Plus::value_
private

Definition at line 68 of file plus.cpp.


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


test_nodelet
Author(s): Tully Foote
autogenerated on Sat Jul 18 2020 03:17:57