44 queue_ = std::make_shared<ros::CallbackQueue>();
47 spinner_ = std::make_shared<ros::AsyncSpinner>(1, raw_queue_ptr);
virtual void addCallback(const CallbackInterfacePtr &callback, uint64_t removal_id=0)
virtual ros::CallbackQueue & getQueue()
Gets the queue for this executor.
ROSCPP_DECL CallbackQueue * getGlobalCallbackQueue()
std::shared_ptr< ros::AsyncSpinner > spinner_
void setCallbackQueue(CallbackQueueInterface *queue)
std::function< void()> Function
Executor(const ros::NodeHandle &base_nh, bool create_cb_queue=true)
Constructor. Creates new CallbackQueue or uses global CallbackQueue.
std::shared_ptr< ros::CallbackQueue > queue_
void addCallback(LocomotorCallback::Function f)
Add a callback to this executor's CallbackQueue.
virtual const ros::NodeHandle & getNodeHandle() const
Gets NodeHandle coupled with this executor's CallbackQueue.