#include "ros/ros.h"
#include "test_rosjava_jni/TestDataTypes.h"
#include "test_rosjava_jni/TestTwoInts.h"
#include "std_msgs/String.h"
#include <gtest/gtest.h>
#include <ros/time.h>
#include <ros/console.h>
Go to the source code of this file.
Functions | |
bool | add (TestTwoInts::Request &req, TestTwoInts::Response &res) |
void | chatterCallback (const std_msgs::StringConstPtr &msg) |
int | main (int argc, char **argv) |
void | tdtCallback (const boost::shared_ptr< const TestDataTypes > &msg) |
TEST (Rosjava, rosjava) | |
Variables | |
std::string | last_message = "" |
int | num_messages_received = 0 |
TestDataTypes | test_in |
bool add | ( | TestTwoInts::Request & | req, |
TestTwoInts::Response & | res | ||
) |
Definition at line 53 of file tester.cpp.
void chatterCallback | ( | const std_msgs::StringConstPtr & | msg | ) |
Definition at line 42 of file tester.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 277 of file tester.cpp.
void tdtCallback | ( | const boost::shared_ptr< const TestDataTypes > & | msg | ) |
Definition at line 48 of file tester.cpp.
TEST | ( | Rosjava | , |
rosjava | |||
) |
Definition at line 64 of file tester.cpp.
std::string last_message = "" |
Definition at line 39 of file tester.cpp.
int num_messages_received = 0 |
Definition at line 38 of file tester.cpp.
Definition at line 40 of file tester.cpp.