#include <gazebo_ros_hand_of_god.h>
Public Member Functions | |
GazeboRosHandOfGod () | |
Constructor. More... | |
void | Load (physics::ModelPtr _parent, sdf::ElementPtr _sdf) |
Load the controller. More... | |
virtual | ~GazeboRosHandOfGod () |
Destructor. More... | |
Protected Member Functions | |
virtual void | GazeboUpdate () |
Update the controller. More... | |
Private Attributes | |
double | ca_ |
double | cl_ |
physics::LinkPtr | floating_link_ |
std::string | frame_id_ |
double | ka_ |
double | kl_ |
std::string | link_name_ |
physics::ModelPtr | model_ |
std::string | robot_namespace_ |
boost::shared_ptr< tf2_ros::TransformBroadcaster > | tf_broadcaster_ |
boost::shared_ptr< tf2_ros::Buffer > | tf_buffer_ |
boost::shared_ptr< tf2_ros::TransformListener > | tf_listener_ |
event::ConnectionPtr | update_connection_ |
Pointer to the update event connection. More... | |
Definition at line 40 of file gazebo_ros_hand_of_god.h.
gazebo::GazeboRosHandOfGod::GazeboRosHandOfGod | ( | ) |
Constructor.
Definition at line 53 of file gazebo_ros_hand_of_god.cpp.
|
virtual |
Destructor.
Definition at line 64 of file gazebo_ros_hand_of_god.cpp.
|
protectedvirtual |
Update the controller.
Definition at line 138 of file gazebo_ros_hand_of_god.cpp.
void gazebo::GazeboRosHandOfGod::Load | ( | physics::ModelPtr | _parent, |
sdf::ElementPtr | _sdf | ||
) |
Load the controller.
Definition at line 70 of file gazebo_ros_hand_of_god.cpp.
|
private |
Definition at line 65 of file gazebo_ros_hand_of_god.h.
|
private |
Definition at line 65 of file gazebo_ros_hand_of_god.h.
|
private |
Definition at line 60 of file gazebo_ros_hand_of_god.h.
|
private |
Definition at line 63 of file gazebo_ros_hand_of_god.h.
|
private |
Definition at line 64 of file gazebo_ros_hand_of_god.h.
|
private |
Definition at line 64 of file gazebo_ros_hand_of_god.h.
|
private |
Definition at line 61 of file gazebo_ros_hand_of_god.h.
|
private |
Definition at line 59 of file gazebo_ros_hand_of_god.h.
|
private |
Definition at line 62 of file gazebo_ros_hand_of_god.h.
|
private |
Definition at line 58 of file gazebo_ros_hand_of_god.h.
|
private |
Definition at line 56 of file gazebo_ros_hand_of_god.h.
|
private |
Definition at line 57 of file gazebo_ros_hand_of_god.h.
|
private |
Pointer to the update event connection.
Definition at line 55 of file gazebo_ros_hand_of_god.h.