|  | 
| typedef boost::shared_ptr< AsyncSpinnerImpl > | AsyncSpinnerImplPtr | 
|  | 
| typedef boost::shared_ptr< ASyncXMLRPCConnection > | ASyncXMLRPCConnectionPtr | 
|  | 
| typedef boost::shared_ptr< CallbackInterface > | CallbackInterfacePtr | 
|  | 
| typedef boost::shared_ptr< CallbackQueue > | CallbackQueuePtr | 
|  | 
| typedef boost::shared_ptr< ConnectionManager > | ConnectionManagerPtr | 
|  | 
| typedef boost::shared_ptr< Connection > | ConnectionPtr | 
|  | 
| typedef boost::function< bool(const ConnectionPtr &, const Header &)> | HeaderReceivedFunc | 
|  | 
| typedef init_options::InitOption | InitOption | 
|  | 
| typedef TimerManager< SteadyTime, WallDuration, SteadyTimerEvent > | InternalTimerManager | 
|  | 
| typedef boost::shared_ptr< InternalTimerManager > | InternalTimerManagerPtr | 
|  | 
| typedef boost::shared_ptr< IntraProcessPublisherLink > | IntraProcessPublisherLinkPtr | 
|  | 
| typedef boost::shared_ptr< IntraProcessSubscriberLink > | IntraProcessSubscriberLinkPtr | 
|  | 
| typedef std::list< ServicePublicationPtr > | L_ServicePublication | 
|  | 
| typedef std::list< ServiceServerLinkPtr > | L_ServiceServerLink | 
|  | 
| typedef std::list< SubscriptionPtr > | L_Subscription | 
|  | 
| typedef std::map< std::string, std::string > | M_string | 
|  | 
| typedef std::map< std::string, std::string > | M_string | 
|  | 
| typedef boost::shared_ptr< M_string > | M_stringPtr | 
|  | 
| typedef boost::shared_ptr< MessageDeserializer > | MessageDeserializerPtr | 
|  | 
| typedef boost::shared_ptr< NodeHandle > | NodeHandlePtr | 
|  | 
| typedef boost::shared_ptr< std::vector< socket_pollfd > > | pollfd_vector_ptr | 
|  | 
| typedef boost::shared_ptr< PollManager > | PollManagerPtr | 
|  | 
| typedef boost::shared_ptr< Publication > | PublicationPtr | 
|  | 
| typedef boost::weak_ptr< Publication > | PublicationWPtr | 
|  | 
| typedef boost::shared_ptr< PublisherLink > | PublisherLinkPtr | 
|  | 
| typedef boost::function< void(const ConnectionPtr &, const boost::shared_array< uint8_t > &, uint32_t, bool)> | ReadFinishedFunc | 
|  | 
| typedef std::set< ASyncXMLRPCConnectionPtr > | S_ASyncXMLRPCConnection | 
|  | 
| typedef std::set< ConnectionPtr > | S_Connection | 
|  | 
| typedef std::set< std::string > | S_string | 
|  | 
| typedef std::set< SubscriptionPtr > | S_Subscription | 
|  | 
| typedef boost::shared_ptr< ServiceCallbackHelper > | ServiceCallbackHelperPtr | 
|  | 
| typedef boost::shared_ptr< ServiceClientLink > | ServiceClientLinkPtr | 
|  | 
| typedef boost::shared_ptr< ServiceClient > | ServiceClientPtr | 
|  | 
| typedef boost::shared_ptr< ServiceManager > | ServiceManagerPtr | 
|  | 
| typedef boost::shared_ptr< ServicePublication > | ServicePublicationPtr | 
|  | 
| typedef boost::weak_ptr< ServicePublication > | ServicePublicationWPtr | 
|  | 
| typedef boost::shared_ptr< ServiceServerLink > | ServiceServerLinkPtr | 
|  | 
| typedef int | signal_fd_t | 
|  | 
| typedef int | socket_fd_t | 
|  | 
| typedef struct pollfd | socket_pollfd | 
|  | 
| typedef boost::function< void(const SteadyTimerEvent &)> | SteadyTimerCallback | 
|  | 
| typedef std::pair< std::string, std::string > | StringPair | 
|  | 
| typedef boost::shared_ptr< SubscriberCallbacks > | SubscriberCallbacksPtr | 
|  | 
| typedef boost::shared_ptr< SubscriberLink > | SubscriberLinkPtr | 
|  | 
| typedef boost::function< void(const SingleSubscriberPublisher &)> | SubscriberStatusCallback | 
|  | 
| typedef boost::shared_ptr< SubscriptionCallbackHelper > | SubscriptionCallbackHelperPtr | 
|  | 
| typedef boost::shared_ptr< SubscriptionCallback > | SubscriptionCallbackPtr | 
|  | 
| typedef boost::shared_ptr< Subscription > | SubscriptionPtr | 
|  | 
| typedef boost::shared_ptr< SubscriptionQueue > | SubscriptionQueuePtr | 
|  | 
| typedef boost::weak_ptr< Subscription > | SubscriptionWPtr | 
|  | 
| typedef boost::function< void(const TimerEvent &)> | TimerCallback | 
|  | 
| typedef boost::shared_ptr< TopicManager > | TopicManagerPtr | 
|  | 
| typedef boost::shared_ptr< Transport > | TransportPtr | 
|  | 
| typedef boost::shared_ptr< TransportPublisherLink > | TransportPublisherLinkPtr | 
|  | 
| typedef boost::shared_ptr< TransportSubscriberLink > | TransportSubscriberLinkPtr | 
|  | 
| typedef boost::shared_ptr< TransportTCP > | TransportTCPPtr | 
|  | 
| typedef struct ros::TransportUDPHeader | TransportUDPHeader | 
|  | 
| typedef boost::shared_ptr< TransportUDP > | TransportUDPPtr | 
|  | 
| typedef std::vector< ConnectionPtr > | V_Connection | 
|  | 
| typedef std::vector< PublicationPtr > | V_Publication | 
|  | 
| typedef std::vector< Publisher > | V_Publisher | 
|  | 
| typedef std::vector< PublisherLinkPtr > | V_PublisherLink | 
|  | 
| typedef std::vector< ServiceClientLinkPtr > | V_ServiceClientLink | 
|  | 
| typedef std::vector< ServicePublicationPtr > | V_ServicePublication | 
|  | 
| typedef std::vector< ServiceServer > | V_ServiceServer | 
|  | 
| typedef std::vector< std::string > | V_string | 
|  | 
| typedef std::vector< Subscriber > | V_Subscriber | 
|  | 
| typedef std::vector< SubscriberLinkPtr > | V_SubscriberLink | 
|  | 
| typedef std::vector< SubscriptionPtr > | V_Subscription | 
|  | 
| typedef boost::shared_ptr< void const > | VoidConstPtr | 
|  | 
| typedef boost::weak_ptr< void const > | VoidConstWPtr | 
|  | 
| typedef boost::function< void(void)> | VoidFunc | 
|  | 
| typedef boost::shared_ptr< void > | VoidPtr | 
|  | 
| typedef boost::signals2::signal< void(void)> | VoidSignal | 
|  | 
| typedef boost::weak_ptr< void > | VoidWPtr | 
|  | 
| typedef std::vector< std::pair< std::string, std::string > > | VP_string | 
|  | 
| typedef boost::function< void(const WallTimerEvent &)> | WallTimerCallback | 
|  | 
| typedef boost::function< void(const ConnectionPtr &)> | WriteFinishedFunc | 
|  | 
| typedef boost::shared_ptr< XMLRPCCallWrapper > | XMLRPCCallWrapperPtr | 
|  | 
| typedef boost::function< void(XmlRpc::XmlRpcValue &, XmlRpc::XmlRpcValue &)> | XMLRPCFunc | 
|  | 
| typedef boost::shared_ptr< XMLRPCManager > | XMLRPCManagerPtr | 
|  | 
|  | 
| ROSCPP_DECL void | add_socket_to_watcher (int epfd, int fd) | 
|  | 
| void | atexitCallback () | 
|  | 
| void | basicSigintHandler (int sig) | 
|  | 
| void | check_ipv6_environment () | 
|  | 
| void | checkForShutdown () | 
|  | 
| void | clockCallback (const rosgraph_msgs::Clock::ConstPtr &msg) | 
|  | 
| void | close_signal_pair (signal_fd_t signal_pair[2]) | 
|  | 
| ROSCPP_DECL int | close_socket (socket_fd_t &socket) | 
|  | 
| ROSCPP_DECL void | close_socket_watcher (int fd) | 
|  | 
| bool | closeAllConnections (roscpp::Empty::Request &, roscpp::Empty::Response &) | 
|  | 
| void | closeTransport (const TransportUDPPtr &trans) | 
|  | 
| ROSCPP_DECL int | create_signal_pair (signal_fd_t signal_pair[2]) | 
|  | 
| ROSCPP_DECL int | create_socket_watcher () | 
|  | 
| ROS_DEPRECATED boost::shared_ptr< M > | defaultMessageCreateFunction () | 
|  | 
| boost::shared_ptr< M > | defaultServiceCreateFunction () | 
|  | 
| ROSCPP_DECL void | del_socket_from_watcher (int epfd, int fd) | 
|  | 
| const Duration | DURATION_MAX (std::numeric_limits< int32_t >::max(), 999999999) | 
|  | 
| const Duration | DURATION_MIN (std::numeric_limits< int32_t >::min(), 0) | 
|  | 
| static bool | g_initialized (false) | 
|  | 
| static bool | g_stopped (false) | 
|  | 
| static bool | g_use_sim_time (true) | 
|  | 
| bool | get_environment_variable (std::string &str, const char *environment_variable) | 
|  | 
| const ROSCPP_DECL std::string & | getDefaultMasterURI () | 
|  | 
| ROSCPP_DECL CallbackQueue * | getGlobalCallbackQueue () | 
|  | 
| CallbackQueuePtr | getInternalCallbackQueue () | 
|  | 
| ROSCPP_DECL InternalTimerManagerPtr | getInternalTimerManager () | 
|  | 
| bool | getLoggers (roscpp::GetLoggers::Request &, roscpp::GetLoggers::Response &resp) | 
|  | 
| void | getPid (const XmlRpcValue ¶ms, XmlRpcValue &result) | 
|  | 
| ROSCPP_DECL std::string | getROSArg (int argc, const char *const *argv, const std::string &arg) | 
|  | 
| ROSCPP_DECL void | init (const M_string &remappings, const std::string &name, uint32_t options=0) | 
|  | 
| ROSCPP_DECL void | init (const VP_string &remapping_args, const std::string &name, uint32_t options=0) | 
|  | 
| ROSCPP_DECL void | init (int &argc, char **argv, const std::string &name, uint32_t options=0) | 
|  | 
| ROSCPP_DECL void | initInternalTimerManager () | 
|  | 
| void | internalCallbackQueueThreadFunc () | 
|  | 
| ROSCPP_DECL int | is_async_connected (socket_fd_t &socket, int &err) | 
|  | 
| ROSCPP_DECL bool | isInitialized () | 
|  | 
| ROSCPP_DECL bool | isShuttingDown () | 
|  | 
| ROSCPP_DECL bool | isStarted () | 
|  | 
| ROSCPP_DECL int | last_socket_error () | 
|  | 
| ROSCPP_DECL bool | last_socket_error_is_would_block () | 
|  | 
| const ROSCPP_DECL char * | last_socket_error_string () | 
|  | 
| bool | md5sumsMatch (const std::string &lhs, const std::string &rhs) | 
|  | 
| ROSTIME_DECL void | normalizeSecNSec (uint32_t &sec, uint32_t &nsec) | 
|  | 
| ROSTIME_DECL void | normalizeSecNSec (uint64_t &sec, uint64_t &nsec) | 
|  | 
| ROSTIME_DECL void | normalizeSecNSecSigned (int32_t &sec, int32_t &nsec) | 
|  | 
| ROSTIME_DECL void | normalizeSecNSecSigned (int64_t &sec, int64_t &nsec) | 
|  | 
| ROSTIME_DECL void | normalizeSecNSecUnsigned (int64_t &sec, int64_t &nsec) | 
|  | 
| ROSCPP_DECL bool | ok () | 
|  | 
| ROSTIME_DECL std::ostream & | operator<< (std::ostream &os, const Duration &rhs) | 
|  | 
| ROSTIME_DECL std::ostream & | operator<< (std::ostream &os, const SteadyTime &rhs) | 
|  | 
| ROSTIME_DECL std::ostream & | operator<< (std::ostream &os, const Time &rhs) | 
|  | 
| ROSTIME_DECL std::ostream & | operator<< (std::ostream &os, const WallDuration &rhs) | 
|  | 
| ROSTIME_DECL std::ostream & | operator<< (std::ostream &os, const WallTime &rhs) | 
|  | 
| ROSCPP_DECL pollfd_vector_ptr | poll_sockets (int epfd, socket_pollfd *fds, nfds_t nfds, int timeout) | 
|  | 
| ssize_t | read_signal (const signal_fd_t &signal, void *buffer, const size_t &nbyte) | 
|  | 
| ROSCPP_DECL void | removeROSArgs (int argc, const char *const *argv, V_string &args_out) | 
|  | 
| ROSCPP_DECL void | requestShutdown () | 
|  | 
| int | ros_nanosleep (const uint32_t &sec, const uint32_t &nsec) | 
|  | 
| ROSTIME_DECL void | ros_steadytime (uint32_t &sec, uint32_t &nsec) | 
|  | 
| bool | ros_wallsleep (uint32_t sec, uint32_t nsec) | 
|  | 
| ROSTIME_DECL void | ros_walltime (uint32_t &sec, uint32_t &nsec) | 
|  | 
| ROSCPP_DECL void | set_events_on_socket (int epfd, int fd, int events) | 
|  | 
| ROSCPP_DECL int | set_non_blocking (socket_fd_t &socket) | 
|  | 
| bool | setLoggerLevel (roscpp::SetLoggerLevel::Request &req, roscpp::SetLoggerLevel::Response &) | 
|  | 
| ROSCPP_DECL void | shutdown () | 
|  | 
| void | shutdownCallback (XmlRpc::XmlRpcValue ¶ms, XmlRpc::XmlRpcValue &result) | 
|  | 
| const ROSCPP_DECL char * | socket_error_string (int err) | 
|  | 
| ROSCPP_DECL void | spin () | 
|  | 
| ROSCPP_DECL void | spin (Spinner &spinner) | 
|  | 
| ROSCPP_DECL void | spinOnce () | 
|  | 
| void | spinThread () | 
|  | 
| ROSCPP_DECL void | start () | 
|  | 
| const Time | TIME_MAX (std::numeric_limits< uint32_t >::max(), 999999999) | 
|  | 
| bool | urisEqual (const std::string &uri1, const std::string &uri2) | 
|  | 
| ROSCPP_DECL void | waitForShutdown () | 
|  | 
| ssize_t | write_signal (const signal_fd_t &signal, const void *buffer, const size_t &nbyte) | 
|  |