|
Easy Navigation
|
#include "sensor_msgs/msg/laser_scan.hpp"#include "sensor_msgs/msg/image.hpp"#include "sensor_msgs/msg/point_cloud2.hpp"#include "std_msgs/msg/string.hpp"#include "rclcpp_lifecycle/lifecycle_node.hpp"#include "easynav_common/types/Perceptions.hpp"#include "easynav_common/types/PointPerception.hpp"#include "easynav_common/types/ImagePerception.hpp"#include "tf2_ros/transform_listener.hpp"#include "easynav_common/RTTFBuffer.hpp"#include "pcl/point_types.h"#include "pcl_conversions/pcl_conversions.h"#include "gtest/gtest.h"
Classes | |
| class | DummyHandler |
| class | DummyPerception |
| class | PerceptionsTestCase |
| class | TestPointPerception |
Functions | |
| sensor_msgs::msg::PointCloud2 | get_pc2_test_0 (rclcpp::Time ts) |
| sensor_msgs::msg::PointCloud2 | get_pc2_test_1 (rclcpp::Time ts) |
| sensor_msgs::msg::PointCloud2 | get_pc2_test_2 (rclcpp::Time ts) |
| sensor_msgs::msg::PointCloud2 | get_pc2_test_3 (rclcpp::Time ts) |
| sensor_msgs::msg::PointCloud2 | get_pc2_test_4 (rclcpp::Time ts) |
| sensor_msgs::msg::LaserScan | get_scan_test_1 (rclcpp::Time ts) |
| sensor_msgs::msg::LaserScan | get_scan_test_2 (rclcpp::Time ts) |
| sensor_msgs::msg::LaserScan | get_scan_test_3 (rclcpp::Time ts) |
| sensor_msgs::msg::LaserScan | get_scan_test_4 (rclcpp::Time ts) |
| TEST_F (PerceptionsTestCase, CustomPerceptionHandlerCanBeRegistered) | |
| TEST_F (PerceptionsTestCase, ImagePerceptionHandlerWorks) | |
| TEST_F (PerceptionsTestCase, PointPerceptionBufferAndTFWorks) | |
| TEST_F (PerceptionsTestCase, PointPerceptionHandlerPC2Works) | |
| TEST_F (PerceptionsTestCase, PointPerceptionHandlerWorks) | |
| sensor_msgs::msg::PointCloud2 get_pc2_test_0 | ( | rclcpp::Time | ts | ) |
| sensor_msgs::msg::PointCloud2 get_pc2_test_1 | ( | rclcpp::Time | ts | ) |
| sensor_msgs::msg::PointCloud2 get_pc2_test_2 | ( | rclcpp::Time | ts | ) |
| sensor_msgs::msg::PointCloud2 get_pc2_test_3 | ( | rclcpp::Time | ts | ) |
| sensor_msgs::msg::PointCloud2 get_pc2_test_4 | ( | rclcpp::Time | ts | ) |
| sensor_msgs::msg::LaserScan get_scan_test_1 | ( | rclcpp::Time | ts | ) |
| sensor_msgs::msg::LaserScan get_scan_test_2 | ( | rclcpp::Time | ts | ) |
| sensor_msgs::msg::LaserScan get_scan_test_3 | ( | rclcpp::Time | ts | ) |
| sensor_msgs::msg::LaserScan get_scan_test_4 | ( | rclcpp::Time | ts | ) |
| TEST_F | ( | PerceptionsTestCase | , |
| CustomPerceptionHandlerCanBeRegistered | ) |
| TEST_F | ( | PerceptionsTestCase | , |
| ImagePerceptionHandlerWorks | ) |
| TEST_F | ( | PerceptionsTestCase | , |
| PointPerceptionBufferAndTFWorks | ) |
| TEST_F | ( | PerceptionsTestCase | , |
| PointPerceptionHandlerPC2Works | ) |
| TEST_F | ( | PerceptionsTestCase | , |
| PointPerceptionHandlerWorks | ) |