#include <open_manipulator_teleop_joystick.h>
◆ OpenManipulatorTeleop() [1/2]
| OpenManipulatorTeleop::OpenManipulatorTeleop |
( |
| ) |
|
◆ ~OpenManipulatorTeleop() [1/2]
| OpenManipulatorTeleop::~OpenManipulatorTeleop |
( |
| ) |
|
◆ OpenManipulatorTeleop() [2/2]
| OpenManipulatorTeleop::OpenManipulatorTeleop |
( |
| ) |
|
◆ ~OpenManipulatorTeleop() [2/2]
| OpenManipulatorTeleop::~OpenManipulatorTeleop |
( |
| ) |
|
◆ disableWaitingForEnter()
| void OpenManipulatorTeleop::disableWaitingForEnter |
( |
void |
| ) |
|
|
private |
◆ getPresentJointAngle()
| std::vector< double > OpenManipulatorTeleop::getPresentJointAngle |
( |
| ) |
|
|
private |
◆ getPresentKinematicsPose()
| std::vector< double > OpenManipulatorTeleop::getPresentKinematicsPose |
( |
| ) |
|
|
private |
◆ initClient() [1/2]
| void OpenManipulatorTeleop::initClient |
( |
| ) |
|
|
private |
◆ initClient() [2/2]
| void OpenManipulatorTeleop::initClient |
( |
| ) |
|
|
private |
◆ initSubscriber() [1/2]
| void OpenManipulatorTeleop::initSubscriber |
( |
| ) |
|
|
private |
◆ initSubscriber() [2/2]
| void OpenManipulatorTeleop::initSubscriber |
( |
| ) |
|
|
private |
◆ jointStatesCallback() [1/2]
| void OpenManipulatorTeleop::jointStatesCallback |
( |
const sensor_msgs::JointState::ConstPtr & |
msg | ) |
|
|
private |
◆ jointStatesCallback() [2/2]
| void OpenManipulatorTeleop::jointStatesCallback |
( |
const sensor_msgs::JointState::ConstPtr & |
msg | ) |
|
|
private |
◆ joyCallback()
| void OpenManipulatorTeleop::joyCallback |
( |
const sensor_msgs::Joy::ConstPtr & |
msg | ) |
|
|
private |
◆ kinematicsPoseCallback() [1/2]
| void OpenManipulatorTeleop::kinematicsPoseCallback |
( |
const open_manipulator_msgs::KinematicsPose::ConstPtr & |
msg | ) |
|
|
private |
◆ kinematicsPoseCallback() [2/2]
| void OpenManipulatorTeleop::kinematicsPoseCallback |
( |
const open_manipulator_msgs::KinematicsPose::ConstPtr & |
msg | ) |
|
|
private |
◆ printText()
| void OpenManipulatorTeleop::printText |
( |
| ) |
|
◆ restoreTerminalSettings()
| void OpenManipulatorTeleop::restoreTerminalSettings |
( |
void |
| ) |
|
|
private |
◆ setGoal() [1/2]
| void OpenManipulatorTeleop::setGoal |
( |
char |
ch | ) |
|
◆ setGoal() [2/2]
| void OpenManipulatorTeleop::setGoal |
( |
const char * |
str | ) |
|
|
private |
◆ setJointSpacePath() [1/2]
| bool OpenManipulatorTeleop::setJointSpacePath |
( |
std::vector< std::string > |
joint_name, |
|
|
std::vector< double > |
joint_angle, |
|
|
double |
path_time |
|
) |
| |
|
private |
◆ setJointSpacePath() [2/2]
| bool OpenManipulatorTeleop::setJointSpacePath |
( |
std::vector< std::string > |
joint_name, |
|
|
std::vector< double > |
joint_angle, |
|
|
double |
path_time |
|
) |
| |
|
private |
◆ setJointSpacePathFromPresent()
| bool OpenManipulatorTeleop::setJointSpacePathFromPresent |
( |
std::vector< std::string > |
joint_name, |
|
|
std::vector< double > |
joint_angle, |
|
|
double |
path_time |
|
) |
| |
|
private |
◆ setTaskSpacePathFromPresentPositionOnly() [1/2]
| bool OpenManipulatorTeleop::setTaskSpacePathFromPresentPositionOnly |
( |
std::vector< double > |
kinematics_pose, |
|
|
double |
path_time |
|
) |
| |
|
private |
◆ setTaskSpacePathFromPresentPositionOnly() [2/2]
| bool OpenManipulatorTeleop::setTaskSpacePathFromPresentPositionOnly |
( |
std::vector< double > |
kinematics_pose, |
|
|
double |
path_time |
|
) |
| |
|
private |
◆ setToolControl() [1/2]
| bool OpenManipulatorTeleop::setToolControl |
( |
std::vector< double > |
joint_angle | ) |
|
|
private |
◆ setToolControl() [2/2]
| bool OpenManipulatorTeleop::setToolControl |
( |
std::vector< double > |
joint_angle | ) |
|
|
private |
◆ goal_joint_space_path_client_
◆ goal_joint_space_path_from_present_client_
◆ goal_task_space_path_from_present_position_only_client_
| ros::ServiceClient OpenManipulatorTeleop::goal_task_space_path_from_present_position_only_client_ |
|
private |
◆ goal_tool_control_client_
◆ joint_states_sub_
◆ joy_command_sub_
◆ kinematics_pose_sub_
◆ node_handle_
◆ oldt_
| struct termios OpenManipulatorTeleop::oldt_ |
|
private |
◆ present_joint_angle_
| std::vector< double > OpenManipulatorTeleop::present_joint_angle_ |
|
private |
◆ present_kinematic_position_
| std::vector< double > OpenManipulatorTeleop::present_kinematic_position_ |
|
private |
◆ priv_node_handle_
The documentation for this class was generated from the following files: