Public Member Functions | List of all members
VelocitySensor Class Reference

#include <velocity.hpp>

Inheritance diagram for VelocitySensor:
Inheritance graph
[legend]

Public Member Functions

bool publish (const Eigen::Vector3d &linVelNed, const Eigen::Vector3d &angVelFrd)
 
 VelocitySensor (ros::NodeHandle *nh, const char *topic, double period)
 
- Public Member Functions inherited from BaseSensor
 BaseSensor ()=delete
 
 BaseSensor (ros::NodeHandle *nh, double period)
 
void disable ()
 
void enable ()
 

Additional Inherited Members

- Protected Attributes inherited from BaseSensor
bool _isEnabled {false}
 
double nextPubTimeSec_ = 0
 
ros::NodeHandlenode_handler_
 
std::normal_distribution< double > normalDistribution_ {std::normal_distribution<double>(0.0, 1.0)}
 
const double PERIOD
 
ros::Publisher publisher_
 
std::default_random_engine randomGenerator_
 

Detailed Description

Definition at line 25 of file velocity.hpp.

Constructor & Destructor Documentation

◆ VelocitySensor()

VelocitySensor::VelocitySensor ( ros::NodeHandle nh,
const char *  topic,
double  period 
)

Definition at line 22 of file velocity.cpp.

Member Function Documentation

◆ publish()

bool VelocitySensor::publish ( const Eigen::Vector3d &  linVelNed,
const Eigen::Vector3d &  angVelFrd 
)

Definition at line 25 of file velocity.cpp.


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


inno_vtol_dynamics
Author(s): Roman Fedorenko, Dmitry Ponomarev, Ezra Tal, Winter Guerra
autogenerated on Mon Dec 9 2024 03:13:35