#include <sensor_msgs/PointCloud2.h>
#include <dbw_mkz_msgs/SurroundReport.h>
Go to the source code of this file.
Namespaces | |
dbw_mkz_can | |
Functions | |
static void | dbw_mkz_can::sonarBuildPointCloud2 (sensor_msgs::PointCloud2 &cloud, const dbw_mkz_msgs::SurroundReport &surround) |
static uint32_t | dbw_mkz_can::sonarColorFromRange (float range) |
static float | dbw_mkz_can::sonarMetersFromBits (uint8_t bits) |
Variables | |
struct { | |
float dbw_mkz_can::a | |
float dbw_mkz_can::x | |
float dbw_mkz_can::y | |
float dbw_mkz_can::z | |
} | dbw_mkz_can::SONAR_TABLE [] |