$search
#include <string>
#include <sstream>
#include <fstream>
#include <gtest/gtest.h>
#include <time.h>
#include <stdlib.h>
#include "ros/ros.h"
#include "std_msgs/String.h"
Go to the source code of this file.
Functions | |
void | callback (const std_msgs::String::ConstPtr &msg) |
int | main (int argc, char **argv) |
TEST (Expecter, impl) | |
Variables | |
std::string | expect_what |
unsigned | nseen = 0 |
std::string | on_topic |
void callback | ( | const std_msgs::String::ConstPtr & | msg | ) |
Definition at line 47 of file string_msg_expect.cpp.
int main | ( | int | argc, | |
char ** | argv | |||
) |
Definition at line 71 of file string_msg_expect.cpp.
TEST | ( | Expecter | , | |
impl | ||||
) |
Definition at line 53 of file string_msg_expect.cpp.
std::string expect_what |
Definition at line 44 of file string_msg_expect.cpp.
unsigned nseen = 0 |
Definition at line 45 of file string_msg_expect.cpp.
std::string on_topic |
Definition at line 44 of file string_msg_expect.cpp.