23 #ifndef TURTLEBOT3_MANIPULATION_GUI_QNODE_HPP_ 24 #define TURTLEBOT3_MANIPULATION_GUI_QNODE_HPP_ 37 #include <QStringListModel> 38 #include <eigen3/Eigen/Eigen> 40 #include <geometry_msgs/Pose.h> 41 #include <sensor_msgs/JointState.h> 42 #include <std_msgs/String.h> 52 #include <moveit_msgs/DisplayTrajectory.h> 53 #include <moveit_msgs/ExecuteTrajectoryActionGoal.h> 54 #include <moveit_msgs/MoveGroupActionGoal.h> 70 QNode(
int argc,
char** argv );
87 void log(
const LogLevel &level,
const std::string &msg);
95 bool setTaskSpacePath(std::vector<double> kinematics_pose,
double path_time);
QStringListModel logging_model
bool setToolControl(std::vector< double > joint_angle)
moveit::planning_interface::MoveGroupInterface * move_group2_
void log(const LogLevel &level, const std::string &msg)
std::vector< double > present_kinematics_position_
std::vector< double > getPresentKinematicsPosition()
std::vector< double > present_joint_angle_
moveit::planning_interface::MoveGroupInterface * move_group_
std::vector< double > getPresentJointAngle()
bool setTaskSpacePath(std::vector< double > kinematics_pose, double path_time)
bool setJointSpacePath(std::vector< double > joint_angle, double path_time)
QStringListModel * loggingModel()
QNode(int argc, char **argv)