|
| KinesisManagerStatus | Initialize () |
| |
| KinesisManagerStatus | InitializeStreamSubscriptions () |
| |
| void | set_subscription_installer (std::shared_ptr< RosStreamSubscriptionInstaller > subscription_installer) |
| |
| void | Spin () |
| |
| | StreamerNode (const std::string &ns) |
| |
| | ~StreamerNode ()=default |
| |
Public Member Functions inherited from ros::NodeHandle |
| Publisher | advertise (const std::string &topic, uint32_t queue_size, bool latch=false) |
| |
| Publisher | advertise (const std::string &topic, uint32_t queue_size, const SubscriberStatusCallback &connect_cb, const SubscriberStatusCallback &disconnect_cb=SubscriberStatusCallback(), const VoidConstPtr &tracked_object=VoidConstPtr(), bool latch=false) |
| |
| Publisher | advertise (AdvertiseOptions &ops) |
| |
| ServiceServer | advertiseService (const std::string &service, bool(T::*srv_func)(MReq &, MRes &), T *obj) |
| |
| ServiceServer | advertiseService (const std::string &service, bool(*srv_func)(MReq &, MRes &)) |
| |
| ServiceServer | advertiseService (const std::string &service, bool(*srv_func)(ServiceEvent< MReq, MRes > &)) |
| |
| ServiceServer | advertiseService (const std::string &service, bool(T::*srv_func)(ServiceEvent< MReq, MRes > &), T *obj) |
| |
| ServiceServer | advertiseService (const std::string &service, const boost::function< bool(MReq &, MRes &)> &callback, const VoidConstPtr &tracked_object=VoidConstPtr()) |
| |
| ServiceServer | advertiseService (const std::string &service, const boost::function< bool(S &)> &callback, const VoidConstPtr &tracked_object=VoidConstPtr()) |
| |
| ServiceServer | advertiseService (const std::string &service, bool(T::*srv_func)(MReq &, MRes &), const boost::shared_ptr< T > &obj) |
| |
| ServiceServer | advertiseService (AdvertiseServiceOptions &ops) |
| |
| ServiceServer | advertiseService (const std::string &service, bool(T::*srv_func)(ServiceEvent< MReq, MRes > &), const boost::shared_ptr< T > &obj) |
| |
| SteadyTimer | createSteadyTimer (SteadyTimerOptions &ops) const |
| |
| SteadyTimer | createSteadyTimer (WallDuration period, void(T::*callback)(const SteadyTimerEvent &), T *obj, bool oneshot=false, bool autostart=true) const |
| |
| SteadyTimer | createSteadyTimer (WallDuration period, void(T::*callback)(const SteadyTimerEvent &), const boost::shared_ptr< T > &obj, bool oneshot=false, bool autostart=true) const |
| |
| SteadyTimer | createSteadyTimer (WallDuration period, const SteadyTimerCallback &callback, bool oneshot=false, bool autostart=true) const |
| |
| Timer | createTimer (Rate r, Handler h, Obj o, bool oneshot=false, bool autostart=true) const |
| |
| Timer | createTimer (Duration period, void(T::*callback)(const TimerEvent &) const, T *obj, bool oneshot=false, bool autostart=true) const |
| |
| Timer | createTimer (Duration period, void(T::*callback)(const TimerEvent &), T *obj, bool oneshot=false, bool autostart=true) const |
| |
| Timer | createTimer (Duration period, void(T::*callback)(const TimerEvent &), const boost::shared_ptr< T > &obj, bool oneshot=false, bool autostart=true) const |
| |
| Timer | createTimer (Duration period, const TimerCallback &callback, bool oneshot=false, bool autostart=true) const |
| |
| Timer | createTimer (TimerOptions &ops) const |
| |
| WallTimer | createWallTimer (WallDuration period, void(T::*callback)(const WallTimerEvent &), T *obj, bool oneshot=false, bool autostart=true) const |
| |
| WallTimer | createWallTimer (WallDuration period, void(T::*callback)(const WallTimerEvent &), const boost::shared_ptr< T > &obj, bool oneshot=false, bool autostart=true) const |
| |
| WallTimer | createWallTimer (WallDuration period, const WallTimerCallback &callback, bool oneshot=false, bool autostart=true) const |
| |
| WallTimer | createWallTimer (WallTimerOptions &ops) const |
| |
| bool | deleteParam (const std::string &key) const |
| |
| CallbackQueueInterface * | getCallbackQueue () const |
| |
| const std::string & | getNamespace () const |
| |
| bool | getParam (const std::string &key, float &f) const |
| |
| bool | getParam (const std::string &key, int &i) const |
| |
| bool | getParam (const std::string &key, bool &b) const |
| |
| bool | getParam (const std::string &key, XmlRpc::XmlRpcValue &v) const |
| |
| bool | getParam (const std::string &key, std::vector< std::string > &vec) const |
| |
| bool | getParam (const std::string &key, std::vector< double > &vec) const |
| |
| bool | getParam (const std::string &key, std::vector< float > &vec) const |
| |
| bool | getParam (const std::string &key, std::vector< int > &vec) const |
| |
| bool | getParam (const std::string &key, std::vector< bool > &vec) const |
| |
| bool | getParam (const std::string &key, std::map< std::string, std::string > &map) const |
| |
| bool | getParam (const std::string &key, std::map< std::string, double > &map) const |
| |
| bool | getParam (const std::string &key, std::map< std::string, float > &map) const |
| |
| bool | getParam (const std::string &key, std::map< std::string, int > &map) const |
| |
| bool | getParam (const std::string &key, std::map< std::string, bool > &map) const |
| |
| bool | getParam (const std::string &key, std::string &s) const |
| |
| bool | getParam (const std::string &key, double &d) const |
| |
| bool | getParamCached (const std::string &key, std::string &s) const |
| |
| bool | getParamCached (const std::string &key, double &d) const |
| |
| bool | getParamCached (const std::string &key, float &f) const |
| |
| bool | getParamCached (const std::string &key, int &i) const |
| |
| bool | getParamCached (const std::string &key, bool &b) const |
| |
| bool | getParamCached (const std::string &key, XmlRpc::XmlRpcValue &v) const |
| |
| bool | getParamCached (const std::string &key, std::map< std::string, float > &map) const |
| |
| bool | getParamCached (const std::string &key, std::vector< std::string > &vec) const |
| |
| bool | getParamCached (const std::string &key, std::vector< double > &vec) const |
| |
| bool | getParamCached (const std::string &key, std::vector< float > &vec) const |
| |
| bool | getParamCached (const std::string &key, std::vector< int > &vec) const |
| |
| bool | getParamCached (const std::string &key, std::vector< bool > &vec) const |
| |
| bool | getParamCached (const std::string &key, std::map< std::string, std::string > &map) const |
| |
| bool | getParamCached (const std::string &key, std::map< std::string, double > &map) const |
| |
| bool | getParamCached (const std::string &key, std::map< std::string, int > &map) const |
| |
| bool | getParamCached (const std::string &key, std::map< std::string, bool > &map) const |
| |
| bool | getParamNames (std::vector< std::string > &keys) const |
| |
| const std::string & | getUnresolvedNamespace () const |
| |
| bool | hasParam (const std::string &key) const |
| |
| | NodeHandle (const std::string &ns=std::string(), const M_string &remappings=M_string()) |
| |
| | NodeHandle (const NodeHandle &rhs) |
| |
| | NodeHandle (const NodeHandle &parent, const std::string &ns) |
| |
| | NodeHandle (const NodeHandle &parent, const std::string &ns, const M_string &remappings) |
| |
| bool | ok () const |
| |
| NodeHandle & | operator= (const NodeHandle &rhs) |
| |
| T | param (const std::string ¶m_name, const T &default_val) const |
| |
| bool | param (const std::string ¶m_name, T ¶m_val, const T &default_val) const |
| |
| std::string | resolveName (const std::string &name, bool remap=true) const |
| |
| bool | searchParam (const std::string &key, std::string &result) const |
| |
| ServiceClient | serviceClient (ServiceClientOptions &ops) |
| |
| ServiceClient | serviceClient (const std::string &service_name, bool persistent=false, const M_string &header_values=M_string()) |
| |
| ServiceClient | serviceClient (const std::string &service_name, bool persistent=false, const M_string &header_values=M_string()) |
| |
| void | setCallbackQueue (CallbackQueueInterface *queue) |
| |
| void | setParam (const std::string &key, const std::map< std::string, bool > &map) const |
| |
| void | setParam (const std::string &key, const std::map< std::string, int > &map) const |
| |
| void | setParam (const std::string &key, const std::map< std::string, double > &map) const |
| |
| void | setParam (const std::string &key, const XmlRpc::XmlRpcValue &v) const |
| |
| void | setParam (const std::string &key, const std::map< std::string, float > &map) const |
| |
| void | setParam (const std::string &key, const std::vector< float > &vec) const |
| |
| void | setParam (const std::string &key, const std::vector< double > &vec) const |
| |
| void | setParam (const std::string &key, const std::vector< bool > &vec) const |
| |
| void | setParam (const std::string &key, const std::string &s) const |
| |
| void | setParam (const std::string &key, const char *s) const |
| |
| void | setParam (const std::string &key, bool b) const |
| |
| void | setParam (const std::string &key, const std::vector< int > &vec) const |
| |
| void | setParam (const std::string &key, const std::map< std::string, std::string > &map) const |
| |
| void | setParam (const std::string &key, const std::vector< std::string > &vec) const |
| |
| void | setParam (const std::string &key, int i) const |
| |
| void | setParam (const std::string &key, double d) const |
| |
| void | shutdown () |
| |
| Subscriber | subscribe (const std::string &topic, uint32_t queue_size, void(T::*fp)(const boost::shared_ptr< M const > &), const boost::shared_ptr< T > &obj, const TransportHints &transport_hints=TransportHints()) |
| |
| Subscriber | subscribe (const std::string &topic, uint32_t queue_size, void(T::*fp)(const boost::shared_ptr< M const > &) const, T *obj, const TransportHints &transport_hints=TransportHints()) |
| |
| Subscriber | subscribe (const std::string &topic, uint32_t queue_size, void(T::*fp)(const boost::shared_ptr< M const > &), T *obj, const TransportHints &transport_hints=TransportHints()) |
| |
| Subscriber | subscribe (const std::string &topic, uint32_t queue_size, const boost::function< void(C)> &callback, const VoidConstPtr &tracked_object=VoidConstPtr(), const TransportHints &transport_hints=TransportHints()) |
| |
| Subscriber | subscribe (const std::string &topic, uint32_t queue_size, const boost::function< void(const boost::shared_ptr< M const > &)> &callback, const VoidConstPtr &tracked_object=VoidConstPtr(), const TransportHints &transport_hints=TransportHints()) |
| |
| Subscriber | subscribe (const std::string &topic, uint32_t queue_size, void(T::*fp)(M), const boost::shared_ptr< T > &obj, const TransportHints &transport_hints=TransportHints()) |
| |
| Subscriber | subscribe (const std::string &topic, uint32_t queue_size, void(T::*fp)(const boost::shared_ptr< M const > &) const, const boost::shared_ptr< T > &obj, const TransportHints &transport_hints=TransportHints()) |
| |
| Subscriber | subscribe (const std::string &topic, uint32_t queue_size, void(T::*fp)(M) const, T *obj, const TransportHints &transport_hints=TransportHints()) |
| |
| Subscriber | subscribe (SubscribeOptions &ops) |
| |
| Subscriber | subscribe (const std::string &topic, uint32_t queue_size, void(T::*fp)(M) const, const boost::shared_ptr< T > &obj, const TransportHints &transport_hints=TransportHints()) |
| |
| Subscriber | subscribe (const std::string &topic, uint32_t queue_size, void(T::*fp)(M), T *obj, const TransportHints &transport_hints=TransportHints()) |
| |
| Subscriber | subscribe (const std::string &topic, uint32_t queue_size, void(*fp)(M), const TransportHints &transport_hints=TransportHints()) |
| |
| Subscriber | subscribe (const std::string &topic, uint32_t queue_size, void(*fp)(const boost::shared_ptr< M const > &), const TransportHints &transport_hints=TransportHints()) |
| |
| | ~NodeHandle () |
| |