Go to the documentation of this file.
26 #ifndef OMRON_OS32C_DRIVER_OS32C_H
27 #define OMRON_OS32C_DRIVER_OS32C_H
29 #include <gtest/gtest_prod.h>
32 #include <boost/shared_ptr.hpp>
33 #include <sensor_msgs/LaserScan.h>
43 using sensor_msgs::LaserScan;
47 #define DEG2RAD(a) (a * M_PI / 180)
48 #define RAD2DEG(a) (a * 180 / M_PI)
137 void selectBeams(
double start_angle,
double end_angle);
231 #endif // OMRON_OS32C_DRIVER_OS32C_H
static const double ANGLE_INC
EIP_UINT getReflectivityFormat()
@ REFLECTIVITY_MEASURE_TOT_4PS
MeasurementReportConfig mrc_
EIP_UINT getRangeFormat()
@ RANGE_MEASURE_16M_WZ1PZ
FRIEND_TEST(OS32CTest, test_calc_beam_mask_all)
MeasurementReport receiveMeasurementReportUDP()
void closeActiveConnection()
static const double DISTANCE_MAX
EIP_UDINT mrc_sequence_num_
static void convertToLaserScan(const RangeAndReflectanceMeasurement &rr, sensor_msgs::LaserScan *ls)
OS32C_REFLECTIVITY_FORMAT
RangeAndReflectanceMeasurement getSingleRRScan()
@ RANGE_MEASURE_8M_WZ2WZ1PZ
OS32C(shared_ptr< Socket > socket, shared_ptr< Socket > io_socket)
static double calcBeamCentre(int beam_num)
void setReflectivityFormat(EIP_UINT format)
void sendMeasurmentReportConfigUDP()
static const double ANGLE_MIN
static int calcBeamNumber(double angle)
static const double DISTANCE_MIN
void selectBeams(double start_angle, double end_angle)
@ REFLECTIVITY_MEASURE_TOT_ENCODED
void setRangeFormat(EIP_UINT format)
void calcBeamMask(double start_angle, double end_angle, EIP_BYTE mask[])
static const double ANGLE_MAX
void fillLaserScanStaticConfig(sensor_msgs::LaserScan *ls)