#include <string>
#include <vector>
#include <ros/ros.h>
#include <sensor_msgs/Range.h>
#include <vl53l1x/MeasurementData.h>
#include "vl53l1_api.h"
#include "i2c.h"
Go to the source code of this file.
|
int | main (int argc, char **argv) |
|
◆ CHECK_STATUS
#define CHECK_STATUS |
( |
|
func | ) |
|
Value:{ \
VL53L1_Error status = func; \
ROS_WARN(
"VL53L1X: Error %d on %s", status,
STR(func)); \
} \
}
#define VL53L1_ERROR_NONE
Definition at line 26 of file vl53l1x.cpp.
◆ STR
◆ xSTR
◆ main()
int main |
( |
int |
argc, |
|
|
char ** |
argv |
|
) |
| |