#include <stdio.h>#include <vector>#include <sstream>#include <algorithm>#include <ros/ros.h>#include "std_msgs/String.h"#include "std_msgs/UInt16.h"#include "Dictionary.cpp"
Go to the source code of this file.
| Enumerations | |
| enum | Command_id { SERIVCE_MODE_0 = 0, SERIVCE_MODE_2 = 1, SERIVCE_MODE_3 = 2, ACK_SERVICE = 3, STOP_SERVICE = 4, TALK_INTRO = 5, TALK_LIKE = 6, TALK_PLEASURE = 7, TALK_THANKS = 8 } | 
| Functions | |
| int | main (int argc, char **argv) | 
| void | speech_callback (const std_msgs::String::ConstPtr &msg) | 
| Variables | |
| ros::Publisher | cmd_pub | 
| Dictionary | dict | 
| enum Command_id | 
| SERIVCE_MODE_0 | |
| SERIVCE_MODE_2 | |
| SERIVCE_MODE_3 | |
| ACK_SERVICE | |
| STOP_SERVICE | |
| TALK_INTRO | |
| TALK_LIKE | |
| TALK_PLEASURE | |
| TALK_THANKS | 
Definition at line 35 of file command_matcher.cpp.
| int main | ( | int | argc, | 
| char ** | argv | ||
| ) | 
Definition at line 54 of file command_matcher.cpp.
| void speech_callback | ( | const std_msgs::String::ConstPtr & | msg | ) | 
Definition at line 96 of file command_matcher.cpp.
Definition at line 52 of file command_matcher.cpp.
Definition at line 46 of file command_matcher.cpp.