scenario_simulator_v2 C++ API
Protected Member Functions | Protected Attributes | List of all members
LidarSensorTest Class Reference

#include <test_lidar_sensor.hpp>

Inheritance diagram for LidarSensorTest:
Inheritance graph
[legend]
Collaboration diagram for LidarSensorTest:
Collaboration graph
[legend]

Protected Member Functions

 LidarSensorTest ()
 
 ~LidarSensorTest ()
 

Protected Attributes

rclcpp::Node::SharedPtr node_
 
rclcpp::Publisher< sensor_msgs::msg::PointCloud2 >::SharedPtr publisher_
 
rclcpp::Subscription< sensor_msgs::msg::PointCloud2 >::SharedPtr subscription_
 
std::vector< EntityStatusstatus_
 
std::unique_ptr< LidarSensorBaselidar_
 
simulation_api_schema::LidarConfiguration config_
 
sensor_msgs::msg::PointCloud2::SharedPtr received_msg_
 
double current_simulation_time_ {1.0}
 
rclcpp::Time current_ros_time_ {1}
 

Constructor & Destructor Documentation

◆ LidarSensorTest()

LidarSensorTest::LidarSensorTest ( )
inlineprotected

◆ ~LidarSensorTest()

LidarSensorTest::~LidarSensorTest ( )
inlineprotected

Member Data Documentation

◆ config_

simulation_api_schema::LidarConfiguration LidarSensorTest::config_
protected

◆ current_ros_time_

rclcpp::Time LidarSensorTest::current_ros_time_ {1}
protected

◆ current_simulation_time_

double LidarSensorTest::current_simulation_time_ {1.0}
protected

◆ lidar_

std::unique_ptr<LidarSensorBase> LidarSensorTest::lidar_
protected

◆ node_

rclcpp::Node::SharedPtr LidarSensorTest::node_
protected

◆ publisher_

rclcpp::Publisher<sensor_msgs::msg::PointCloud2>::SharedPtr LidarSensorTest::publisher_
protected

◆ received_msg_

sensor_msgs::msg::PointCloud2::SharedPtr LidarSensorTest::received_msg_
protected

◆ status_

std::vector<EntityStatus> LidarSensorTest::status_
protected

◆ subscription_

rclcpp::Subscription<sensor_msgs::msg::PointCloud2>::SharedPtr LidarSensorTest::subscription_
protected

The documentation for this class was generated from the following file: