Test for generic_lazy_pubsub.hpp . More...
#include "gtest/gtest.h"
#include <ros/topic_manager.h>
#include <memory>
#include <string>
#include <ros/ros.h>
#include <ros/subscription.h>
#include <std_msgs/Header.h>
#include <cras_cpp_common/functional.hpp>
#include <cras_topic_tools/generic_lazy_pubsub.hpp>
Go to the source code of this file.
Classes | |
class | TestAdvertiseOptions |
class | TestLazyPubSub |
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 (GenericLazyPubSub, Chain) | |
TEST (GenericLazyPubSub, LatchIsRetained) | |
TEST (GenericLazyPubSub, MultiLatchedInputs) | |
TEST (GenericLazyPubSub, OverallTest) | |
TEST (GenericLazyPubSub, OverrideAdvertiseOptions) | |
TEST (GenericLazyPubSub, QueueSize) | |
TEST (GenericLazyPubSub, SetLazy) | |
TEST (GenericLazyPubSub, StartSequenceIn) | |
TEST (GenericLazyPubSub, StartSequenceInOut) | |
TEST (GenericLazyPubSub, StartSequenceNoOut) | |
TEST (GenericLazyPubSub, StartSequenceNothing) | |
TEST (GenericLazyPubSub, StartSequenceOut) | |
Test for generic_lazy_pubsub.hpp .
Definition in file test_generic_lazy_pubsub.cpp.
#define private public |
Definition at line 12 of file test_generic_lazy_pubsub.cpp.
size_t getNumSubscriptions | ( | const std::string & | topic | ) |
Definition at line 42 of file test_generic_lazy_pubsub.cpp.
Definition at line 948 of file test_generic_lazy_pubsub.cpp.
void spin | ( | double | duration | ) |
Definition at line 37 of file test_generic_lazy_pubsub.cpp.
void spin | ( | double | duration, |
double | wait | ||
) |
Definition at line 26 of file test_generic_lazy_pubsub.cpp.
TEST | ( | GenericLazyPubSub | , |
Chain | |||
) |
Definition at line 808 of file test_generic_lazy_pubsub.cpp.
TEST | ( | GenericLazyPubSub | , |
LatchIsRetained | |||
) |
Definition at line 629 of file test_generic_lazy_pubsub.cpp.
TEST | ( | GenericLazyPubSub | , |
MultiLatchedInputs | |||
) |
Definition at line 566 of file test_generic_lazy_pubsub.cpp.
TEST | ( | GenericLazyPubSub | , |
OverallTest | |||
) |
Definition at line 88 of file test_generic_lazy_pubsub.cpp.
TEST | ( | GenericLazyPubSub | , |
OverrideAdvertiseOptions | |||
) |
Definition at line 604 of file test_generic_lazy_pubsub.cpp.
TEST | ( | GenericLazyPubSub | , |
QueueSize | |||
) |
Definition at line 540 of file test_generic_lazy_pubsub.cpp.
TEST | ( | GenericLazyPubSub | , |
SetLazy | |||
) |
Definition at line 654 of file test_generic_lazy_pubsub.cpp.
TEST | ( | GenericLazyPubSub | , |
StartSequenceIn | |||
) |
Definition at line 318 of file test_generic_lazy_pubsub.cpp.
TEST | ( | GenericLazyPubSub | , |
StartSequenceInOut | |||
) |
Definition at line 455 of file test_generic_lazy_pubsub.cpp.
TEST | ( | GenericLazyPubSub | , |
StartSequenceNoOut | |||
) |
Definition at line 504 of file test_generic_lazy_pubsub.cpp.
TEST | ( | GenericLazyPubSub | , |
StartSequenceNothing | |||
) |
Definition at line 249 of file test_generic_lazy_pubsub.cpp.
TEST | ( | GenericLazyPubSub | , |
StartSequenceOut | |||
) |
Definition at line 385 of file test_generic_lazy_pubsub.cpp.