#include <gtest/gtest.h>#include <gmock/gmock.h>#include <ros/ros.h>#include <tf2_ros/buffer.h>#include <tf2_ros/transform_listener.h>#include <tf2_ros/transform_broadcaster.h>#include <sensor_msgs/Range.h>#include <string>#include "move_basic/obstacle_points.h"
Go to the source code of this file.
Classes | |
| class | ObstaclePointsTests |
Functions | |
| int | main (int argc, char **argv) |
| TEST_F (ObstaclePointsTests, noSensors) | |
| TEST_F (ObstaclePointsTests, testPoints) | |
| TEST_F (ObstaclePointsTests, singleSonar) | |
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 154 of file test_obstacle_points.cpp.
| TEST_F | ( | ObstaclePointsTests | , |
| noSensors | |||
| ) |
Definition at line 72 of file test_obstacle_points.cpp.
| TEST_F | ( | ObstaclePointsTests | , |
| testPoints | |||
| ) |
Definition at line 79 of file test_obstacle_points.cpp.
| TEST_F | ( | ObstaclePointsTests | , |
| singleSonar | |||
| ) |
Definition at line 102 of file test_obstacle_points.cpp.