Public Member Functions | Protected Attributes | List of all members
cob_collision_velocity_filter::VelocityLimitedMarker Class Reference

#include <velocity_limited_marker.h>

Public Member Functions

void createDirectionalMarkers ()
 Creates all directional markers, the method is called from the constructor. More...
 
void createRotationalMarkers ()
 Creates all rotational markers, the method is called from the constructor. More...
 
void interpolateColor (double velocity, std_msgs::ColorRGBA &color)
 Calculates the color for the marker. More...
 
void publishMarkers (double vel_x_desired, double vel_x_actual, double vel_y_desired, double vel_y_actual, double vel_theta_desired, double vel_theta_actual)
 Creates all the markers, the method is called from the constructor. More...
 
 VelocityLimitedMarker ()
 Constructor. More...
 
 ~VelocityLimitedMarker ()
 Destructor. More...
 

Protected Attributes

std::string base_frame_
 
bool disabled_
 
double lifetime_
 
ros::Publisher marker_pub_
 
ros::NodeHandle nh_
 
visualization_msgs::Marker theta_neg_marker_
 
visualization_msgs::Marker theta_pos_marker_
 
std::string topic_name_
 
double vtheta_last_
 
double vx_last_
 
double vy_last_
 
visualization_msgs::Marker x_neg_marker_
 
visualization_msgs::Marker x_pos_marker_
 
visualization_msgs::Marker y_neg_marker_
 
visualization_msgs::Marker y_pos_marker_
 
double z_pos_
 

Detailed Description

Definition at line 35 of file velocity_limited_marker.h.

Constructor & Destructor Documentation

◆ VelocityLimitedMarker()

cob_collision_velocity_filter::VelocityLimitedMarker::VelocityLimitedMarker ( )

Constructor.

Definition at line 47 of file velocity_limited_marker.cpp.

◆ ~VelocityLimitedMarker()

cob_collision_velocity_filter::VelocityLimitedMarker::~VelocityLimitedMarker ( )

Destructor.

Definition at line 72 of file velocity_limited_marker.cpp.

Member Function Documentation

◆ createDirectionalMarkers()

void cob_collision_velocity_filter::VelocityLimitedMarker::createDirectionalMarkers ( )

Creates all directional markers, the method is called from the constructor.

Definition at line 77 of file velocity_limited_marker.cpp.

◆ createRotationalMarkers()

void cob_collision_velocity_filter::VelocityLimitedMarker::createRotationalMarkers ( )

Creates all rotational markers, the method is called from the constructor.

Definition at line 159 of file velocity_limited_marker.cpp.

◆ interpolateColor()

void cob_collision_velocity_filter::VelocityLimitedMarker::interpolateColor ( double  velocity,
std_msgs::ColorRGBA &  color 
)

Calculates the color for the marker.

based on the absolute difference of velocities.

Definition at line 235 of file velocity_limited_marker.cpp.

◆ publishMarkers()

void cob_collision_velocity_filter::VelocityLimitedMarker::publishMarkers ( double  vel_x_desired,
double  vel_x_actual,
double  vel_y_desired,
double  vel_y_actual,
double  vel_theta_desired,
double  vel_theta_actual 
)

Creates all the markers, the method is called from the constructor.

Definition at line 253 of file velocity_limited_marker.cpp.

Member Data Documentation

◆ base_frame_

std::string cob_collision_velocity_filter::VelocityLimitedMarker::base_frame_
protected

Definition at line 89 of file velocity_limited_marker.h.

◆ disabled_

bool cob_collision_velocity_filter::VelocityLimitedMarker::disabled_
protected

Definition at line 86 of file velocity_limited_marker.h.

◆ lifetime_

double cob_collision_velocity_filter::VelocityLimitedMarker::lifetime_
protected

Definition at line 95 of file velocity_limited_marker.h.

◆ marker_pub_

ros::Publisher cob_collision_velocity_filter::VelocityLimitedMarker::marker_pub_
protected

Definition at line 83 of file velocity_limited_marker.h.

◆ nh_

ros::NodeHandle cob_collision_velocity_filter::VelocityLimitedMarker::nh_
protected

Definition at line 80 of file velocity_limited_marker.h.

◆ theta_neg_marker_

visualization_msgs::Marker cob_collision_velocity_filter::VelocityLimitedMarker::theta_neg_marker_
protected

Definition at line 77 of file velocity_limited_marker.h.

◆ theta_pos_marker_

visualization_msgs::Marker cob_collision_velocity_filter::VelocityLimitedMarker::theta_pos_marker_
protected

Definition at line 77 of file velocity_limited_marker.h.

◆ topic_name_

std::string cob_collision_velocity_filter::VelocityLimitedMarker::topic_name_
protected

Definition at line 92 of file velocity_limited_marker.h.

◆ vtheta_last_

double cob_collision_velocity_filter::VelocityLimitedMarker::vtheta_last_
protected

Definition at line 101 of file velocity_limited_marker.h.

◆ vx_last_

double cob_collision_velocity_filter::VelocityLimitedMarker::vx_last_
protected

Definition at line 101 of file velocity_limited_marker.h.

◆ vy_last_

double cob_collision_velocity_filter::VelocityLimitedMarker::vy_last_
protected

Definition at line 101 of file velocity_limited_marker.h.

◆ x_neg_marker_

visualization_msgs::Marker cob_collision_velocity_filter::VelocityLimitedMarker::x_neg_marker_
protected

Definition at line 76 of file velocity_limited_marker.h.

◆ x_pos_marker_

visualization_msgs::Marker cob_collision_velocity_filter::VelocityLimitedMarker::x_pos_marker_
protected

Definition at line 76 of file velocity_limited_marker.h.

◆ y_neg_marker_

visualization_msgs::Marker cob_collision_velocity_filter::VelocityLimitedMarker::y_neg_marker_
protected

Definition at line 76 of file velocity_limited_marker.h.

◆ y_pos_marker_

visualization_msgs::Marker cob_collision_velocity_filter::VelocityLimitedMarker::y_pos_marker_
protected

Definition at line 76 of file velocity_limited_marker.h.

◆ z_pos_

double cob_collision_velocity_filter::VelocityLimitedMarker::z_pos_
protected

Definition at line 98 of file velocity_limited_marker.h.


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


cob_collision_velocity_filter
Author(s): Matthias Gruhler, Michal Spanel
autogenerated on Mon May 1 2023 02:50:12