|
struct | AdvertiseOptions |
| Encapsulates all options available for creating a Publisher. More...
|
|
struct | AdvertiseServiceOptions |
| Encapsulates all options available for creating a ServiceServer. More...
|
|
class | AsyncSpinner |
| AsyncSpinner is a spinner that does not conform to the abstract Spinner interface. Instead, it spins asynchronously when you call start(), and stops when either you call stop(), ros::shutdown() is called, or its destructor is called. More...
|
|
class | AsyncSpinnerImpl |
|
class | ASyncXMLRPCConnection |
|
class | CachedXmlRpcClient |
|
class | CallbackInterface |
| Abstract interface for items which can be added to a CallbackQueueInterface. More...
|
|
class | CallbackQueue |
| This is the default implementation of the ros::CallbackQueueInterface. More...
|
|
class | CallbackQueueInterface |
| Abstract interface for a queue used to handle all callbacks within roscpp. More...
|
|
class | ConflictingSubscriptionException |
| Thrown when a second (third,...) subscription is attempted with conflicting arguments. More...
|
|
class | Connection |
| Encapsulates a connection to a remote host, independent of the transport type. More...
|
|
class | ConnectionManager |
|
struct | DefaultMessageCreator |
|
class | Duration |
|
class | DurationBase |
|
class | Exception |
|
class | Header |
|
class | IntraProcessPublisherLink |
| Handles a connection to a single publisher on a given topic. Receives messages from a publisher and hands them off to its parent Subscription. More...
|
|
class | IntraProcessSubscriberLink |
| SubscriberLink handles broadcasting messages to a single subscriber on a single topic. More...
|
|
class | InvalidNameException |
| Thrown when an invalid graph resource name is specified to any roscpp function. More...
|
|
class | InvalidNodeNameException |
| Thrown when an invalid node name is specified to ros::init() More...
|
|
class | InvalidParameterException |
| Thrown when an invalid parameter is passed to a method. More...
|
|
class | InvalidPortException |
| Thrown when an invalid port is specified. More...
|
|
class | MessageDeserializer |
|
class | MessageEvent |
|
class | MultiThreadedSpinner |
| Spinner which spins in multiple threads. More...
|
|
class | NodeHandle |
| roscpp's interface for creating subscribers, publishers, etc. More...
|
|
class | NodeHandleBackingCollection |
|
class | NoHighPerformanceTimersException |
|
struct | ParameterAdapter |
| Generally not for outside use. Adapts a function parameter type into the message type, event type and parameter. Allows you to retrieve a parameter type from an event type. More...
|
|
struct | ParameterAdapter< boost::shared_ptr< M > > |
|
struct | ParameterAdapter< boost::shared_ptr< M const > > |
|
struct | ParameterAdapter< const boost::shared_ptr< M > & > |
|
struct | ParameterAdapter< const boost::shared_ptr< M const > & > |
|
struct | ParameterAdapter< const M & > |
|
struct | ParameterAdapter< const ros::MessageEvent< M > & > |
|
struct | ParameterAdapter< const ros::MessageEvent< M const > & > |
|
class | PeerConnDisconnCallback |
|
class | PollManager |
|
class | PollSet |
| Manages a set of sockets being polled through the poll() function call. More...
|
|
class | Publication |
| A Publication manages an advertised topic. More...
|
|
class | Publisher |
| Manages an advertisement on a specific topic. More...
|
|
class | PublisherLink |
| Handles a connection to a single publisher on a given topic. Receives messages from a publisher and hands them off to its parent Subscription. More...
|
|
class | Rate |
|
class | ROSOutAppender |
|
class | SerializedMessage |
|
class | ServiceCallback |
|
class | ServiceCallbackHelper |
| Abstract base class used by service servers to deal with concrete message types through a common interface. This is one part of the roscpp API that is not fully stable, so overloading this class is not recommended. More...
|
|
struct | ServiceCallbackHelperCallParams |
|
class | ServiceCallbackHelperT |
| Concrete generic implementation of ServiceCallbackHelper for any normal service type. More...
|
|
class | ServiceClient |
| Provides a handle-based interface to service client connections. More...
|
|
class | ServiceClientLink |
| Handles a connection to a single incoming service client. More...
|
|
struct | ServiceClientOptions |
| Encapsulates all options available for creating a ServiceClient. More...
|
|
class | ServiceEvent |
| Event type for services, ros::ServiceEvent<MReq, MRes>& can be used in your callback instead of MReq&, MRes&. More...
|
|
class | ServiceManager |
|
class | ServicePublication |
| Manages an advertised service. More...
|
|
class | ServiceServer |
| Manages an service advertisement. More...
|
|
class | ServiceServerLink |
| Handles a connection to a service. If it's a non-persistent client, automatically disconnects when its first service call has finished. More...
|
|
struct | ServiceSpec |
|
struct | ServiceSpecCallParams |
|
class | SingleSubscriberPublisher |
| Allows publication of a message to a single subscriber. Only available inside subscriber connection callbacks. More...
|
|
class | SingleThreadedSpinner |
| Spinner which runs in a single thread. More...
|
|
class | Spinner |
| Abstract interface for classes which spin on a callback queue. More...
|
|
class | StatisticsLogger |
| This class logs statistics data about a ROS connection and publishs them periodically on a common topic. More...
|
|
class | SteadyTime |
|
class | SteadyTimer |
| Manages a steady-clock timer callback. More...
|
|
struct | SteadyTimerEvent |
| Structure passed as a parameter to the callback invoked by a ros::SteadyTimer. More...
|
|
struct | SteadyTimerOptions |
| Encapsulates all options available for starting a timer. More...
|
|
struct | SubscribeOptions |
| Encapsulates all options available for creating a Subscriber. More...
|
|
class | Subscriber |
| Manages an subscription callback on a specific topic. More...
|
|
struct | SubscriberCallbacks |
|
class | SubscriberLink |
|
class | Subscription |
| Manages a subscription on a single topic. More...
|
|
class | SubscriptionCallbackHelper |
| Abstract base class used by subscriptions to deal with concrete message types through a common interface. This is one part of the roscpp API that is not fully stable, so overloading this class is not recommended. More...
|
|
struct | SubscriptionCallbackHelperCallParams |
|
struct | SubscriptionCallbackHelperDeserializeParams |
|
class | SubscriptionCallbackHelperT |
| Concrete generic implementation of SubscriptionCallbackHelper for any normal message type. Use directly with care, this is mostly for internal use. More...
|
|
class | SubscriptionQueue |
|
class | Time |
|
class | TimeBase |
|
class | TimeNotInitializedException |
|
class | Timer |
| Manages a timer callback. More...
|
|
struct | TimerEvent |
| Structure passed as a parameter to the callback invoked by a ros::Timer. More...
|
|
class | TimerManager |
|
struct | TimerOptions |
| Encapsulates all options available for starting a timer. More...
|
|
class | TopicManager |
|
class | Transport |
| Abstract base class that allows abstraction of the transport type, eg. TCP, shared memory, UDP... More...
|
|
class | TransportHints |
| Provides a way of specifying network transport hints to ros::NodeHandle::subscribe() and someday ros::NodeHandle::advertise() More...
|
|
class | TransportPublisherLink |
| Handles a connection to a single publisher on a given topic. Receives messages from a publisher and hands them off to its parent Subscription. More...
|
|
class | TransportSubscriberLink |
| SubscriberLink handles broadcasting messages to a single subscriber on a single topic. More...
|
|
class | TransportTCP |
| TCPROS transport. More...
|
|
class | TransportUDP |
| UDPROS transport. More...
|
|
struct | TransportUDPHeader |
|
class | WallDuration |
|
class | WallRate |
|
class | WallTime |
|
class | WallTimer |
| Manages a wall-clock timer callback. More...
|
|
struct | WallTimerEvent |
| Structure passed as a parameter to the callback invoked by a ros::WallTimer. More...
|
|
struct | WallTimerOptions |
| Encapsulates all options available for starting a timer. More...
|
|
class | XMLRPCCallWrapper |
|
class | XMLRPCManager |
|
|
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) |
| Close the socket. More...
|
|
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 () |
|
template<typename M > |
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 () |
| returns the default master uri that is used if no other is specified, e.g. by defining ROS_MASTER_URI. More...
|
|
ROSCPP_DECL CallbackQueue * | getGlobalCallbackQueue () |
| Returns a pointer to the global default callback queue. More...
|
|
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) |
| searches the command line arguments for the given arg parameter. In case this argument is not found an empty string is returned. More...
|
|
ROSCPP_DECL void | init (const M_string &remappings, const std::string &name, uint32_t options=0) |
| alternate ROS initialization function. More...
|
|
ROSCPP_DECL void | init (const VP_string &remapping_args, const std::string &name, uint32_t options=0) |
| alternate ROS initialization function. More...
|
|
ROSCPP_DECL void | init (int &argc, char **argv, const std::string &name, uint32_t options=0) |
| ROS initialization function. More...
|
|
ROSCPP_DECL void | initInternalTimerManager () |
|
void | internalCallbackQueueThreadFunc () |
|
ROSCPP_DECL int | is_async_connected (socket_fd_t &socket, int &err) |
|
ROSCPP_DECL bool | isInitialized () |
| Returns whether or not ros::init() has been called. More...
|
|
ROSCPP_DECL bool | isShuttingDown () |
| Returns whether or not ros::shutdown() has been (or is being) called. More...
|
|
ROSCPP_DECL bool | isStarted () |
| Returns whether or not the node has been started through ros::start() More...
|
|
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 () |
| Check whether it's time to exit. More...
|
|
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) |
| A cross platform polling function for sockets. More...
|
|
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) |
| returns a vector of program arguments that do not include any ROS remapping arguments. Useful if you need to parse your arguments to determine your node name More...
|
|
ROSCPP_DECL void | requestShutdown () |
| Request that the node shut itself down from within a ROS thread. More...
|
|
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 () |
| Disconnects everything and unregisters from the master. It is generally not necessary to call this function, as the node will automatically shutdown when all NodeHandles destruct. However, if you want to break out of a spin() loop explicitly, this function allows that. More...
|
|
void | shutdownCallback (XmlRpc::XmlRpcValue ¶ms, XmlRpc::XmlRpcValue &result) |
|
const ROSCPP_DECL char * | socket_error_string (int err) |
|
ROSCPP_DECL void | spin () |
| Enter simple event loop. More...
|
|
ROSCPP_DECL void | spin (Spinner &spinner) |
| Enter simple event loop. More...
|
|
ROSCPP_DECL void | spinOnce () |
| Process a single round of callbacks. More...
|
|
void | spinThread () |
|
ROSCPP_DECL void | start () |
| Actually starts the internals of the node (spins up threads, starts the network polling and xmlrpc loops, connects to internal subscriptions like /clock, starts internal service servers, etc.). More...
|
|
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 () |
| Wait for this node to be shutdown, whether through Ctrl-C, ros::shutdown(), or similar. More...
|
|
ssize_t | write_signal (const signal_fd_t &signal, const void *buffer, const size_t &nbyte) |
|