Namespaces | Functions
math.hpp File Reference
#include <geometry_msgs/Point.h>
#include <geometry_msgs/Quaternion.h>
#include <geometry_msgs/Vector3.h>
#include <geometry_msgs/Transform.h>
#include <eigen3/Eigen/Dense>
#include <eigen3/Eigen/Geometry>
Include dependency graph for math.hpp:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Namespaces

 astra_ros
 

Functions

double astra_ros::distance (const geometry_msgs::Point &lhs, const geometry_msgs::Point &rhs)
 
geometry_msgs::Transform astra_ros::fromEigen (const Eigen::Affine3d &transform)
 
geometry_msgs::Quaternion astra_ros::fromEigen (const Eigen::Quaterniond &quaternion)
 
geometry_msgs::Point astra_ros::fromEigen (const Eigen::Vector3d &point)
 
Eigen::Quaterniond astra_ros::lookAt (const Eigen::Vector3d &source_point, const Eigen::Vector3d &dest_point, const Eigen::Vector3d &forward, const Eigen::Vector3d &up)
 
geometry_msgs::Point astra_ros::operator* (const geometry_msgs::Point &lhs, const geometry_msgs::Point &rhs)
 
geometry_msgs::Point astra_ros::operator+ (const geometry_msgs::Point &lhs, const geometry_msgs::Point &rhs)
 
geometry_msgs::Point astra_ros::operator- (const geometry_msgs::Point &lhs, const geometry_msgs::Point &rhs)
 
geometry_msgs::Point astra_ros::operator/ (const geometry_msgs::Point &lhs, const double rhs)
 
double astra_ros::sum (const geometry_msgs::Point &v)
 
Eigen::Vector3d astra_ros::toEigen (const geometry_msgs::Point &point)
 
Eigen::Quaterniond astra_ros::toEigen (const geometry_msgs::Quaternion &quaternion)
 
Eigen::Affine3d astra_ros::toEigen (const geometry_msgs::Transform &transform)
 
Eigen::Vector3d astra_ros::toEigen (const geometry_msgs::Vector3 &vector)
 


astra_ros
Author(s): Braden McDorman
autogenerated on Wed Mar 2 2022 00:53:06