Classes | Namespaces | Macros
qnode.hpp File Reference

Communications central! More...

#include <ros/ros.h>
#include <string>
#include <QThread>
#include <QStringListModel>
#include <eigen3/Eigen/Eigen>
#include <std_msgs/String.h>
#include "robotis_controller_msgs/JointCtrlModule.h"
#include "robotis_controller_msgs/StatusMsg.h"
#include <manipulator_h_base_module_msgs/JointPose.h>
#include <manipulator_h_base_module_msgs/KinematicsPose.h>
#include <manipulator_h_base_module_msgs/GetJointPose.h>
#include <manipulator_h_base_module_msgs/GetKinematicsPose.h>
Include dependency graph for qnode.hpp:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Classes

class  manipulator_h_gui::QNode
 

Namespaces

 manipulator_h_gui
 

Macros

#define DEGREE2RADIAN   (M_PI / 180.0)
 
#define PRINT_MAT(X)   std::cout << #X << ":\n" << X << std::endl << std::endl
 
#define RADIAN2DEGREE   (180.0 / M_PI)
 

Detailed Description

Communications central!

Date
February 2011

Definition in file qnode.hpp.

Macro Definition Documentation

#define DEGREE2RADIAN   (M_PI / 180.0)

Definition at line 57 of file qnode.hpp.

#define PRINT_MAT (   X)    std::cout << #X << ":\n" << X << std::endl << std::endl

Definition at line 60 of file qnode.hpp.

#define RADIAN2DEGREE   (180.0 / M_PI)

Definition at line 58 of file qnode.hpp.



manipulator_h_gui
Author(s): SCH
autogenerated on Mon Jun 10 2019 14:02:56