Test for lazy_subscriber.hpp . More...
#include "gtest/gtest.h"
#include <ros/topic_manager.h>
#include <memory>
#include <string>
#include <utility>
#include <ros/ros.h>
#include <ros/subscription.h>
#include <std_msgs/Header.h>
#include <topic_tools/shape_shifter.h>
#include <cras_topic_tools/lazy_subscriber.hpp>
Go to the source code of this file.
Classes | |
class | TestLazySubscriber< M > |
Macros | |
#define | private public |
Functions | |
size_t | getNumSubscriptions (const std::string &topic) |
int | main (int argc, char **argv) |
void | spin (double duration) |
void | spin (double duration, double wait) |
TEST (LazySubscriber, MessageEvent) | |
TEST (LazySubscriber, Test) | |
TEST (LazySubscriberBase, Chain) | |
TEST (LazySubscriberBase, SetLazy) | |
TEST (LazySubscriberBase, Test) | |
Test for lazy_subscriber.hpp .
Definition in file test_lazy_subscriber.cpp.
#define private public |
Definition at line 12 of file test_lazy_subscriber.cpp.
size_t getNumSubscriptions | ( | const std::string & | topic | ) |
Definition at line 43 of file test_lazy_subscriber.cpp.
Definition at line 856 of file test_lazy_subscriber.cpp.
void spin | ( | double | duration | ) |
Definition at line 38 of file test_lazy_subscriber.cpp.
void spin | ( | double | duration, |
double | wait | ||
) |
Definition at line 27 of file test_lazy_subscriber.cpp.
TEST | ( | LazySubscriber | , |
MessageEvent | |||
) |
Definition at line 708 of file test_lazy_subscriber.cpp.
TEST | ( | LazySubscriber | , |
Test | |||
) |
Definition at line 562 of file test_lazy_subscriber.cpp.
TEST | ( | LazySubscriberBase | , |
Chain | |||
) |
Definition at line 404 of file test_lazy_subscriber.cpp.
TEST | ( | LazySubscriberBase | , |
SetLazy | |||
) |
Definition at line 248 of file test_lazy_subscriber.cpp.
TEST | ( | LazySubscriberBase | , |
Test | |||
) |
Definition at line 72 of file test_lazy_subscriber.cpp.