Collection of objects used in ROS CallbackQueue threading. More...
#include <executor.h>
Public Member Functions | |
| void | addCallback (LocomotorCallback::Function f) |
| Add a callback to this executor's CallbackQueue. More... | |
| Executor (const ros::NodeHandle &base_nh, bool create_cb_queue=true) | |
| Constructor. Creates new CallbackQueue or uses global CallbackQueue. More... | |
| virtual const ros::NodeHandle & | getNodeHandle () const |
| Gets NodeHandle coupled with this executor's CallbackQueue. More... | |
| virtual | ~Executor () |
Protected Member Functions | |
| virtual ros::CallbackQueue & | getQueue () |
| Gets the queue for this executor. More... | |
Protected Attributes | |
| ros::NodeHandle | ex_nh_ |
| std::shared_ptr< ros::CallbackQueue > | queue_ |
| std::shared_ptr< ros::AsyncSpinner > | spinner_ |
Collection of objects used in ROS CallbackQueue threading.
This light wrapper around the contained classes allows for intelligent cleanup of the objects
Definition at line 72 of file executor.h.
|
explicit |
Constructor. Creates new CallbackQueue or uses global CallbackQueue.
| base_nh | Base NodeHandle that this executor's NodeHandle will be derived from |
| create_cb_queue | If true, creates a new CallbackQueue. If false, uses global CallbackQueue |
Definition at line 40 of file executor.cpp.
|
inlinevirtual |
Definition at line 82 of file executor.h.
| void locomotor::Executor::addCallback | ( | LocomotorCallback::Function | f | ) |
Add a callback to this executor's CallbackQueue.
| f | LocomotorCallback |
Definition at line 65 of file executor.cpp.
|
virtual |
Gets NodeHandle coupled with this executor's CallbackQueue.
Definition at line 60 of file executor.cpp.
|
protectedvirtual |
Gets the queue for this executor.
Definition at line 70 of file executor.cpp.
|
protected |
Definition at line 102 of file executor.h.
|
protected |
Definition at line 100 of file executor.h.
|
protected |
Definition at line 101 of file executor.h.