#include <string>#include <gtest/gtest.h>#include <ros/ros.h>#include <tf2_ros/transform_listener.h>#include <boost/thread/thread.hpp>#include <urdf/model.h>#include <kdl_parser/kdl_parser.hpp>#include "robot_state_publisher/joint_state_listener.h"
Go to the source code of this file.
| Classes | |
| class | TestPublisher | 
| Macros | |
| #define | EPS 0.01 | 
| Functions | |
| int | main (int argc, char **argv) | 
| TEST_F (TestPublisher, test) | |
| #define EPS 0.01 | 
Definition at line 52 of file test_one_link.cpp.
| int main | ( | int | argc, | 
| char ** | argv | ||
| ) | 
Definition at line 99 of file test_one_link.cpp.
| TEST_F | ( | TestPublisher | , | 
| test | |||
| ) | 
Definition at line 70 of file test_one_link.cpp.