Public Member Functions | |
| void | polygon_to_marker (const vector< geometry_msgs::Point > &polygon, visualization_msgs::Marker &marker) |
| RobotClass () | |
| void | visualize (const vector< State_With_Covariance > &path) |
Public Attributes | |
| bool | animate_ |
| vector< geometry_msgs::Point > | footprint_ |
| string | frame_id_ |
| double | kappa_max_ |
| visualization_msgs::MarkerArray | marker_array_swath_ |
| visualization_msgs::Marker | marker_chassis_ |
| visualization_msgs::Marker | marker_wheels_ |
| Measurement_Noise | measurement_noise_ |
| ros::Publisher | pub_swath_ |
| double | sigma_max_ |
| double | track_width_ |
| vector< geometry_msgs::Point > | wheel_ |
| double | wheel_base_ |
| geometry_msgs::Point | wheel_fl_pos_ |
| geometry_msgs::Point | wheel_fr_pos_ |
| double | wheel_radius_ |
| double | wheel_width_ |
Definition at line 358 of file steering_functions_node.cpp.
|
inlineexplicit |
Definition at line 385 of file steering_functions_node.cpp.
|
inline |
Definition at line 455 of file steering_functions_node.cpp.
|
inline |
Definition at line 466 of file steering_functions_node.cpp.
| bool RobotClass::animate_ |
Definition at line 380 of file steering_functions_node.cpp.
| vector<geometry_msgs::Point> RobotClass::footprint_ |
Definition at line 370 of file steering_functions_node.cpp.
| string RobotClass::frame_id_ |
Definition at line 379 of file steering_functions_node.cpp.
| double RobotClass::kappa_max_ |
Definition at line 365 of file steering_functions_node.cpp.
| visualization_msgs::MarkerArray RobotClass::marker_array_swath_ |
Definition at line 381 of file steering_functions_node.cpp.
| visualization_msgs::Marker RobotClass::marker_chassis_ |
Definition at line 382 of file steering_functions_node.cpp.
| visualization_msgs::Marker RobotClass::marker_wheels_ |
Definition at line 382 of file steering_functions_node.cpp.
| Measurement_Noise RobotClass::measurement_noise_ |
Definition at line 376 of file steering_functions_node.cpp.
| ros::Publisher RobotClass::pub_swath_ |
Definition at line 362 of file steering_functions_node.cpp.
| double RobotClass::sigma_max_ |
Definition at line 366 of file steering_functions_node.cpp.
| double RobotClass::track_width_ |
Definition at line 368 of file steering_functions_node.cpp.
| vector<geometry_msgs::Point> RobotClass::wheel_ |
Definition at line 371 of file steering_functions_node.cpp.
| double RobotClass::wheel_base_ |
Definition at line 367 of file steering_functions_node.cpp.
| geometry_msgs::Point RobotClass::wheel_fl_pos_ |
Definition at line 369 of file steering_functions_node.cpp.
| geometry_msgs::Point RobotClass::wheel_fr_pos_ |
Definition at line 369 of file steering_functions_node.cpp.
| double RobotClass::wheel_radius_ |
Definition at line 372 of file steering_functions_node.cpp.
| double RobotClass::wheel_width_ |
Definition at line 373 of file steering_functions_node.cpp.