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

A Bumper controller. More...

#include <gazebo_ros_bumper.h>

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

Public Member Functions

 GazeboRosBumper ()
 Constructor. More...
 
void Load (sensors::SensorPtr _parent, sdf::ElementPtr _sdf)
 Load the plugin. More...
 
 ~GazeboRosBumper ()
 Destructor. More...
 

Private Member Functions

void ContactQueueThread ()
 
void OnContact ()
 Update the controller. More...
 

Private Attributes

std::string bumper_topic_name_
 set topic name of broadcast More...
 
boost::thread callback_queue_thread_
 
ros::Publisher contact_pub_
 
ros::CallbackQueue contact_queue_
 
gazebo_msgs::ContactsState contact_state_msg_
 broadcast some string for now. More...
 
std::string frame_name_
 
sensors::ContactSensorPtr parentSensor
 
std::string robot_namespace_
 for setting ROS name space More...
 
ros::NodeHandlerosnode_
 pointer to ros node More...
 
event::ConnectionPtr update_connection_
 

Detailed Description

A Bumper controller.

Definition at line 53 of file gazebo_ros_bumper.h.

Constructor & Destructor Documentation

◆ GazeboRosBumper()

gazebo::GazeboRosBumper::GazeboRosBumper ( )

Constructor.

Definition at line 55 of file gazebo_ros_bumper.cpp.

◆ ~GazeboRosBumper()

gazebo::GazeboRosBumper::~GazeboRosBumper ( )

Destructor.

Definition at line 61 of file gazebo_ros_bumper.cpp.

Member Function Documentation

◆ ContactQueueThread()

void gazebo::GazeboRosBumper::ContactQueueThread ( )
private

Definition at line 337 of file gazebo_ros_bumper.cpp.

◆ Load()

void gazebo::GazeboRosBumper::Load ( sensors::SensorPtr  _parent,
sdf::ElementPtr  _sdf 
)

Load the plugin.

Parameters
takein SDF root element

Definition at line 71 of file gazebo_ros_bumper.cpp.

◆ OnContact()

void gazebo::GazeboRosBumper::OnContact ( )
private

Update the controller.

\TODO: need a time for each Contact in i-loop, they may differ

\TODO:

Definition at line 137 of file gazebo_ros_bumper.cpp.

Member Data Documentation

◆ bumper_topic_name_

std::string gazebo::GazeboRosBumper::bumper_topic_name_
private

set topic name of broadcast

Definition at line 75 of file gazebo_ros_bumper.h.

◆ callback_queue_thread_

boost::thread gazebo::GazeboRosBumper::callback_queue_thread_
private

Definition at line 87 of file gazebo_ros_bumper.h.

◆ contact_pub_

ros::Publisher gazebo::GazeboRosBumper::contact_pub_
private

Definition at line 70 of file gazebo_ros_bumper.h.

◆ contact_queue_

ros::CallbackQueue gazebo::GazeboRosBumper::contact_queue_
private

Definition at line 85 of file gazebo_ros_bumper.h.

◆ contact_state_msg_

gazebo_msgs::ContactsState gazebo::GazeboRosBumper::contact_state_msg_
private

broadcast some string for now.

Definition at line 80 of file gazebo_ros_bumper.h.

◆ frame_name_

std::string gazebo::GazeboRosBumper::frame_name_
private

Definition at line 77 of file gazebo_ros_bumper.h.

◆ parentSensor

sensors::ContactSensorPtr gazebo::GazeboRosBumper::parentSensor
private

Definition at line 72 of file gazebo_ros_bumper.h.

◆ robot_namespace_

std::string gazebo::GazeboRosBumper::robot_namespace_
private

for setting ROS name space

Definition at line 83 of file gazebo_ros_bumper.h.

◆ rosnode_

ros::NodeHandle* gazebo::GazeboRosBumper::rosnode_
private

pointer to ros node

Definition at line 69 of file gazebo_ros_bumper.h.

◆ update_connection_

event::ConnectionPtr gazebo::GazeboRosBumper::update_connection_
private

Definition at line 90 of file gazebo_ros_bumper.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