#include "ros/xbot_talker_ros.h"
#include <geometry_msgs/Twist.h>
#include <std_msgs/Bool.h>
#include <std_msgs/Empty.h>
#include <std_msgs/String.h>
#include <thread>
#include "common_config.h"
#include "asr/xunfei/xfei_speech_recog.h"
Go to the source code of this file.