![]() |
mrs_lib
Various reusable classes, functions and utilities for use in MRS projects
|
▼ include | |
▼ mrs_lib | |
▼ geometry | |
conversions.h | |
conversions_eigen.h | |
conversions_opencv.h | |
cyclic.h | Defines the cyclic class for calculations with cyclic quantities |
misc.h | Defines useful geometry utilities and functions |
shapes.h | Defines various geometrical shapes and their relations |
▼ impl | |
dynamic_publisher.hpp | |
param_provider.hpp | |
publisher_handler.hpp | |
service_client_handler.hpp | |
subscribe_handler.hpp | |
timer.hpp | |
transformer.hpp | |
ukf.hpp | Implements UKF - a class implementing the Unscented Kalman Filter |
vector_converter.hpp | Implements the convertTo() and convertFrom() functions for conversion between different vector representations (Eigen, OpenCV, tf2 etc.) |
vector_converter_types.h | |
▼ safety_zone | |
line_operations.h | |
polygon.h | |
safety_zone.h | |
attitude_converter.h | Conversions between various representations of object attitude in 3D. Supports Quaternions, Euler angles, Angle-axis and Rotational matrices from tf, tf2, Eigen and geometry_msgs libraries. The default Euler angle notation is the extrinsic RPY |
batch_visualizer.h | For convenient and computationally lightweight drawing of geometry in RVIZ using marker arrays |
dkf.h | |
dynamic_publisher.h | Defines DynamicPublisher for easy debug publishing of ROS messages |
dynamic_reconfigure_mgr.h | Defines DynamicReconfigureMgr - a convenience class for managing dynamic ROS parameters through dynamic reconfigure |
gps_conversions.h | Universal Transverse Mercator transforms. Functions to convert (spherical) latitude and longitude to and from (Euclidean) UTM coordinates |
iir_filter.h | |
image_publisher.h | |
jlkf.h | |
kalman_filter.h | Defines KalmanFilter - an abstract class, defining common interfaces and types for a generic Kalman filter |
kalman_filter_aloamgarm.h | Defines KalmanFilter - an abstract class, defining common interfaces and types for a generic Kalman filter |
lkf.h | |
math.h | Defines useful math functions that are not part of the cmath STD library |
median_filter.h | Defines the MedianFilter class |
mrs_lib.h | |
msg_extractor.h | Utility functions for getting stuff from ROS msgs |
mutex.h | Defines helper routines for getting and setting variables under mutex locks |
nckf.h | |
notch_filter.h | |
param_loader.h | Defines ParamLoader - a convenience class for loading static ROS parameters |
param_provider.h | Defines ParamProvider - a helper class for ParamLoader |
profiler.h | A scoped function profiler which publishes ROS messages |
publisher_handler.h | Defines PublisherHandler and related convenience classes for upgrading the ROS publisher |
quadratic_throttle_model.h | |
repredictor.h | |
repredictor_aloamgarm.h | |
rheiv.h | Defines RHEIV and related stuff for surface fitting to points with known covariances according to [2] |
scope_timer.h | Simple timer which times a duration of its scope, with additional optional checkpoints |
service_client_handler.h | Defines ServiceClientHandler and related convenience classes for upgrading the ROS service client |
subscribe_handler.h | Defines SubscribeHandler and related convenience classes for subscribing to ROS topics |
timeout_manager.h | TODO |
timer.h | |
transform_broadcaster.h | |
transformer.h | |
ukf.h | Defines UKF - a class implementing the Unscented Kalman Filter [4] |
utils.h | Defines various general utility functions |
vector_converter.h | Defines the convert() function for conversion between different vector representations (Eigen, OpenCV, tf2 etc.) |
visual_object.h | Object abstraction for the Batch Visualizer |
▼ src | |
▼ dkf | |
example.cpp | Example file for the DKF implementation |
▼ dynamic_publisher | |
example.cpp | Example file for the DynamicPublisher convenience class |
▼ geometry | |
cyclic_example.cpp | Example file for the cyclical values implementation (see the cyclic class) |
▼ lkf | |
example.cpp | Example file for the LKF implementation |
▼ nckf | |
nckf_tests.cpp | Tests for the UKF implementation |
▼ param_loader | |
example.cpp | Example file for the ParamLoader convenience class |
▼ repredictor | |
example.cpp | Example file for the Repredictor implementation |
▼ rheiv | |
example.cpp | Example file for the RHEIV implementation |
▼ subscribe_handler | |
example.cpp | Example file for the SubscribeHandler convenience class |
simple_example.cpp | Example file for the SubscribeHandler convenience class |
▼ ukf | |
example.cpp | Example file for the UKF implementation |
▼ vector_converter | |
example.cpp | Example file for the convert() vector type conversion function |
▼ test | |
▼ math | |
probit_gts.h |