#include <string>
#include <vector>
#include <map>
#include <set>
#include <list>
#include <boost/shared_ptr.hpp>
#include <boost/make_shared.hpp>
#include <boost/weak_ptr.hpp>
#include <boost/function.hpp>
#include <ros/time.h>
#include <ros/macros.h>
#include "exceptions.h"
#include "ros/datatypes.h"
Go to the source code of this file.
Classes | |
struct | ros::SteadyTimerEvent |
Structure passed as a parameter to the callback invoked by a ros::SteadyTimer. More... | |
struct | ros::SubscriberCallbacks |
struct | ros::TimerEvent |
Structure passed as a parameter to the callback invoked by a ros::Timer. More... | |
struct | ros::WallTimerEvent |
Structure passed as a parameter to the callback invoked by a ros::WallTimer. More... | |
Namespaces | |
ros | |
Typedefs | |
typedef std::list< ServicePublicationPtr > | ros::L_ServicePublication |
typedef std::list< ServiceServerLinkPtr > | ros::L_ServiceServerLink |
typedef std::list< SubscriptionPtr > | ros::L_Subscription |
typedef boost::shared_ptr< NodeHandle > | ros::NodeHandlePtr |
typedef boost::shared_ptr< Publication > | ros::PublicationPtr |
typedef boost::shared_ptr< PublisherLink > | ros::PublisherLinkPtr |
typedef std::set< ConnectionPtr > | ros::S_Connection |
typedef std::set< SubscriptionPtr > | ros::S_Subscription |
typedef boost::shared_ptr< ServiceManager > | ros::ServiceManagerPtr |
typedef boost::shared_ptr< ServicePublication > | ros::ServicePublicationPtr |
typedef boost::shared_ptr< ServiceServerLink > | ros::ServiceServerLinkPtr |
typedef boost::function< void(const SteadyTimerEvent &)> | ros::SteadyTimerCallback |
typedef boost::shared_ptr< SubscriberCallbacks > | ros::SubscriberCallbacksPtr |
typedef boost::shared_ptr< SubscriberLink > | ros::SubscriberLinkPtr |
typedef boost::function< void(const SingleSubscriberPublisher &)> | ros::SubscriberStatusCallback |
typedef boost::shared_ptr< Subscription > | ros::SubscriptionPtr |
typedef boost::weak_ptr< Subscription > | ros::SubscriptionWPtr |
typedef boost::function< void(const TimerEvent &)> | ros::TimerCallback |
typedef boost::shared_ptr< TopicManager > | ros::TopicManagerPtr |
typedef boost::shared_ptr< TransportTCP > | ros::TransportTCPPtr |
typedef boost::shared_ptr< TransportUDP > | ros::TransportUDPPtr |
typedef std::vector< ConnectionPtr > | ros::V_Connection |
typedef std::vector< PublicationPtr > | ros::V_Publication |
typedef std::vector< PublisherLinkPtr > | ros::V_PublisherLink |
typedef std::vector< ServicePublicationPtr > | ros::V_ServicePublication |
typedef std::vector< SubscriberLinkPtr > | ros::V_SubscriberLink |
typedef std::vector< SubscriptionPtr > | ros::V_Subscription |
typedef boost::shared_ptr< void const > | ros::VoidConstPtr |
typedef boost::weak_ptr< void const > | ros::VoidConstWPtr |
typedef boost::shared_ptr< void > | ros::VoidPtr |
typedef boost::weak_ptr< void > | ros::VoidWPtr |
typedef boost::function< void(const WallTimerEvent &)> | ros::WallTimerCallback |
typedef boost::shared_ptr< XMLRPCManager > | ros::XMLRPCManagerPtr |