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>
Go to the source code of this file.
Communications central!
- Date
- February 2011
Definition in file qnode.hpp.
#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) |