#include "ros/ros.h"
#include "sensor_msgs/LaserScan.h"
#include "std_srvs/Empty.h"
#include "sl_lidar.h"
Go to the source code of this file.
|
bool | checkRPLIDARHealth (ILidarDriver *drv) |
|
static float | getAngle (const sl_lidar_response_measurement_node_hq_t &node) |
|
bool | getRPLIDARDeviceInfo (ILidarDriver *drv) |
|
int | main (int argc, char *argv[]) |
|
void | publish_scan (ros::Publisher *pub, sl_lidar_response_measurement_node_hq_t *nodes, size_t node_count, ros::Time start, double scan_time, bool inverted, float angle_min, float angle_max, float max_distance, std::string frame_id) |
|
bool | resetRPLIDAR (ILidarDriver *drv) |
|
bool | start_motor (std_srvs::Empty::Request &req, std_srvs::Empty::Response &res) |
|
bool | stop_motor (std_srvs::Empty::Request &req, std_srvs::Empty::Response &res) |
|
◆ _countof
#define _countof |
( |
|
_Array | ) |
(int)(sizeof(_Array) / sizeof(_Array[0])) |
◆ DEG2RAD
#define DEG2RAD |
( |
|
x | ) |
((x)*M_PI/180.) |
◆ RESET_TIMEOUT
◆ anonymous enum
Enumerator |
---|
LIDAR_A_SERIES_MINUM_MAJOR_ID | |
LIDAR_S_SERIES_MINUM_MAJOR_ID | |
LIDAR_T_SERIES_MINUM_MAJOR_ID | |
Definition at line 47 of file node.cpp.
◆ checkRPLIDARHealth()
◆ getAngle()
◆ getRPLIDARDeviceInfo()
◆ main()
int main |
( |
int |
argc, |
|
|
char * |
argv[] |
|
) |
| |
◆ publish_scan()
◆ resetRPLIDAR()
◆ start_motor()
bool start_motor |
( |
std_srvs::Empty::Request & |
req, |
|
|
std_srvs::Empty::Response & |
res |
|
) |
| |
◆ stop_motor()
bool stop_motor |
( |
std_srvs::Empty::Request & |
req, |
|
|
std_srvs::Empty::Response & |
res |
|
) |
| |
◆ drv