#include <iostream>#include <sstream>#include "iwakishi.h"#include "log.h"#include <string>#include <csignal>#include <algorithm>#include <ncursesw/ncurses.h>#include <sys/time.h>#include <stdio.h>#include <stdlib.h>#include <getopt.h>#include <math.h>#include "ros/ros.h"#include "std_msgs/String.h"#include "iwaki/ActionMsg.h"#include "iwaki/AtomMsg.h"#include "iwaki/ActionStatusMsg.h"
Go to the source code of this file.
| Defines | |
| #define | KB_ENTER int('\n') | 
| Functions | |
| void | actionStatusCallback (const iwaki::ActionStatusMsg::ConstPtr &anActionStatusMsg_p) | 
| ActionStatus | convertActionStatusMsgToActionStatus (const iwaki::ActionStatusMsg &anActionStatusMsg) | 
| iwaki::ActionMsg | convertActionToActionMsg (Action &anAction) | 
| Atom | convertAtomMsgToAtom (const iwaki::AtomMsg &anAtomMsg) | 
| void | dispatchActionsFromOutputQueue (ros::Publisher &action_pub) | 
| void | inputAtomCallback (const iwaki::AtomMsg::ConstPtr &anAtomMsg_p) | 
| int | main (int argc, char **argv) | 
| string | makeSnippetFromAtom (Atom anAtom) | 
| void | publishAction (Action &anAction, ros::Publisher &action_pub) | 
| void | updateKbBuffer (string &kb_buffer, int ch) | 
| Variables | |
| InteractionManager | im | 
| TextUI | textUI | 
| #define KB_ENTER int('\n') | 
Definition at line 64 of file iwakishi.cpp.
| void actionStatusCallback | ( | const iwaki::ActionStatusMsg::ConstPtr & | anActionStatusMsg_p | ) | 
Definition at line 95 of file iwakishi.cpp.
| ActionStatus convertActionStatusMsgToActionStatus | ( | const iwaki::ActionStatusMsg & | anActionStatusMsg | ) | 
Definition at line 66 of file iwakishi.cpp.
| iwaki::ActionMsg convertActionToActionMsg | ( | Action & | anAction | ) | 
Definition at line 146 of file iwakishi.cpp.
| Atom convertAtomMsgToAtom | ( | const iwaki::AtomMsg & | anAtomMsg | ) | 
Definition at line 114 of file iwakishi.cpp.
| void dispatchActionsFromOutputQueue | ( | ros::Publisher & | action_pub | ) | 
Definition at line 219 of file iwakishi.cpp.
| void inputAtomCallback | ( | const iwaki::AtomMsg::ConstPtr & | anAtomMsg_p | ) | 
Definition at line 137 of file iwakishi.cpp.
| int main | ( | int | argc, | 
| char ** | argv | ||
| ) | 
| string makeSnippetFromAtom | ( | Atom | anAtom | ) | 
Definition at line 102 of file iwakishi.cpp.
| void publishAction | ( | Action & | anAction, | 
| ros::Publisher & | action_pub | ||
| ) | 
The publish() function is how you send messages. The parameter is the message object. The type of this object must agree with the type given as a template parameter to the advertise<>() call, as was done in the constructor above.
Definition at line 195 of file iwakishi.cpp.
| void updateKbBuffer | ( | string & | kb_buffer, | 
| int | ch | ||
| ) | 
Definition at line 239 of file iwakishi.cpp.
| InteractionManager im | 
GLOBALS
Definition at line 61 of file iwakishi.cpp.
Definition at line 62 of file iwakishi.cpp.