Communications central! More...
#include <ros/ros.h>
#include <sensor_msgs/JointState.h>
#include <actionlib/client/simple_action_client.h>
#include <actionlib/client/terminal_state.h>
#include <control_msgs/FollowJointTrajectoryAction.h>
#include <string>
#include <QThread>
#include <QStringListModel>
#include "mutex.h"
#include "eventserver.h"
#include "motion_sequence.h"
Go to the source code of this file.
Classes | |
class | tibi_dabo_sequence_editor::QNode |
struct | tibi_dabo_sequence_editor::TSeqClient |
Namespaces | |
namespace | tibi_dabo_sequence_editor |
Typedefs | |
typedef actionlib::SimpleActionClient < control_msgs::FollowJointTrajectoryAction > | tibi_dabo_sequence_editor::SeqClient |