Public Member Functions | Protected Member Functions | Private Attributes | List of all members
gazebo::GazeboRosHandOfGod Class Reference

#include <gazebo_ros_hand_of_god.h>

Inheritance diagram for gazebo::GazeboRosHandOfGod:
Inheritance graph
[legend]

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::TransformBroadcastertf_broadcaster_
 
boost::shared_ptr< tf2_ros::Buffertf_buffer_
 
boost::shared_ptr< tf2_ros::TransformListenertf_listener_
 
event::ConnectionPtr update_connection_
 Pointer to the update event connection. More...
 

Detailed Description

Definition at line 40 of file gazebo_ros_hand_of_god.h.

Constructor & Destructor Documentation

◆ GazeboRosHandOfGod()

gazebo::GazeboRosHandOfGod::GazeboRosHandOfGod ( )

Constructor.

Definition at line 89 of file gazebo_ros_hand_of_god.cpp.

◆ ~GazeboRosHandOfGod()

gazebo::GazeboRosHandOfGod::~GazeboRosHandOfGod ( )
virtual

Destructor.

Definition at line 100 of file gazebo_ros_hand_of_god.cpp.

Member Function Documentation

◆ GazeboUpdate()

void gazebo::GazeboRosHandOfGod::GazeboUpdate ( )
protectedvirtual

Update the controller.

Definition at line 174 of file gazebo_ros_hand_of_god.cpp.

◆ Load()

void gazebo::GazeboRosHandOfGod::Load ( physics::ModelPtr  _parent,
sdf::ElementPtr  _sdf 
)

Load the controller.

Definition at line 106 of file gazebo_ros_hand_of_god.cpp.

Member Data Documentation

◆ ca_

double gazebo::GazeboRosHandOfGod::ca_
private

Definition at line 65 of file gazebo_ros_hand_of_god.h.

◆ cl_

double gazebo::GazeboRosHandOfGod::cl_
private

Definition at line 65 of file gazebo_ros_hand_of_god.h.

◆ floating_link_

physics::LinkPtr gazebo::GazeboRosHandOfGod::floating_link_
private

Definition at line 60 of file gazebo_ros_hand_of_god.h.

◆ frame_id_

std::string gazebo::GazeboRosHandOfGod::frame_id_
private

Definition at line 63 of file gazebo_ros_hand_of_god.h.

◆ ka_

double gazebo::GazeboRosHandOfGod::ka_
private

Definition at line 64 of file gazebo_ros_hand_of_god.h.

◆ kl_

double gazebo::GazeboRosHandOfGod::kl_
private

Definition at line 64 of file gazebo_ros_hand_of_god.h.

◆ link_name_

std::string gazebo::GazeboRosHandOfGod::link_name_
private

Definition at line 61 of file gazebo_ros_hand_of_god.h.

◆ model_

physics::ModelPtr gazebo::GazeboRosHandOfGod::model_
private

Definition at line 59 of file gazebo_ros_hand_of_god.h.

◆ robot_namespace_

std::string gazebo::GazeboRosHandOfGod::robot_namespace_
private

Definition at line 62 of file gazebo_ros_hand_of_god.h.

◆ tf_broadcaster_

boost::shared_ptr<tf2_ros::TransformBroadcaster> gazebo::GazeboRosHandOfGod::tf_broadcaster_
private

Definition at line 58 of file gazebo_ros_hand_of_god.h.

◆ tf_buffer_

boost::shared_ptr<tf2_ros::Buffer> gazebo::GazeboRosHandOfGod::tf_buffer_
private

Definition at line 56 of file gazebo_ros_hand_of_god.h.

◆ tf_listener_

boost::shared_ptr<tf2_ros::TransformListener> gazebo::GazeboRosHandOfGod::tf_listener_
private

Definition at line 57 of file gazebo_ros_hand_of_god.h.

◆ update_connection_

event::ConnectionPtr gazebo::GazeboRosHandOfGod::update_connection_
private

Pointer to the update event connection.

Definition at line 55 of file gazebo_ros_hand_of_god.h.


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


gazebo_plugins
Author(s): John Hsu
autogenerated on Thu Nov 23 2023 03:50:28