#include <sys/mman.h>#include <cmath>#include <time.h>#include <signal.h>#include <stdexcept>#include <ros/ros.h>#include <controller_manager/controller_manager.h>#include "yumi_hw/yumi_hw_rapid.h"
Go to the source code of this file.
Functions | |
| std::string | getURDF (ros::NodeHandle &model_nh_, std::string param_name) |
| int | main (int argc, char **argv) |
| void | quitRequested (int sig) |
Variables | |
| bool | g_quit = false |
| std::string getURDF | ( | ros::NodeHandle & | model_nh_, |
| std::string | param_name | ||
| ) |
Definition at line 23 of file yumi_hw_ifce_node.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 54 of file yumi_hw_ifce_node.cpp.
| void quitRequested | ( | int | sig | ) |
Definition at line 17 of file yumi_hw_ifce_node.cpp.
| bool g_quit = false |
Definition at line 15 of file yumi_hw_ifce_node.cpp.