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

#include <GazeboRosVelodyneLaser.h>

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

Public Member Functions

 GazeboRosVelodyneLaser ()
 Constructor. More...
 
void Load (sensors::SensorPtr _parent, sdf::ElementPtr _sdf)
 Load the plugin. More...
 
void onStats (const boost::shared_ptr< msgs::WorldStatistics const > &_msg)
 
 ~GazeboRosVelodyneLaser ()
 Destructor. More...
 

Protected Member Functions

virtual void OnNewLaserScans ()
 Update the controller. More...
 

Private Member Functions

void laserConnect ()
 
void laserDisconnect ()
 
void laserQueueThread ()
 
void putLaserData (common::Time &_updateTime)
 Put laser data to the ROS topic. More...
 

Static Private Member Functions

static double gaussianKernel (double mu, double sigma)
 Gaussian noise generator. More...
 

Private Attributes

boost::thread callback_laser_queue_thread_
 
std::string frame_name_
 frame transform name, should match link name More...
 
double gaussian_noise_
 Gaussian noise. More...
 
int laser_connect_count_
 Keep track of number of connections. More...
 
ros::CallbackQueue laser_queue_
 
common::Time last_update_time_
 
boost::mutex lock_
 A mutex to lock access to fields that are used in message callbacks. More...
 
double max_range_
 Maximum range to publish. More...
 
double min_range_
 Minimum range to publish. More...
 
transport::NodePtr node_
 
sensors::RaySensorPtr parent_ray_sensor_
 
sensors::SensorPtr parent_sensor_
 The parent sensor. More...
 
ros::Publisher pub_
 
std::string robot_namespace_
 for setting ROS name space More...
 
ros::NodeHandlerosnode_
 pointer to ros node More...
 
common::Time sim_time_
 
std::string topic_name_
 topic name More...
 
physics::WorldPtr world_
 

Detailed Description

Definition at line 91 of file GazeboRosVelodyneLaser.h.

Constructor & Destructor Documentation

◆ GazeboRosVelodyneLaser()

gazebo::GazeboRosVelodyneLaser::GazeboRosVelodyneLaser ( )

Constructor.

Parameters
parentThe parent entity, must be a Model or a Sensor

Definition at line 94 of file GazeboRosVelodyneLaser.cpp.

◆ ~GazeboRosVelodyneLaser()

gazebo::GazeboRosVelodyneLaser::~GazeboRosVelodyneLaser ( )

Destructor.

Definition at line 100 of file GazeboRosVelodyneLaser.cpp.

Member Function Documentation

◆ gaussianKernel()

static double gazebo::GazeboRosVelodyneLaser::gaussianKernel ( double  mu,
double  sigma 
)
inlinestaticprivate

Gaussian noise generator.

Definition at line 175 of file GazeboRosVelodyneLaser.h.

◆ laserConnect()

void gazebo::GazeboRosVelodyneLaser::laserConnect ( )
private

Definition at line 224 of file GazeboRosVelodyneLaser.cpp.

◆ laserDisconnect()

void gazebo::GazeboRosVelodyneLaser::laserDisconnect ( )
private

Definition at line 231 of file GazeboRosVelodyneLaser.cpp.

◆ laserQueueThread()

void gazebo::GazeboRosVelodyneLaser::laserQueueThread ( )
private

Definition at line 444 of file GazeboRosVelodyneLaser.cpp.

◆ Load()

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

Load the plugin.

Parameters
takein SDF root element

Definition at line 116 of file GazeboRosVelodyneLaser.cpp.

◆ OnNewLaserScans()

void gazebo::GazeboRosVelodyneLaser::OnNewLaserScans ( )
protectedvirtual

Update the controller.

Definition at line 241 of file GazeboRosVelodyneLaser.cpp.

◆ onStats()

void gazebo::GazeboRosVelodyneLaser::onStats ( const boost::shared_ptr< msgs::WorldStatistics const > &  _msg)

Definition at line 453 of file GazeboRosVelodyneLaser.cpp.

◆ putLaserData()

void gazebo::GazeboRosVelodyneLaser::putLaserData ( common::Time &  _updateTime)
private

Put laser data to the ROS topic.

Definition at line 260 of file GazeboRosVelodyneLaser.cpp.

Member Data Documentation

◆ callback_laser_queue_thread_

boost::thread gazebo::GazeboRosVelodyneLaser::callback_laser_queue_thread_
private

Definition at line 193 of file GazeboRosVelodyneLaser.h.

◆ frame_name_

std::string gazebo::GazeboRosVelodyneLaser::frame_name_
private

frame transform name, should match link name

Definition at line 163 of file GazeboRosVelodyneLaser.h.

◆ gaussian_noise_

double gazebo::GazeboRosVelodyneLaser::gaussian_noise_
private

Gaussian noise.

Definition at line 172 of file GazeboRosVelodyneLaser.h.

◆ laser_connect_count_

int gazebo::GazeboRosVelodyneLaser::laser_connect_count_
private

Keep track of number of connections.

Definition at line 145 of file GazeboRosVelodyneLaser.h.

◆ laser_queue_

ros::CallbackQueue gazebo::GazeboRosVelodyneLaser::laser_queue_
private

Definition at line 191 of file GazeboRosVelodyneLaser.h.

◆ last_update_time_

common::Time gazebo::GazeboRosVelodyneLaser::last_update_time_
private

Definition at line 142 of file GazeboRosVelodyneLaser.h.

◆ lock_

boost::mutex gazebo::GazeboRosVelodyneLaser::lock_
private

A mutex to lock access to fields that are used in message callbacks.

Definition at line 185 of file GazeboRosVelodyneLaser.h.

◆ max_range_

double gazebo::GazeboRosVelodyneLaser::max_range_
private

Maximum range to publish.

Definition at line 169 of file GazeboRosVelodyneLaser.h.

◆ min_range_

double gazebo::GazeboRosVelodyneLaser::min_range_
private

Minimum range to publish.

Definition at line 166 of file GazeboRosVelodyneLaser.h.

◆ node_

transport::NodePtr gazebo::GazeboRosVelodyneLaser::node_
private

Definition at line 196 of file GazeboRosVelodyneLaser.h.

◆ parent_ray_sensor_

sensors::RaySensorPtr gazebo::GazeboRosVelodyneLaser::parent_ray_sensor_
private

Definition at line 153 of file GazeboRosVelodyneLaser.h.

◆ parent_sensor_

sensors::SensorPtr gazebo::GazeboRosVelodyneLaser::parent_sensor_
private

The parent sensor.

Definition at line 152 of file GazeboRosVelodyneLaser.h.

◆ pub_

ros::Publisher gazebo::GazeboRosVelodyneLaser::pub_
private

Definition at line 157 of file GazeboRosVelodyneLaser.h.

◆ robot_namespace_

std::string gazebo::GazeboRosVelodyneLaser::robot_namespace_
private

for setting ROS name space

Definition at line 188 of file GazeboRosVelodyneLaser.h.

◆ rosnode_

ros::NodeHandle* gazebo::GazeboRosVelodyneLaser::rosnode_
private

pointer to ros node

Definition at line 156 of file GazeboRosVelodyneLaser.h.

◆ sim_time_

common::Time gazebo::GazeboRosVelodyneLaser::sim_time_
private

Definition at line 197 of file GazeboRosVelodyneLaser.h.

◆ topic_name_

std::string gazebo::GazeboRosVelodyneLaser::topic_name_
private

topic name

Definition at line 160 of file GazeboRosVelodyneLaser.h.

◆ world_

physics::WorldPtr gazebo::GazeboRosVelodyneLaser::world_
private

Definition at line 150 of file GazeboRosVelodyneLaser.h.


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


velodyne_gazebo_plugin
Author(s): Kevin Hallenbeck
autogenerated on Fri Mar 18 2022 02:29:57