Functions
check_trajectory_benchmarks.cpp File Reference
#include <tesseract_common/macros.h>
#include <benchmark/benchmark.h>
#include <algorithm>
#include <console_bridge/console.h>
#include <tesseract_environment/environment.h>
#include <tesseract_environment/utils.h>
#include <tesseract_environment/commands/add_link_command.h>
#include <tesseract_scene_graph/graph.h>
#include <tesseract_scene_graph/link.h>
#include <tesseract_scene_graph/joint.h>
#include <tesseract_state_solver/state_solver.h>
#include <tesseract_common/resource_locator.h>
#include <tesseract_srdf/srdf_model.h>
#include <tesseract_urdf/urdf_parser.h>
#include <tesseract_geometry/impl/sphere.h>
#include <tesseract_collision/core/continuous_contact_manager.h>
#include <tesseract_collision/core/discrete_contact_manager.h>
#include <tesseract_kinematics/core/joint_group.h>
Include dependency graph for check_trajectory_benchmarks.cpp:

Go to the source code of this file.

Functions

static void BM_CHECK_TRAJECTORY_CONTINUOUS_MANIP (benchmark::State &state, std::vector< tesseract_collision::ContactResultMap > contacts, tesseract_collision::ContinuousContactManager::Ptr manager, tesseract_kinematics::JointGroup::ConstPtr manip, tesseract_common::TrajArray traj, tesseract_collision::CollisionCheckConfig config, bool log_level_debug)
 
static void BM_CHECK_TRAJECTORY_CONTINUOUS_SS (benchmark::State &state, std::vector< tesseract_collision::ContactResultMap > contacts, tesseract_collision::ContinuousContactManager::Ptr manager, tesseract_scene_graph::StateSolver::Ptr state_solver, std::vector< std::string > joint_names, tesseract_common::TrajArray traj, tesseract_collision::CollisionCheckConfig config, bool log_level_debug)
 
static void BM_CHECK_TRAJECTORY_DISCRETE_MANIP (benchmark::State &state, std::vector< tesseract_collision::ContactResultMap > contacts, tesseract_collision::DiscreteContactManager::Ptr manager, tesseract_kinematics::JointGroup::ConstPtr manip, tesseract_common::TrajArray traj, tesseract_collision::CollisionCheckConfig config, bool log_level_debug)
 
static void BM_CHECK_TRAJECTORY_DISCRETE_SS (benchmark::State &state, std::vector< tesseract_collision::ContactResultMap > contacts, tesseract_collision::DiscreteContactManager::Ptr manager, tesseract_scene_graph::StateSolver::Ptr state_solver, std::vector< std::string > joint_names, tesseract_common::TrajArray traj, tesseract_collision::CollisionCheckConfig config, bool log_level_debug)
 
SceneGraph::Ptr getSceneGraph ()
 
SRDFModel::Ptr getSRDFModel (const SceneGraph &scene_graph)
 
int main (int argc, char **argv)
 

Function Documentation

◆ BM_CHECK_TRAJECTORY_CONTINUOUS_MANIP()

static void BM_CHECK_TRAJECTORY_CONTINUOUS_MANIP ( benchmark::State &  state,
std::vector< tesseract_collision::ContactResultMap contacts,
tesseract_collision::ContinuousContactManager::Ptr  manager,
tesseract_kinematics::JointGroup::ConstPtr  manip,
tesseract_common::TrajArray  traj,
tesseract_collision::CollisionCheckConfig  config,
bool  log_level_debug 
)
static

Definition at line 67 of file check_trajectory_benchmarks.cpp.

◆ BM_CHECK_TRAJECTORY_CONTINUOUS_SS()

static void BM_CHECK_TRAJECTORY_CONTINUOUS_SS ( benchmark::State &  state,
std::vector< tesseract_collision::ContactResultMap contacts,
tesseract_collision::ContinuousContactManager::Ptr  manager,
tesseract_scene_graph::StateSolver::Ptr  state_solver,
std::vector< std::string >  joint_names,
tesseract_common::TrajArray  traj,
tesseract_collision::CollisionCheckConfig  config,
bool  log_level_debug 
)
static

Definition at line 47 of file check_trajectory_benchmarks.cpp.

◆ BM_CHECK_TRAJECTORY_DISCRETE_MANIP()

static void BM_CHECK_TRAJECTORY_DISCRETE_MANIP ( benchmark::State &  state,
std::vector< tesseract_collision::ContactResultMap contacts,
tesseract_collision::DiscreteContactManager::Ptr  manager,
tesseract_kinematics::JointGroup::ConstPtr  manip,
tesseract_common::TrajArray  traj,
tesseract_collision::CollisionCheckConfig  config,
bool  log_level_debug 
)
static

Definition at line 106 of file check_trajectory_benchmarks.cpp.

◆ BM_CHECK_TRAJECTORY_DISCRETE_SS()

static void BM_CHECK_TRAJECTORY_DISCRETE_SS ( benchmark::State &  state,
std::vector< tesseract_collision::ContactResultMap contacts,
tesseract_collision::DiscreteContactManager::Ptr  manager,
tesseract_scene_graph::StateSolver::Ptr  state_solver,
std::vector< std::string >  joint_names,
tesseract_common::TrajArray  traj,
tesseract_collision::CollisionCheckConfig  config,
bool  log_level_debug 
)
static

Definition at line 86 of file check_trajectory_benchmarks.cpp.

◆ getSceneGraph()

SceneGraph::Ptr getSceneGraph ( )

Definition at line 28 of file check_trajectory_benchmarks.cpp.

◆ getSRDFModel()

SRDFModel::Ptr getSRDFModel ( const SceneGraph scene_graph)

Definition at line 36 of file check_trajectory_benchmarks.cpp.

◆ main()

int main ( int  argc,
char **  argv 
)

Definition at line 125 of file check_trajectory_benchmarks.cpp.



tesseract_environment
Author(s): Levi Armstrong
autogenerated on Sun May 18 2025 03:02:21