Public Member Functions | Protected Attributes | List of all members
jog_frame::JogFrameNode Class Reference

#include <jog_frame_node.h>

Public Member Functions

int get_controller_list ()
 
void jog_frame_cb (jog_msgs::JogFrameConstPtr msg)
 Callback function for the topic jog_frame. More...
 
 JogFrameNode ()
 
void joint_state_cb (sensor_msgs::JointStateConstPtr msg)
 Callback function for the topic joint_state. More...
 

Protected Attributes

std::map< std::string, Controllercinfo_map_
 
std::vector< std::string > exclude_joints_
 
ros::ServiceClient fk_client_
 
std::string group_name_
 
ros::ServiceClient ik_client_
 
bool intermittent_
 
ros::Subscriber jog_frame_sub_
 
std::map< std::string, double > joint_map_
 
sensor_msgs::JointState joint_state_
 
ros::Subscriber joint_state_sub_
 
ros::Time last_stamp_
 
geometry_msgs::PoseStamped pose_stamped_
 
std::string target_link_
 
double time_from_start_
 
std::map< std::string, TrajClient * > traj_clients_
 
std::map< std::string, ros::Publishertraj_pubs_
 
bool use_action_
 

Detailed Description

Class JogFrameNode - Provides the jog_frame

Definition at line 35 of file jog_frame_node.h.

Constructor & Destructor Documentation

jog_frame::JogFrameNode::JogFrameNode ( )

: Default constructor for JogFrameNode Class.

Definition at line 76 of file jog_frame_node.cpp.

Member Function Documentation

int jog_frame::JogFrameNode::get_controller_list ( )

Definition at line 6 of file jog_frame_node.cpp.

void jog_frame::JogFrameNode::jog_frame_cb ( jog_msgs::JogFrameConstPtr  msg)

Callback function for the topic jog_frame.

Definition at line 161 of file jog_frame_node.cpp.

void jog_frame::JogFrameNode::joint_state_cb ( sensor_msgs::JointStateConstPtr  msg)

Callback function for the topic joint_state.

Definition at line 379 of file jog_frame_node.cpp.

Member Data Documentation

std::map<std::string, Controller> jog_frame::JogFrameNode::cinfo_map_
protected

Definition at line 50 of file jog_frame_node.h.

std::vector<std::string> jog_frame::JogFrameNode::exclude_joints_
protected

Definition at line 63 of file jog_frame_node.h.

ros::ServiceClient jog_frame::JogFrameNode::fk_client_
protected

Definition at line 48 of file jog_frame_node.h.

std::string jog_frame::JogFrameNode::group_name_
protected

Definition at line 62 of file jog_frame_node.h.

ros::ServiceClient jog_frame::JogFrameNode::ik_client_
protected

Definition at line 48 of file jog_frame_node.h.

bool jog_frame::JogFrameNode::intermittent_
protected

Definition at line 59 of file jog_frame_node.h.

ros::Subscriber jog_frame::JogFrameNode::jog_frame_sub_
protected

Definition at line 47 of file jog_frame_node.h.

std::map<std::string, double> jog_frame::JogFrameNode::joint_map_
protected

Definition at line 54 of file jog_frame_node.h.

sensor_msgs::JointState jog_frame::JogFrameNode::joint_state_
protected

Definition at line 64 of file jog_frame_node.h.

ros::Subscriber jog_frame::JogFrameNode::joint_state_sub_
protected

Definition at line 47 of file jog_frame_node.h.

ros::Time jog_frame::JogFrameNode::last_stamp_
protected

Definition at line 65 of file jog_frame_node.h.

geometry_msgs::PoseStamped jog_frame::JogFrameNode::pose_stamped_
protected

Definition at line 55 of file jog_frame_node.h.

std::string jog_frame::JogFrameNode::target_link_
protected

Definition at line 61 of file jog_frame_node.h.

double jog_frame::JogFrameNode::time_from_start_
protected

Definition at line 57 of file jog_frame_node.h.

std::map<std::string, TrajClient*> jog_frame::JogFrameNode::traj_clients_
protected

Definition at line 51 of file jog_frame_node.h.

std::map<std::string,ros::Publisher> jog_frame::JogFrameNode::traj_pubs_
protected

Definition at line 52 of file jog_frame_node.h.

bool jog_frame::JogFrameNode::use_action_
protected

Definition at line 58 of file jog_frame_node.h.


The documentation for this class was generated from the following files:


jog_controller
Author(s): Ryosuke Tajima
autogenerated on Sun May 17 2020 03:25:01