Public Member Functions | |
| int | comInit () |
| void | delayms (long int i) |
| int | getPulseNum (int _degree) |
| int | openPort (int fd_, int comport) |
| int | setOpt (int fd_, int nspeed, int nbits, char nevent, int nstop) |
| SickMotor () | |
| void | sickMotorCallBack (const std_msgs::Bool &is_run) |
| ~SickMotor () | |
Public Attributes | |
| std_msgs::Bool | is_motor_run_ |
| ros::Subscriber | is_motor_run_sub_ |
| char | motor_dir_ |
| ros::Publisher | motor_pub_ |
| ros::NodeHandle | sick_motor_nh_ |
Private Attributes | |
| int | baudrate_ |
| char | command_buff_ [30] |
| int | fd_ |
| int | nwrite_ |
| int | port_ |
Definition at line 56 of file motor_hokuyo.cpp.
Definition at line 84 of file motor_hokuyo.cpp.
Definition at line 95 of file motor_hokuyo.cpp.
| int SickMotor::comInit | ( | ) |
Definition at line 282 of file motor_hokuyo.cpp.
| void SickMotor::delayms | ( | long int | i | ) |
Definition at line 277 of file motor_hokuyo.cpp.
| int SickMotor::getPulseNum | ( | int | _degree | ) |
Definition at line 258 of file motor_hokuyo.cpp.
| int SickMotor::openPort | ( | int | fd_, |
| int | comport | ||
| ) |
Definition at line 101 of file motor_hokuyo.cpp.
| int SickMotor::setOpt | ( | int | fd_, |
| int | nspeed, | ||
| int | nbits, | ||
| char | nevent, | ||
| int | nstop | ||
| ) |
Definition at line 149 of file motor_hokuyo.cpp.
| void SickMotor::sickMotorCallBack | ( | const std_msgs::Bool & | is_run | ) |
Definition at line 303 of file motor_hokuyo.cpp.
int SickMotor::baudrate_ [private] |
Definition at line 77 of file motor_hokuyo.cpp.
char SickMotor::command_buff_[30] [private] |
Definition at line 81 of file motor_hokuyo.cpp.
int SickMotor::fd_ [private] |
Definition at line 78 of file motor_hokuyo.cpp.
| std_msgs::Bool SickMotor::is_motor_run_ |
Definition at line 72 of file motor_hokuyo.cpp.
| ros::Subscriber SickMotor::is_motor_run_sub_ |
Definition at line 74 of file motor_hokuyo.cpp.
Definition at line 70 of file motor_hokuyo.cpp.
| ros::Publisher SickMotor::motor_pub_ |
Definition at line 75 of file motor_hokuyo.cpp.
int SickMotor::nwrite_ [private] |
Definition at line 79 of file motor_hokuyo.cpp.
int SickMotor::port_ [private] |
Definition at line 77 of file motor_hokuyo.cpp.
| ros::NodeHandle SickMotor::sick_motor_nh_ |
Definition at line 69 of file motor_hokuyo.cpp.