#include <flirtlib_ros/flirtlib.h>
#include <flirtlib_ros/conversions.h>
#include <visualization_msgs/Marker.h>
#include <ros/ros.h>
#include <tf/transform_listener.h>
#include <boost/thread.hpp>
#include <boost/foreach.hpp>
#include <boost/lexical_cast.hpp>
Go to the source code of this file.
Classes | |
class | flirtlib_ros::Node |
Namespaces | |
namespace | flirtlib_ros |
Typedefs | |
typedef std::pair < InterestPoint *, InterestPoint * > | Correspondence |
typedef vector< Correspondence > | Correspondences |
typedef vector< InterestPoint * > | InterestPointVec |
typedef boost::mutex::scoped_lock | Lock |
Functions | |
double | flirtlib_ros::averageDistance (const Correspondences &corresp, const gm::Pose &p0, const gm::Pose &p1) |
vm::Marker | flirtlib_ros::correspondenceMarkers (const Correspondences &correspondences, const gm::Pose &p0, const gm::Pose &p1) |
DescriptorGenerator * | flirtlib_ros::createDescriptor (HistogramDistance< double > *dist) |
Detector * | flirtlib_ros::createDetector (SimpleMinMaxPeakFinder *peak_finder) |
SimpleMinMaxPeakFinder * | flirtlib_ros::createPeakFinder () |
int | main (int argc, char **argv) |
gm::Point | flirtlib_ros::toPoint (const tf::Vector3 &p) |
Load occupancy grid from file, simulate fake scan(s), visualize results of flirtlib
Definition in file flirtlib_ros_test.cpp.
typedef std::pair<InterestPoint*, InterestPoint*> Correspondence |
Definition at line 59 of file flirtlib_ros_test.cpp.
typedef vector<Correspondence> Correspondences |
Definition at line 60 of file flirtlib_ros_test.cpp.
typedef vector<InterestPoint*> InterestPointVec |
Definition at line 58 of file flirtlib_ros_test.cpp.
typedef boost::mutex::scoped_lock Lock |
Definition at line 57 of file flirtlib_ros_test.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 306 of file flirtlib_ros_test.cpp.