#include <cob_hand_bridge/InitFinger.h>#include <cob_hand_bridge/Status.h>#include <std_srvs/Trigger.h>#include <sensor_msgs/JointState.h>#include <control_msgs/FollowJointTrajectoryAction.h>#include <diagnostic_updater/publisher.h>#include <actionlib/server/simple_action_server.h>#include <ros/ros.h>#include <boost/thread/mutex.hpp>#include <boost/shared_ptr.hpp>#include <boost/scoped_ptr.hpp>#include <angles/angles.h>
Go to the source code of this file.
Typedefs | |
| typedef actionlib::SimpleActionServer< control_msgs::FollowJointTrajectoryAction > | FollowJointTrajectoryActionServer |
Functions | |
| void | callHalt () |
| void | cancelCB () |
| bool | checkAction_nolock (bool deadline_exceeded) |
| void | goalCB () |
| void | handleDeadline (const ros::TimerEvent &) |
| bool | initCallback (std_srvs::Trigger::Request &req, std_srvs::Trigger::Response &res) |
| bool | isFingerReady_nolock () |
| int | main (int argc, char *argv[]) |
| void | reportDiagnostics (diagnostic_updater::DiagnosticStatusWrapper &stat) |
| void | resendCommand (const ros::TimerEvent &e) |
| void | statusCallback (const cob_hand_bridge::Status::ConstPtr &msg) |
Variables | |
| boost::scoped_ptr< FollowJointTrajectoryActionServer > | g_as |
| cob_hand_bridge::JointValues | g_command |
| ros::Publisher | g_command_pub |
| ros::Timer | g_command_timer |
| bool | g_control_stopped |
| ros::Timer | g_deadline_timer |
| cob_hand_bridge::JointValues | g_default_command |
| control_msgs::FollowJointTrajectoryGoalConstPtr | g_goal |
| std::vector< double > | g_goal_tolerance |
| ros::ServiceClient | g_halt_client |
| ros::ServiceClient | g_init_finger_client |
| ros::ServiceServer | g_init_srv |
| bool | g_initialized |
| sensor_msgs::JointState | g_js |
| ros::Publisher | g_js_pub |
| bool | g_motion_stopped |
| bool | g_motors_moved |
| boost::mutex | g_mutex |
| cob_hand_bridge::Status::ConstPtr | g_status |
| double | g_stopped_current |
| double | g_stopped_velocity |
| boost::shared_ptr< diagnostic_updater::TimeStampStatus > | g_topic_status |
| typedef actionlib::SimpleActionServer<control_msgs::FollowJointTrajectoryAction> FollowJointTrajectoryActionServer |
Definition at line 52 of file cob_hand_bridge_node.cpp.
| void callHalt | ( | ) |
Definition at line 199 of file cob_hand_bridge_node.cpp.
| void cancelCB | ( | ) |
Definition at line 309 of file cob_hand_bridge_node.cpp.
| bool checkAction_nolock | ( | bool | deadline_exceeded | ) |
Definition at line 71 of file cob_hand_bridge_node.cpp.
| void goalCB | ( | ) |
Definition at line 222 of file cob_hand_bridge_node.cpp.
| void handleDeadline | ( | const ros::TimerEvent & | ) |
Definition at line 210 of file cob_hand_bridge_node.cpp.
| bool initCallback | ( | std_srvs::Trigger::Request & | req, |
| std_srvs::Trigger::Response & | res | ||
| ) |
Definition at line 101 of file cob_hand_bridge_node.cpp.
| bool isFingerReady_nolock | ( | ) |
Definition at line 67 of file cob_hand_bridge_node.cpp.
| int main | ( | int | argc, |
| char * | argv[] | ||
| ) |
Definition at line 331 of file cob_hand_bridge_node.cpp.
| void reportDiagnostics | ( | diagnostic_updater::DiagnosticStatusWrapper & | stat | ) |
Definition at line 174 of file cob_hand_bridge_node.cpp.
| void resendCommand | ( | const ros::TimerEvent & | e | ) |
Definition at line 319 of file cob_hand_bridge_node.cpp.
| void statusCallback | ( | const cob_hand_bridge::Status::ConstPtr & | msg | ) |
Definition at line 140 of file cob_hand_bridge_node.cpp.
| boost::scoped_ptr<FollowJointTrajectoryActionServer> g_as |
Definition at line 53 of file cob_hand_bridge_node.cpp.
| cob_hand_bridge::JointValues g_command |
Definition at line 55 of file cob_hand_bridge_node.cpp.
| ros::Publisher g_command_pub |
Definition at line 51 of file cob_hand_bridge_node.cpp.
| ros::Timer g_command_timer |
Definition at line 57 of file cob_hand_bridge_node.cpp.
| bool g_control_stopped |
Definition at line 63 of file cob_hand_bridge_node.cpp.
| ros::Timer g_deadline_timer |
Definition at line 58 of file cob_hand_bridge_node.cpp.
| cob_hand_bridge::JointValues g_default_command |
Definition at line 56 of file cob_hand_bridge_node.cpp.
| control_msgs::FollowJointTrajectoryGoalConstPtr g_goal |
Definition at line 54 of file cob_hand_bridge_node.cpp.
| std::vector<double> g_goal_tolerance |
Definition at line 65 of file cob_hand_bridge_node.cpp.
| ros::ServiceClient g_halt_client |
Definition at line 49 of file cob_hand_bridge_node.cpp.
| ros::ServiceClient g_init_finger_client |
Definition at line 48 of file cob_hand_bridge_node.cpp.
| ros::ServiceServer g_init_srv |
Definition at line 46 of file cob_hand_bridge_node.cpp.
| bool g_initialized |
Definition at line 61 of file cob_hand_bridge_node.cpp.
| sensor_msgs::JointState g_js |
Definition at line 44 of file cob_hand_bridge_node.cpp.
| ros::Publisher g_js_pub |
Definition at line 43 of file cob_hand_bridge_node.cpp.
| bool g_motion_stopped |
Definition at line 62 of file cob_hand_bridge_node.cpp.
| bool g_motors_moved |
Definition at line 64 of file cob_hand_bridge_node.cpp.
| boost::mutex g_mutex |
Definition at line 38 of file cob_hand_bridge_node.cpp.
| cob_hand_bridge::Status::ConstPtr g_status |
Definition at line 40 of file cob_hand_bridge_node.cpp.
| double g_stopped_current |
Definition at line 60 of file cob_hand_bridge_node.cpp.
| double g_stopped_velocity |
Definition at line 59 of file cob_hand_bridge_node.cpp.
| boost::shared_ptr<diagnostic_updater::TimeStampStatus> g_topic_status |
Definition at line 41 of file cob_hand_bridge_node.cpp.