#include <joint_operator.h>
Public Member Functions | |
| bool | getTrajectoryInfo (const std::string yaml_file, trajectory_msgs::JointTrajectory *jnt_tra_msg) |
| bool | isLoop (void) |
| JointOperator () | |
| bool | moveCommandMsgCallback (std_srvs::Trigger::Request &req, std_srvs::Trigger::Response &res) |
| ~JointOperator () | |
Private Attributes | |
| bool | is_loop_ |
| trajectory_msgs::JointTrajectory * | jnt_tra_msg_ |
| ros::Publisher | joint_trajectory_pub_ |
| ros::ServiceServer | move_command_server_ |
| ros::NodeHandle | node_handle_ |
| ros::NodeHandle | priv_node_handle_ |
Definition at line 30 of file joint_operator.h.
| JointOperator::JointOperator | ( | ) |
Definition at line 21 of file joint_operator.cpp.
| JointOperator::~JointOperator | ( | ) |
Definition at line 42 of file joint_operator.cpp.
| bool JointOperator::getTrajectoryInfo | ( | const std::string | yaml_file, |
| trajectory_msgs::JointTrajectory * | jnt_tra_msg | ||
| ) |
Definition at line 46 of file joint_operator.cpp.
|
inline |
Definition at line 56 of file joint_operator.h.
| bool JointOperator::moveCommandMsgCallback | ( | std_srvs::Trigger::Request & | req, |
| std_srvs::Trigger::Response & | res | ||
| ) |
Definition at line 101 of file joint_operator.cpp.
|
private |
Definition at line 50 of file joint_operator.h.
|
private |
Definition at line 49 of file joint_operator.h.
|
private |
Definition at line 40 of file joint_operator.h.
|
private |
Definition at line 45 of file joint_operator.h.
|
private |
Definition at line 34 of file joint_operator.h.
|
private |
Definition at line 35 of file joint_operator.h.