28 #ifndef manipulator_h_gui_QNODE_HPP_ 29 #define manipulator_h_gui_QNODE_HPP_ 40 #include <QStringListModel> 42 #include <eigen3/Eigen/Eigen> 44 #include <std_msgs/String.h> 46 #include "robotis_controller_msgs/JointCtrlModule.h" 47 #include "robotis_controller_msgs/StatusMsg.h" 49 #include <manipulator_h_base_module_msgs/JointPose.h> 50 #include <manipulator_h_base_module_msgs/KinematicsPose.h> 52 #include <manipulator_h_base_module_msgs/GetJointPose.h> 53 #include <manipulator_h_base_module_msgs/GetKinematicsPose.h> 57 #define DEGREE2RADIAN (M_PI / 180.0) 58 #define RADIAN2DEGREE (180.0 / M_PI) 60 #define PRINT_MAT(X) std::cout << #X << ":\n" << X << std::endl << std::endl 77 QNode(
int argc,
char** argv);
94 void log(
const LogLevel &level,
const std::string &msg, std::string sender =
"GUI");
104 void getJointPose( std::vector<std::string> joint_name );
void sendSetModeMsg(std_msgs::String msg)
void sendJointPoseMsg(manipulator_h_base_module_msgs::JointPose msg)
ros::Publisher set_mode_msg_pub_
void getKinematicsPose(std::string group_name)
void getJointPose(std::vector< std::string > joint_name)
QStringListModel logging_model_
void sendKinematicsPoseMsg(manipulator_h_base_module_msgs::KinematicsPose msg)
ros::Publisher chatter_publisher_
ros::Subscriber status_msg_sub_
ros::Publisher ini_pose_msg_pub_
QStringListModel * loggingModel()
QNode(int argc, char **argv)
void statusMsgCallback(const robotis_controller_msgs::StatusMsg::ConstPtr &msg)
void updateCurrentKinematicsPose(manipulator_h_base_module_msgs::KinematicsPose)
ros::Publisher kinematics_pose_msg_pub_
ros::Publisher joint_pose_msg_pub_
ros::ServiceClient get_kinematics_pose_client_
void log(const LogLevel &level, const std::string &msg, std::string sender="GUI")
ros::ServiceClient get_joint_pose_client_
void sendIniPoseMsg(std_msgs::String msg)
void updateCurrentJointPose(manipulator_h_base_module_msgs::JointPose)