Public Member Functions | Private Attributes | List of all members
LowPassFilter Class Reference

#include <lp_filter.h>

Public Member Functions

void input (double in)
 
void input (double in, ros::Time time)
 
 LowPassFilter (double cutoff_freq)
 
 LowPassFilter (ros::NodeHandle &nh)
 
double output ()
 
void reset ()
 

Private Attributes

double c_ = 1.
 
double cutoff_frequency_ = -1
 
ros::Duration delta_t_
 
double in_ [3] {}
 
bool is_debug_ {}
 
double out_ [3] {}
 
ros::Time prev_time_
 
std::shared_ptr< realtime_tools::RealtimePublisher< rm_msgs::LpData > > realtime_pub_ {}
 
double tan_filt_ = 1.
 

Detailed Description

Definition at line 44 of file lp_filter.h.

Constructor & Destructor Documentation

◆ LowPassFilter() [1/2]

LowPassFilter::LowPassFilter ( ros::NodeHandle nh)
explicit

Definition at line 41 of file lp_filter.cpp.

◆ LowPassFilter() [2/2]

LowPassFilter::LowPassFilter ( double  cutoff_freq)
explicit

Definition at line 50 of file lp_filter.cpp.

Member Function Documentation

◆ input() [1/2]

void LowPassFilter::input ( double  in)

Definition at line 112 of file lp_filter.cpp.

◆ input() [2/2]

void LowPassFilter::input ( double  in,
ros::Time  time 
)

Definition at line 56 of file lp_filter.cpp.

◆ output()

double LowPassFilter::output ( )

Definition at line 117 of file lp_filter.cpp.

◆ reset()

void LowPassFilter::reset ( )

Definition at line 122 of file lp_filter.cpp.

Member Data Documentation

◆ c_

double LowPassFilter::c_ = 1.
private

Definition at line 94 of file lp_filter.h.

◆ cutoff_frequency_

double LowPassFilter::cutoff_frequency_ = -1
private

Definition at line 91 of file lp_filter.h.

◆ delta_t_

ros::Duration LowPassFilter::delta_t_
private

Definition at line 100 of file lp_filter.h.

◆ in_

double LowPassFilter::in_[3] {}
private

Definition at line 86 of file lp_filter.h.

◆ is_debug_

bool LowPassFilter::is_debug_ {}
private

Definition at line 97 of file lp_filter.h.

◆ out_

double LowPassFilter::out_[3] {}
private

Definition at line 87 of file lp_filter.h.

◆ prev_time_

ros::Time LowPassFilter::prev_time_
private

Definition at line 99 of file lp_filter.h.

◆ realtime_pub_

std::shared_ptr<realtime_tools::RealtimePublisher<rm_msgs::LpData> > LowPassFilter::realtime_pub_ {}
private

Definition at line 102 of file lp_filter.h.

◆ tan_filt_

double LowPassFilter::tan_filt_ = 1.
private

Definition at line 96 of file lp_filter.h.


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


rm_common
Author(s):
autogenerated on Thu Mar 6 2025 03:23:29