#include <ros/ros.h>#include <std_msgs/String.h>#include <vision_msgs/cop_answer.h>#include <nav_pcontroller/nav_actionActionGoal.h>#include <boost/thread.hpp>
Go to the source code of this file.
| Functions | |
| int | main (int argc, char *argv[]) | 
| void | speakCallback (const std_msgs::String::ConstPtr &st) | 
| void | speakCopCallback (const vision_msgs::cop_answer::ConstPtr &answer) | 
| void | speakNavCallback (const nav_pcontroller::nav_actionActionGoal::ConstPtr &answer) | 
| Variables | |
| boost::mutex | mutex | 
| int main | ( | int | argc, | 
| char * | argv[] | ||
| ) | 
Definition at line 138 of file espeak.cpp.
| void speakCallback | ( | const std_msgs::String::ConstPtr & | st | ) | 
Definition at line 42 of file espeak.cpp.
| void speakCopCallback | ( | const vision_msgs::cop_answer::ConstPtr & | answer | ) | 
Definition at line 54 of file espeak.cpp.
| void speakNavCallback | ( | const nav_pcontroller::nav_actionActionGoal::ConstPtr & | answer | ) | 
Definition at line 91 of file espeak.cpp.
Definition at line 39 of file espeak.cpp.