#include <moveit_sim_hw_interface.h>
Public Member Functions | |
void | init () |
Initialize the robot hardware interface. | |
void | loadDefaultJointValues () |
MoveItSimHWInterface (ros::NodeHandle &nh, urdf::Model *urdf_model=NULL) | |
Constructor. | |
Private Attributes | |
std::string | joint_model_group_ |
std::string | joint_model_group_pose_ |
std::string | name_ |
robot_model_loader::RobotModelLoaderPtr | robot_model_loader_ |
Definition at line 55 of file moveit_sim_hw_interface.h.
moveit_sim_controller::MoveItSimHWInterface::MoveItSimHWInterface | ( | ros::NodeHandle & | nh, |
urdf::Model * | urdf_model = NULL |
||
) | [explicit] |
Constructor.
Definition at line 46 of file moveit_sim_hw_interface.cpp.
void moveit_sim_controller::MoveItSimHWInterface::init | ( | ) | [virtual] |
Initialize the robot hardware interface.
Reimplemented from ros_control_boilerplate::SimHWInterface.
Definition at line 57 of file moveit_sim_hw_interface.cpp.
Definition at line 71 of file moveit_sim_hw_interface.cpp.
std::string moveit_sim_controller::MoveItSimHWInterface::joint_model_group_ [private] |
Definition at line 71 of file moveit_sim_hw_interface.h.
std::string moveit_sim_controller::MoveItSimHWInterface::joint_model_group_pose_ [private] |
Definition at line 72 of file moveit_sim_hw_interface.h.
std::string moveit_sim_controller::MoveItSimHWInterface::name_ [private] |
Reimplemented from ros_control_boilerplate::SimHWInterface.
Definition at line 69 of file moveit_sim_hw_interface.h.
robot_model_loader::RobotModelLoaderPtr moveit_sim_controller::MoveItSimHWInterface::robot_model_loader_ [private] |
Definition at line 76 of file moveit_sim_hw_interface.h.