Public Member Functions | |
ConvertNode () | |
Private Member Functions | |
void | cbJointPosition (const ypspur_ros::JointPositionControl::ConstPtr &msg) |
void | cbJointState (const sensor_msgs::JointState::ConstPtr &msg) |
Private Attributes | |
double | accel_ |
ypspur_ros::JointPositionControl | cmd_prev |
ros::NodeHandle | nh_ |
ros::NodeHandle | pnh_ |
ros::Publisher | pub_joint_ |
bool | skip_same_ |
std::map< std::string, double > | state_ |
ros::Subscriber | sub_joint_ |
ros::Subscriber | sub_joint_state_ |
Definition at line 41 of file joint_position_to_joint_trajectory.cpp.
|
inline |
Definition at line 143 of file joint_position_to_joint_trajectory.cpp.
|
inlineprivate |
Definition at line 63 of file joint_position_to_joint_trajectory.cpp.
|
inlineprivate |
Definition at line 55 of file joint_position_to_joint_trajectory.cpp.
|
private |
Definition at line 52 of file joint_position_to_joint_trajectory.cpp.
|
private |
Definition at line 62 of file joint_position_to_joint_trajectory.cpp.
|
private |
Definition at line 44 of file joint_position_to_joint_trajectory.cpp.
|
private |
Definition at line 45 of file joint_position_to_joint_trajectory.cpp.
|
private |
Definition at line 48 of file joint_position_to_joint_trajectory.cpp.
|
private |
Definition at line 53 of file joint_position_to_joint_trajectory.cpp.
|
private |
Definition at line 50 of file joint_position_to_joint_trajectory.cpp.
|
private |
Definition at line 46 of file joint_position_to_joint_trajectory.cpp.
|
private |
Definition at line 47 of file joint_position_to_joint_trajectory.cpp.