Public Member Functions | Protected Attributes
cob_collision_velocity_filter::VelocityLimitedMarker Class Reference

#include <velocity_limited_marker.h>

List of all members.

Public Member Functions

void createDirectionalMarkers ()
 Creates all directional markers, the method is called from the constructor.
void createRotationalMarkers ()
 Creates all rotational markers, the method is called from the constructor.
void interpolateColor (double velocity, std_msgs::ColorRGBA &color)
 Calculates the color for the marker.
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.
 VelocityLimitedMarker ()
 Constructor.
 ~VelocityLimitedMarker ()
 Destructor.

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

Constructor.

Definition at line 47 of file velocity_limited_marker.cpp.

Destructor.

Definition at line 72 of file velocity_limited_marker.cpp.


Member Function Documentation

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

Definition at line 77 of file velocity_limited_marker.cpp.

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

Definition at line 159 of file velocity_limited_marker.cpp.

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.

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

Definition at line 89 of file velocity_limited_marker.h.

Definition at line 86 of file velocity_limited_marker.h.

Definition at line 95 of file velocity_limited_marker.h.

Definition at line 83 of file velocity_limited_marker.h.

Definition at line 80 of file velocity_limited_marker.h.

Definition at line 77 of file velocity_limited_marker.h.

Definition at line 77 of file velocity_limited_marker.h.

Definition at line 92 of file velocity_limited_marker.h.

Definition at line 101 of file velocity_limited_marker.h.

Definition at line 101 of file velocity_limited_marker.h.

Definition at line 101 of file velocity_limited_marker.h.

Definition at line 76 of file velocity_limited_marker.h.

Definition at line 76 of file velocity_limited_marker.h.

Definition at line 76 of file velocity_limited_marker.h.

Definition at line 76 of file velocity_limited_marker.h.

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 Thu Jun 6 2019 21:19:04