#include <stdio.h>#include <string.h>#include <sys/types.h>#include <errno.h>#include <sys/stat.h>#include <fcntl.h>#include <unistd.h>#include <termios.h>#include <stdlib.h>#include "time.h"#include <math.h>#include <ros/ros.h>#include <std_msgs/Bool.h>#include <std_msgs/Int32.h>#include <dlut_motor_hokuyo/motor.h>
Go to the source code of this file.
Classes | |
| class | SickMotor |
Defines | |
| #define | DEFAULT_ANGEL 720 |
| #define | DEFAULT_BAUDRATE 19200 |
| #define | DEFAULT_DIRECTION 0 |
| #define | DEFAULT_FRE 1000 |
| #define | DEFAULT_PORT 1 |
Functions | |
| int | main (int argc, char **argv) |
| #define DEFAULT_ANGEL 720 |
Definition at line 53 of file motor_hokuyo.cpp.
| #define DEFAULT_BAUDRATE 19200 |
Definition at line 50 of file motor_hokuyo.cpp.
| #define DEFAULT_DIRECTION 0 |
Definition at line 51 of file motor_hokuyo.cpp.
| #define DEFAULT_FRE 1000 |
Definition at line 52 of file motor_hokuyo.cpp.
| #define DEFAULT_PORT 1 |
Definition at line 49 of file motor_hokuyo.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 319 of file motor_hokuyo.cpp.