#include <ros/ros.h>#include <geometry_msgs/Twist.h>#include <cmath>#include <sstream>#include <espeak/speak_lib.h>
Go to the source code of this file.
Functions | |
| void | cmd_vel_cback (const geometry_msgs::Twist::ConstPtr &msg) |
| int | main (int argc, char **argv) |
| void | speak () |
Variables | |
| bool | beep = false |
| int | buff_len = 500 |
| int | options = 0 |
| unsigned int * | unique_identifier |
| void * | user_data |
| void cmd_vel_cback | ( | const geometry_msgs::Twist::ConstPtr & | msg | ) |
Definition at line 23 of file carl_speed_speak.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 42 of file carl_speed_speak.cpp.
| void speak | ( | ) |
Definition at line 13 of file carl_speed_speak.cpp.
| bool beep = false |
Definition at line 11 of file carl_speed_speak.cpp.
| int buff_len = 500 |
Definition at line 7 of file carl_speed_speak.cpp.
| int options = 0 |
Definition at line 8 of file carl_speed_speak.cpp.
| unsigned int* unique_identifier |
Definition at line 9 of file carl_speed_speak.cpp.
| void* user_data |
Definition at line 10 of file carl_speed_speak.cpp.