utils.h File Reference

#include <ros/ros.h>
#include <std_msgs/ColorRGBA.h>
#include <boost/format.hpp>
#include <tf/transform_broadcaster.h>
#include <tf/transform_listener.h>
#include "articulation_models/utils.h"
Include dependency graph for utils.h:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Defines

#define SQR(a)   ((a)*(a))
#define VEC(p1)

Functions

double getBIC (double loglh, size_t k, size_t n)
std_msgs::ColorRGBA HSV_to_RGB (double h, double s, double v)
void MAT_to_RPY (const btMatrix3x3 &mat, double &roll, double &pitch, double &yaw)
std::string pose_to_string (const geometry_msgs::Pose &pose)
btMatrix3x3 RPY_to_MAT (double roll, double pitch, double yaw)
std::string transform_to_string (const btTransform &p)
std::string uncert_to_string (double sigma_position, double sigma_orientation)

Define Documentation

#define SQR (  )     ((a)*(a))

Definition at line 19 of file utils.h.

#define VEC ( p1   ) 
Value:
"["<< \
p1.getOrigin().x() << "," << p1.getOrigin().y()<<","<<p1.getOrigin().z()<< \
"/"<< \
p1.getRotation().x() << "," << p1.getRotation().y()<<","<<p1.getRotation().z()<<","<<p1.getRotation().w()<< \
"]"

Definition at line 26 of file utils.h.


Function Documentation

double getBIC ( double  loglh,
size_t  k,
size_t  n 
)

Definition at line 109 of file utils.cpp.

std_msgs::ColorRGBA HSV_to_RGB ( double  h,
double  s,
double  v 
)

Definition at line 14 of file utils.cpp.

void MAT_to_RPY ( const btMatrix3x3 &  mat,
double &  roll,
double &  pitch,
double &  yaw 
)

Definition at line 63 of file utils.cpp.

std::string pose_to_string ( const geometry_msgs::Pose &  pose  ) 
btMatrix3x3 RPY_to_MAT ( double  roll,
double  pitch,
double  yaw 
)

Definition at line 48 of file utils.cpp.

std::string transform_to_string ( const btTransform &  p  ) 

Definition at line 75 of file utils.cpp.

std::string uncert_to_string ( double  sigma_position,
double  sigma_orientation 
)

Definition at line 95 of file utils.cpp.

 All Classes Namespaces Files Functions Variables Typedefs Defines


articulation_structure
Author(s): sturm
autogenerated on Fri Jan 11 09:53:15 2013