mesh_loader.cpp
Go to the documentation of this file.
1 /*
2  * Copyright (C) 2022 Michael Ferguson
3  *
4  * Licensed under the Apache License, Version 2.0 (the "License");
5  * you may not use this file except in compliance with the License.
6  * You may obtain a copy of the License at
7  *
8  * http://www.apache.org/licenses/LICENSE-2.0
9  *
10  * Unless required by applicable law or agreed to in writing, software
11  * distributed under the License is distributed on an "AS IS" BASIS,
12  * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied.
13  * See the License for the specific language governing permissions and
14  * limitations under the License.
15  */
16 
17 // Author: Michael Ferguson
18 
19 #include <Eigen/Geometry>
20 
21 #include <ros/ros.h>
22 #include <geometry_msgs/Point.h>
24 
25 namespace robot_calibration
26 {
27 
28 MeshLoader::MeshLoader(urdf::Model& model) : model_(model)
29 {
30 }
31 
32 MeshPtr MeshLoader::getCollisionMesh(const std::string& link_name)
33 {
34  // See if we have already loaded the mesh
35  for (size_t i = 0; i < link_names_.size(); ++i)
36  {
37  if (link_names_[i] == link_name)
38  {
39  return meshes_[i];
40  }
41  }
42 
43  // Find the mesh resource path
44  urdf::LinkConstSharedPtr link = model_.getLink(link_name);
45  if (!link)
46  {
47  ROS_ERROR("Cannot find %s in URDF", link_name.c_str());
48  return MeshPtr();
49  }
50 
51  if (!link->collision->geometry)
52  {
53  ROS_ERROR("%s does not have collision geometry description.", link_name.c_str());
54  return MeshPtr();
55  }
56 
57  if (link->collision->geometry->type != urdf::Geometry::MESH)
58  {
59  ROS_ERROR("%s does not have mesh geometry", link_name.c_str());
60  return MeshPtr();
61  }
62 
63  // This is the resource path (package://path/x.mesh)
64  std::string mesh_path = (dynamic_cast<urdf::Mesh*>(link->collision->geometry.get()))->filename;
65 
66  // Get the scale
67  Eigen::Vector3d scale((dynamic_cast<urdf::Mesh*>(link->collision->geometry.get()))->scale.x,
68  (dynamic_cast<urdf::Mesh*>(link->collision->geometry.get()))->scale.y,
69  (dynamic_cast<urdf::Mesh*>(link->collision->geometry.get()))->scale.z);
70 
71  MeshPtr mesh(shapes::createMeshFromResource(mesh_path, scale));
72  link_names_.push_back(link_name);
73  meshes_.push_back(mesh);
74 
75  ROS_INFO("Loaded %s with %u vertices", mesh_path.c_str(), mesh->vertex_count);
76 
77  //Eigen::Quaterniond quat();
78  Eigen::Matrix3d rotation = Eigen::Quaterniond(link->collision->origin.rotation.w,
79  link->collision->origin.rotation.x,
80  link->collision->origin.rotation.y,
81  link->collision->origin.rotation.z).toRotationMatrix();
82  Eigen::Vector3d translation(link->collision->origin.position.x,
83  link->collision->origin.position.y,
84  link->collision->origin.position.z);
85 
86  // Transform to proper location
87  for (size_t v = 0; v < mesh->vertex_count; ++v)
88  {
89  Eigen::Vector3d p(mesh->vertices[(3 * v) + 0],
90  mesh->vertices[(3 * v) + 1],
91  mesh->vertices[(3 * v) + 2]);
92 
93  p = (rotation * p) + translation;
94 
95  mesh->vertices[(3 * v) + 0] = p(0);
96  mesh->vertices[(3 * v) + 1] = p(1);
97  mesh->vertices[(3 * v) + 2] = p(2);
98  }
99 
100  return mesh;
101 }
102 
103 } // namespace robot_calibration
ros.h
urdf::Model
robot_calibration::MeshPtr
std::shared_ptr< shapes::Mesh > MeshPtr
Definition: mesh_loader.h:32
robot_calibration::MeshLoader::meshes_
std::vector< MeshPtr > meshes_
Definition: mesh_loader.h:47
robot_calibration::MeshLoader::getCollisionMesh
MeshPtr getCollisionMesh(const std::string &link_name)
Get the collision mesh associated with a link in a URDF.
Definition: mesh_loader.cpp:32
robot_calibration::MeshLoader::link_names_
std::vector< std::string > link_names_
Definition: mesh_loader.h:46
ROS_ERROR
#define ROS_ERROR(...)
mesh_loader.h
shapes::createMeshFromResource
Mesh * createMeshFromResource(const std::string &resource)
robot_calibration::MeshLoader::MeshLoader
MeshLoader(urdf::Model &model)
Definition: mesh_loader.cpp:28
robot_calibration::MeshLoader::model_
urdf::Model model_
Definition: mesh_loader.h:45
robot_calibration
Calibration code lives under this namespace.
Definition: base_calibration.h:28
ROS_INFO
#define ROS_INFO(...)


robot_calibration
Author(s): Michael Ferguson
autogenerated on Fri Sep 1 2023 02:52:01