#include <gtest/gtest.h>
#include <ros/ros.h>
#include <std_msgs/builtin_bool.h>
#include <std_msgs/builtin_double.h>
#include <std_msgs/builtin_float.h>
#include <std_msgs/builtin_int16.h>
#include <std_msgs/builtin_int32.h>
#include <std_msgs/builtin_int64.h>
#include <std_msgs/builtin_int8.h>
#include <std_msgs/builtin_string.h>
#include <std_msgs/builtin_uint16.h>
#include <std_msgs/builtin_uint32.h>
#include <std_msgs/builtin_uint64.h>
#include <std_msgs/builtin_uint8.h>
Go to the source code of this file.
Functions | |
template<typename T > | |
void | callback (const boost::shared_ptr< T const > &) |
int | main (int argc, char **argv) |
TEST (BuiltinTypes, advertise) | |
TEST (BuiltinTypes, subscribe) |
void callback | ( | const boost::shared_ptr< T const > & | ) |
Definition at line 70 of file builtin_types.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 90 of file builtin_types.cpp.
TEST | ( | BuiltinTypes | , |
advertise | |||
) |
Definition at line 52 of file builtin_types.cpp.
TEST | ( | BuiltinTypes | , |
subscribe | |||
) |
Definition at line 73 of file builtin_types.cpp.