#include "sick_scan/sick_scan_base.h"
#include "common.h"
#include "node_handle.h"
#include <memory>
Go to the source code of this file.
|
| template<class M > |
| std::shared_ptr< M const > | roswrap::topic::waitForMessage (const std::string &topic) |
| | Wait for a single message to arrive on a topic. More...
|
| |
| template<class M > |
| std::shared_ptr< M const > | roswrap::topic::waitForMessage (const std::string &topic, NodeHandle &nh, ros::Duration timeout) |
| | Wait for a single message to arrive on a topic, with timeout. More...
|
| |
| template<class M > |
| std::shared_ptr< M const > | roswrap::topic::waitForMessage (const std::string &topic, ros::Duration timeout) |
| | Wait for a single message to arrive on a topic, with timeout. More...
|
| |
| template<class M > |
| std::shared_ptr< M const > | roswrap::topic::waitForMessage (const std::string &topic, ros::NodeHandle &nh) |
| | Wait for a single message to arrive on a topic. More...
|
| |
| ROSCPP_DECL void | roswrap::topic::waitForMessageImpl (SubscribeOptions &ops, const std::function< bool(void)> &ready_pred, NodeHandle &nh, ros::Duration timeout) |
| | Internal method, do not use. More...
|
| |
◆ ROSCPP_TOPIC_H