Package Summary

Tags No category tags.
Version 1.3.8
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ament/ament_cmake.git
VCS Type git
VCS Version humble
Last Updated 2024-02-23
Dev Status DEVELOPED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

The ability to add gtest-based tests in the ament buildsystem in CMake.

Additional Links

No additional links.

Maintainers

  • Michael Jeronimo
  • Michel Hidalgo

Authors

  • Dirk Thomas
README
No README found. No README in repository either.
CHANGELOG

Changelog for package ament_cmake_gtest

1.3.8 (2024-02-16)

1.3.7 (2024-01-24)

  • Fix compiler warnings related to gtest/gmock (#408) (#495)
  • Contributors: atzaros

1.3.6 (2023-11-13)

1.3.5 (2023-06-22)

1.3.4 (2023-04-25)

1.3.3 (2022-11-07)

1.3.2 (2022-05-17)

1.3.1 (2022-03-28)

1.3.0 (2022-02-17)

  • Update forthcoming version in changelog
  • Contributors: Audrow Nash

1.2.1 (2022-01-14)

  • Update maintainers to Michael Jeronimo and Michel Hidalgo (#362)
  • Contributors: Audrow Nash

1.2.0 (2021-10-29)

  • Use FindPython3 instead of FindPythonInterp (#355)
  • Update maintainers (#336)
  • Contributors: Chris Lalancette, Shane Loretz

1.1.4 (2021-05-06)

1.1.3 (2021-03-09)

1.1.2 (2021-02-26 22:59)

1.1.1 (2021-02-26 19:12)

1.1.0 (2021-02-24)

1.0.4 (2021-01-25)

1.0.3 (2020-12-10)

1.0.2 (2020-12-07)

  • Update package maintainers. (#286)
  • Contributors: Michel Hidalgo

1.0.1 (2020-09-10)

  • [ament_cmake_gtest] ensure gtest to consume the correct headers. (#267)
    • ensure gtest to consume the correct headers.
    • add another patch.
  • Contributors: Sean Yen

1.0.0 (2020-07-22)

0.9.6 (2020-06-23)

0.9.5 (2020-06-02)

0.9.4 (2020-05-26)

0.9.3 (2020-05-19)

0.9.2 (2020-05-07)

0.9.1 (2020-04-24 15:45)

0.9.0 (2020-04-24 12:25)

0.8.1 (2019-10-23)

0.8.0 (2019-10-04)

  • Revert \"Add gtest and gmock headers as system headers: (#175)\" (#184) This reverts commit e1ff1c1a0a1e08d43e939cdb943a88be601808bd.
  • Add gtest and gmock headers as system headers: (#175) Certain gtest and gmock header files contain constructs which generate warnings when certain compile flags are enabled. By including the header files as system headers, the compiler knows that it doesn\'t need to generate these warnings since they are coming from (third-party) system headers
  • Add runner option to ament_add_test (#174)
    • ament_cmake allow speficiation of a different test runner
    • By default, still uses run_test.py
    • Example use case: ament_cmake_ros can use a test runner that sets a ROS_DOMAIN_ID
    • ament_cmake move run_test.py to a python module
    • This should let us see the history
    • ament_cmake refactor run_test.py into an importable python module
    • Adds an ament_cmake_test python package
  • Contributors: Peter Baughman, Shane Loretz, jpsamper2009

0.7.3 (2019-05-29)

0.7.2 (2019-05-20)

0.7.1 (2019-05-07)

  • Fix unused-arg check in ament_cmake packages: (#167) Arguments to a macro are not variables, so it\'s not possible to do \'if(ARGN)\' to check for arguments; however, copying ARGN to a variable works.
  • Contributors: jpsamper2009

0.7.0 (2019-04-08)

0.6.0 (2018-11-13)

0.5.1 (2018-07-17)

0.5.0 (2018-06-13)

0.4.0 (2017-12-08)

  • 0.0.3
  • Merge pull request #104 from ament/googletest update to googletest 1.8
  • update to googletest 1.8
  • 0.0.2
  • Merge pull request #86 from ament/remove_include remove unnecessary include
  • remove unnecessary include
  • Merge pull request #85 from ament/split_gtest_function Split ament_add_gtest function
  • refactor ament_add_gtest to be composed out of two separate functions to create the executable and register it as a test
  • duplicate ament_add_gtest.cmake before refactoring it
  • add missing doc for SKIP_TEST
  • Merge pull request #82 from firesurfer/master Fixed rebasing error, fixed indentation, looking for pthread on non w...
  • removed GTEST argument form target_link_libraries
  • Fixed rebasing error, fixed indentation, looking for pthread on non windows systems
  • Skipped tests (#80)
    • support skipping tests
    • add SKIP_TEST to ament_add_nose_test
    • use keyword args not positional
    • discard positional args after first
  • update schema url
  • add schema to manifest files
  • Merge pull request #72 from ament/cmake35 require CMake 3.5
  • remove trailing spaces from comparisons, obsolete quotes and explicit variable expansion
  • remove obsolete policies
  • require CMake 3.5
  • Merge pull request #54 from ament/test_working_dir support WORKING_DIRECTORY in ament_add_nose_test
  • fix WORKING_DIRECTORY for ament_add_gtest/gmock
  • follow fixes from #52
  • Merge pull request #52 from ament/add_test_append_env_option add APPEND_ENV and APPEND_LIBRARY_DIRS options to ament_add_*test macros
  • add APPEND_ENV and APPEND_LIBRARY_DIRS options to ament_add_*test macros
  • Merge pull request #50 from ament/pass_extra_env_to_tests add option to pass extra env to ament_add_*test
  • addressing comments
  • add option to pass extra env to ament_add_*test
  • Merge pull request #37 from ament/test_labels add labels to tests
  • add labels to tests
  • Merge pull request #34 from ament/prevent_gtest_in_cache refactor finding GTest / GMock
  • refactor finding GTest / GMock
  • Merge pull request #29 from ament/suppress_cmp0026 set cmp0026 to OLD until we can migrate to use \$<TARGET_FILE:...>
  • update comment and set the policy in two other places
  • Merge pull request #28 from ament/gtest_location fix location of gtest / gmock executables on Windows
  • add type as extension to test result files
  • fix location of gtest executable on Windows
  • Merge pull request #25 from ament/use_gmock_vendor optionally use gmock_vendor
  • optionally use gtest/gmock_vendor
  • Merge pull request #18 from ament/gtest_docs adding basic usage to description
  • adding basic usage documentation
  • Merge pull request #19 from ament/improve_test_runner improve test runner
  • improve test runner
  • add note that gtest target might not be created
  • fix linking of gtest libraries (regression of #16)
  • Merge pull request #16 from ament/gtest_main_libraries automatically link gtest main libraries and add an option to skip it
  • automatically link gtest main libraries and add an option to skip it
  • add explicit build type
  • disable debug output
  • add missing copyright / license information, update format of existing license information
  • update quoting of additional ament_add_test() arguments
  • use project(.. NONE)
  • refactor several low-level packages into ament_cmake_core (environment, environment_hooks, index, package_templates, symlink_install)
  • invert dependency between ament_cmake_environment and ament_cmake_environment_hooks, add dependency on ament_cmake_environment
  • deal with CMake double expansion
  • update cmake code style
  • add ament_cmake_gmock
  • add ament_cmake_environment_hooks
  • tests are always built when being enabled
  • add ament_cmake_test, ament_cmake_gtest, ament_cmake_nose
  • Contributors: Dirk Thomas, Lennart Nachtigall, Mikael Arguedas, Tully Foote, William Woodall

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Package Dependencies

System Dependencies

Name
gtest

Dependant Packages

Name Repo Deps
behaviortree_cpp github-BehaviorTree-BehaviorTree-CPP
test_bond github-ros-bond_core
class_loader github-ros-class_loader
cob_description github-4am-robotics-cob_common
control_toolbox github-ros-controls-control_toolbox
dataspeed_can_msg_filters bitbucket-dataspeedinc-dataspeed_can
dataspeed_can_tools bitbucket-dataspeedinc-dataspeed_can
dataspeed_can_usb bitbucket-dataspeedinc-dataspeed_can
depthimage_to_laserscan github-ros-perception-depthimage_to_laserscan
diagnostic_aggregator github-ros-diagnostics
diagnostic_updater github-ros-diagnostics
self_test github-ros-diagnostics
filters github-ros-filters
fmi_adapter github-boschresearch-fmi_adapter
foxglove_bridge github-foxglove-ros-foxglove-bridge
gazebo_plugins github-ros-simulation-gazebo_ros_pkgs
gazebo_ros github-ros-simulation-gazebo_ros_pkgs
geographic_msgs github-ros-geographic-info-geographic_info
geometric_shapes github-ros-planning-geometric_shapes
test_tf2 github-ros2-geometry2
tf2 github-ros2-geometry2
tf2_bullet github-ros2-geometry2
tf2_eigen github-ros2-geometry2
tf2_eigen_kdl github-ros2-geometry2
tf2_geometry_msgs github-ros2-geometry2
tf2_kdl github-ros2-geometry2
tf2_ros github-ros2-geometry2
tf2_sensor_msgs github-ros2-geometry2
grid_map_core github-ANYbotics-grid_map
grid_map_costmap_2d github-ANYbotics-grid_map
grid_map_cv github-ANYbotics-grid_map
grid_map_demos github-ANYbotics-grid_map
grid_map_filters github-ANYbotics-grid_map
grid_map_loader github-ANYbotics-grid_map
grid_map_octomap github-ANYbotics-grid_map
grid_map_pcl github-ANYbotics-grid_map
grid_map_ros github-ANYbotics-grid_map
grid_map_sdf github-ANYbotics-grid_map
grid_map_visualization github-ANYbotics-grid_map
gscam github-ros-drivers-gscam
camera_calibration_parsers github-ros-perception-image_common
camera_info_manager github-ros-perception-image_common
image_transport github-ros-perception-image_common
imu_filter_madgwick github-CCNYRoboticsLab-imu_tools
interactive_markers github-ros-visualization-interactive_markers
wiimote github-ros-drivers-joystick_drivers
laser_filters github-ros-perception-laser_filters
laser_geometry github-ros-perception-laser_geometry
swri_geometry_util github-swri-robotics-marti_common
swri_image_util github-swri-robotics-marti_common
swri_math_util github-swri-robotics-marti_common
swri_roscpp github-swri-robotics-marti_common
swri_system_util github-swri-robotics-marti_common
swri_transform_util github-swri-robotics-marti_common
libmavconn github-mavlink-mavros
mavros github-mavlink-mavros
mavros_extras github-mavlink-mavros
microstrain_inertial_driver github-LORD-MicroStrain-microstrain_inertial
moveit_core github-ros-planning-moveit2
moveit_kinematics github-ros-planning-moveit2
moveit_planners_ompl github-ros-planning-moveit2
pilz_industrial_motion_planner github-ros-planning-moveit2
moveit_hybrid_planning github-ros-planning-moveit2
moveit_ros_move_group github-ros-planning-moveit2
moveit_servo github-ros-planning-moveit2
moveit_ros_planning github-ros-planning-moveit2
moveit_ros_planning_interface github-ros-planning-moveit2
moveit_ros_robot_interaction github-ros-planning-moveit2
moveit_ros_tests github-ros-planning-moveit2
moveit_setup_app_plugins github-ros-planning-moveit2
moveit_setup_assistant github-ros-planning-moveit2
moveit_setup_controllers github-ros-planning-moveit2
moveit_setup_srdf_plugins github-ros-planning-moveit2
mvsim github-MRPT-mvsim
naoqi_libqi github-ros-naoqi-libqi
novatel_gps_driver github-swri-robotics-novatel_gps_driver
octomap_ros github-OctoMap-octomap_ros
pal_statistics github-pal-robotics-pal_statistics
pcl_conversions github-ros-perception-perception_pcl
pcl_ros github-ros-perception-perception_pcl
plotjuggler_msgs github-facontidavide-plotjuggler_msgs
pluginlib github-ros-pluginlib
pose_cov_ops github-mrpt-ros-pkg-pose_cov_ops
quaternion_operation github-OUXT-Polaris-quaternion_operation
realsense2_camera github-IntelRealSense-realsense-ros
resource_retriever github-ros-resource_retriever
robot_calibration github-mikeferguson-robot_calibration
robot_controllers github-fetchrobotics-robot_controllers
robot_localization github-cra-ros-pkg-robot_localization
robot_state_publisher github-ros-robot_state_publisher
rviz_common github-ros2-rviz
rviz_default_plugins github-ros2-rviz
rviz_rendering github-ros2-rviz
rviz_rendering_tests github-ros2-rviz
rviz_visual_testing_framework github-ros2-rviz
rviz_satellite github-nobleo-rviz_satellite
rviz_visual_tools github-PickNikRobotics-rviz_visual_tools
simple_grasping github-mikeferguson-simple_grasping
slam_toolbox github-SteveMacenski-slam_toolbox
srdfdom github-ros-planning-srdfdom
tuw_geometry github-tuw-robotics-tuw_geometry
ur_calibration github-UniversalRobots-Universal_Robots_ROS2_Driver
usb_cam github-ros-drivers-usb_cam
velodyne_driver github-ros-drivers-velodyne
velodyne_pointcloud github-ros-drivers-velodyne
vision_msgs github-ros-perception-vision_msgs
cv_bridge github-ros-perception-vision_opencv
image_geometry github-ros-perception-vision_opencv
warehouse_ros_mongo github-ros-planning-warehouse_ros_mongo
warehouse_ros_sqlite github-ros-planning-warehouse_ros_sqlite
ament_cmake_auto github-ament-ament_cmake
ament_cmake_gen_version_h github-ament-ament_cmake
ament_cmake_gmock github-ament-ament_cmake
ament_cmake_ros github-ros2-ament_cmake_ros
ament_index_cpp github-ament-ament_index
apex_test_tools gitlab-ApexAI-apex_test_tools
rclcpp_cascade_lifecycle github-fmrico-cascade_lifecycle
color_util github-MetroRobots-color_util
sensor_msgs github-ros2-common_interfaces
dataspeed_dbw_common bitbucket-dataspeedinc-dbw_ros
dataspeed_ulc_can bitbucket-dataspeedinc-dbw_ros
dbw_fca_can bitbucket-dataspeedinc-dbw_ros
dbw_ford_can bitbucket-dataspeedinc-dbw_ros
dbw_polaris_can bitbucket-dataspeedinc-dbw_ros
ds_dbw_can bitbucket-dataspeedinc-dbw_ros
dummy_map_server github-ros2-demos
dummy_robot_bringup github-ros2-demos
dummy_sensors github-ros2-demos
dolly_tests github-chapulina-dolly
gazebo_ros2_control github-ros-simulation-gazebo_ros2_control
gazebo_ros2_control_demos github-ros-simulation-gazebo_ros2_control
test_launch_testing github-ros2-launch
libstatistics_collector github-ros-tooling-libstatistics_collector
libyaml_vendor github-ros2-libyaml_vendor
message_filters github-ros2-message_filters
micro_ros_diagnostic_bridge github-micro-ROS-micro_ros_diagnostics
micro_ros_diagnostic_updater github-micro-ROS-micro_ros_diagnostics
nav2_behavior_tree github-ros-planning-navigation2
nav2_behaviors github-ros-planning-navigation2
nav2_bringup github-ros-planning-navigation2
nav2_collision_monitor github-ros-planning-navigation2
nav2_constrained_smoother github-ros-planning-navigation2
nav2_controller github-ros-planning-navigation2
nav2_core github-ros-planning-navigation2
nav2_costmap_2d github-ros-planning-navigation2
costmap_queue github-ros-planning-navigation2
dwb_core github-ros-planning-navigation2
dwb_critics github-ros-planning-navigation2
dwb_plugins github-ros-planning-navigation2
nav_2d_utils github-ros-planning-navigation2
nav2_graceful_controller github-ros-planning-navigation2
nav2_lifecycle_manager github-ros-planning-navigation2
nav2_map_server github-ros-planning-navigation2
nav2_mppi_controller github-ros-planning-navigation2
nav2_navfn_planner github-ros-planning-navigation2
nav2_regulated_pure_pursuit_controller github-ros-planning-navigation2
nav2_rotation_shim_controller github-ros-planning-navigation2
nav2_smac_planner github-ros-planning-navigation2
nav2_smoother github-ros-planning-navigation2
nav2_system_tests github-ros-planning-navigation2
nav2_theta_star_planner github-ros-planning-navigation2
nav2_util github-ros-planning-navigation2
nav2_velocity_smoother github-ros-planning-navigation2
nav2_voxel_grid github-ros-planning-navigation2
nav2_waypoint_follower github-ros-planning-navigation2
ouxt_lint_common github-OUXT-Polaris-ouxt_common
performance_test gitlab-ApexAI-performance_test
point_cloud_msg_wrapper gitlab-ApexAI-point_cloud_msg_wrapper
rcl github-ros2-rcl
rcl_action github-ros2-rcl
rcl_lifecycle github-ros2-rcl
rcl_yaml_param_parser github-ros2-rcl
test_msgs github-ros2-rcl_interfaces
rcl_logging_noop github-ros2-rcl_logging
rclc github-ros2-rclc
rclc_lifecycle github-ros2-rclc
rclc_parameter github-ros2-rclc
rclcpp github-ros2-rclcpp
rclcpp_action github-ros2-rclcpp
rclcpp_components github-ros2-rclcpp
rclcpp_lifecycle github-ros2-rclcpp
rclpy github-ros2-rclpy
rcpputils github-ros2-rcpputils
rcutils github-ros2-rcutils
rttest github-ros2-realtime_support
tlsf_cpp github-ros2-realtime_support
rmw_fastrtps_cpp github-ros2-rmw_fastrtps
rmw_fastrtps_dynamic_cpp github-ros2-rmw_fastrtps
rmw_implementation github-ros2-rmw_implementation
test_rmw_implementation github-ros2-rmw_implementation
ros1_bridge github-ros2-ros1_bridge
joint_limits github-ros-controls-ros2_control
joint_limits_interface github-ros-controls-ros2_control
plansys2_bt_actions github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_core github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_domain_expert github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_executor github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_lifecycle_manager github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_pddl_parser github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_planner github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_popf_plan_solver github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_problem_expert github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_terminal github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_tests github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_tools github-IntelligentRoboticsLabs-ros2_planning_system
ros2_socketcan github-autowarefoundation-ros2_socketcan
test_tracetools github-ros2-ros2_tracing
tracetools github-ros2-ros2_tracing
rosbag2_storage github-ros2-rosbag2
rosidl_generator_c github-ros2-rosidl
rosidl_generator_cpp github-ros2-rosidl
rosidl_runtime_cpp github-ros2-rosidl
rosidl_typesupport_interface github-ros2-rosidl
rosidl_typesupport_introspection_tests github-ros2-rosidl
rosidl_typesupport_fastrtps_c github-ros2-rosidl_typesupport_fastrtps
rosidl_typesupport_fastrtps_cpp github-ros2-rosidl_typesupport_fastrtps
system_modes github-micro-ROS-system_modes
system_modes_examples github-micro-ROS-system_modes
test_communication github-ros2-system_tests
test_quality_of_service github-ros2-system_tests
test_rclcpp github-ros2-system_tests
test_security github-ros2-system_tests
asio_cmake_module github-ros-drivers-transport_drivers
io_context github-ros-drivers-transport_drivers
serial_driver github-ros-drivers-transport_drivers
udp_driver github-ros-drivers-transport_drivers
ros_core github-ros2-variants
foros github-42dot-foros
nao_lola github-ros-sports-nao_lola
rcss3d_agent github-ros-sports-rcss3d_agent
rqt_image_overlay github-ros-sports-rqt_image_overlay
sdformat_urdf github-ros-sdformat_urdf
slg_msgs github-ajtudela-slg_msgs
soccer_marker_generation github-ijnek-soccer_visualization
topic_tools github-ros-tooling-topic_tools
bcr_bot github-blackcoffeerobotics-bcr_bot
qb_softhand_industry_ros2_control bitbucket-qbrobotics-qbshin-ros
tcb_span github-PickNikRobotics-cpp_polyfills
data_tamer_cpp github-PickNikRobotics-data_tamer
event_camera_codecs github-ros-event-camera-event_camera_codecs
parameter_traits github-PickNikRobotics-generate_parameter_library
ign_ros2_control_demos github-ros-controls-gz_ros2_control
mola_bridge_ros2 github-MOLAorg-mola
mola_demos github-MOLAorg-mola
mola_launcher github-MOLAorg-mola
mola_metric_maps github-MOLAorg-mola
mola_common github-MOLAorg-mola_common
mola_test_datasets github-MOLAorg-mola_test_datasets
open3d_conversions github-ros-perception-perception_open3d
ros_gz_bridge github-gazebosim-ros_gz
test_ros_gz_bridge github-gazebosim-ros_gz
as2_platform_dji_osdk github-aerostack2-aerostack2
as2_core github-aerostack2-aerostack2
as2_motion_controller github-aerostack2-aerostack2
affordance_primitives github-PickNikRobotics-affordance_primitives
metro_benchmark_pub github-MetroRobots-metrics_msgs
mocap4r2_control github-MOCAP4ROS2-Project-mocap4r2
mocap4r2_dummy_driver github-MOCAP4ROS2-Project-mocap4r2
off_highway_can github-bosch-engineering-off_highway_sensor_drivers
play_motion2 github-pal-robotics-play_motion2
tiago_gazebo github-pal-robotics-tiago_simulation

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged ament_cmake_gtest at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 2.0.4
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ament/ament_cmake.git
VCS Type git
VCS Version iron
Last Updated 2024-03-03
Dev Status DEVELOPED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

The ability to add gtest-based tests in the ament buildsystem in CMake.

Additional Links

No additional links.

Maintainers

  • Michael Jeronimo

Authors

  • Dirk Thomas
  • Michel Hidalgo
README
No README found. No README in repository either.
CHANGELOG

Changelog for package ament_cmake_gtest

2.0.4 (2024-02-07)

2.0.3 (2023-06-22)

2.0.2 (2023-04-12)

2.0.1 (2023-04-11)

2.0.0 (2023-04-11)

1.5.3 (2023-02-13)

  • Fix compiler warnings related to gtest/gmock (#408) * Suppress compiler warnings when building gmock definition of implicit copy constructor ... is deprecated because it has a user-declared copy assignment operator [-Wdeprecated-copy]

    • Declare gtest/gmock include dirs as SYSTEM PRIVATE for test targets
  • [rolling] Update maintainers - 2022-11-07 (#411)

    • Update maintainers to Michael Jeronimo
  • Contributors: Audrow Nash, Robert Haschke

1.5.2 (2022-11-02)

1.5.1 (2022-09-13)

1.5.0 (2022-07-11)

1.4.0 (2022-04-29)

1.3.1 (2022-03-28)

1.3.0 (2022-02-17)

  • Update forthcoming version in changelog
  • Contributors: Audrow Nash

1.2.1 (2022-01-14)

  • Update maintainers to Michael Jeronimo and Michel Hidalgo (#362)
  • Contributors: Audrow Nash

1.2.0 (2021-10-29)

  • Use FindPython3 instead of FindPythonInterp (#355)
  • Update maintainers (#336)
  • Contributors: Chris Lalancette, Shane Loretz

1.1.4 (2021-05-06)

1.1.3 (2021-03-09)

1.1.2 (2021-02-26 22:59)

1.1.1 (2021-02-26 19:12)

1.1.0 (2021-02-24)

1.0.4 (2021-01-25)

1.0.3 (2020-12-10)

1.0.2 (2020-12-07)

  • Update package maintainers. (#286)
  • Contributors: Michel Hidalgo

1.0.1 (2020-09-10)

  • [ament_cmake_gtest] ensure gtest to consume the correct headers. (#267)
    • ensure gtest to consume the correct headers.
    • add another patch.
  • Contributors: Sean Yen

1.0.0 (2020-07-22)

0.9.6 (2020-06-23)

0.9.5 (2020-06-02)

0.9.4 (2020-05-26)

0.9.3 (2020-05-19)

0.9.2 (2020-05-07)

0.9.1 (2020-04-24 15:45)

0.9.0 (2020-04-24 12:25)

0.8.1 (2019-10-23)

0.8.0 (2019-10-04)

  • Revert \"Add gtest and gmock headers as system headers: (#175)\" (#184) This reverts commit e1ff1c1a0a1e08d43e939cdb943a88be601808bd.
  • Add gtest and gmock headers as system headers: (#175) Certain gtest and gmock header files contain constructs which generate warnings when certain compile flags are enabled. By including the header files as system headers, the compiler knows that it doesn\'t need to generate these warnings since they are coming from (third-party) system headers
  • Add runner option to ament_add_test (#174)
    • ament_cmake allow speficiation of a different test runner
    • By default, still uses run_test.py
    • Example use case: ament_cmake_ros can use a test runner that sets a ROS_DOMAIN_ID
    • ament_cmake move run_test.py to a python module
    • This should let us see the history
    • ament_cmake refactor run_test.py into an importable python module
    • Adds an ament_cmake_test python package
  • Contributors: Peter Baughman, Shane Loretz, jpsamper2009

0.7.3 (2019-05-29)

0.7.2 (2019-05-20)

0.7.1 (2019-05-07)

  • Fix unused-arg check in ament_cmake packages: (#167) Arguments to a macro are not variables, so it\'s not possible to do \'if(ARGN)\' to check for arguments; however, copying ARGN to a variable works.
  • Contributors: jpsamper2009

0.7.0 (2019-04-08)

0.6.0 (2018-11-13)

0.5.1 (2018-07-17)

0.5.0 (2018-06-13)

0.4.0 (2017-12-08)

  • 0.0.3
  • Merge pull request #104 from ament/googletest update to googletest 1.8
  • update to googletest 1.8
  • 0.0.2
  • Merge pull request #86 from ament/remove_include remove unnecessary include
  • remove unnecessary include
  • Merge pull request #85 from ament/split_gtest_function Split ament_add_gtest function
  • refactor ament_add_gtest to be composed out of two separate functions to create the executable and register it as a test
  • duplicate ament_add_gtest.cmake before refactoring it
  • add missing doc for SKIP_TEST
  • Merge pull request #82 from firesurfer/master Fixed rebasing error, fixed indentation, looking for pthread on non w...
  • removed GTEST argument form target_link_libraries
  • Fixed rebasing error, fixed indentation, looking for pthread on non windows systems
  • Skipped tests (#80)
    • support skipping tests
    • add SKIP_TEST to ament_add_nose_test
    • use keyword args not positional
    • discard positional args after first
  • update schema url
  • add schema to manifest files
  • Merge pull request #72 from ament/cmake35 require CMake 3.5
  • remove trailing spaces from comparisons, obsolete quotes and explicit variable expansion
  • remove obsolete policies
  • require CMake 3.5
  • Merge pull request #54 from ament/test_working_dir support WORKING_DIRECTORY in ament_add_nose_test
  • fix WORKING_DIRECTORY for ament_add_gtest/gmock
  • follow fixes from #52
  • Merge pull request #52 from ament/add_test_append_env_option add APPEND_ENV and APPEND_LIBRARY_DIRS options to ament_add_*test macros
  • add APPEND_ENV and APPEND_LIBRARY_DIRS options to ament_add_*test macros
  • Merge pull request #50 from ament/pass_extra_env_to_tests add option to pass extra env to ament_add_*test
  • addressing comments
  • add option to pass extra env to ament_add_*test
  • Merge pull request #37 from ament/test_labels add labels to tests
  • add labels to tests
  • Merge pull request #34 from ament/prevent_gtest_in_cache refactor finding GTest / GMock
  • refactor finding GTest / GMock
  • Merge pull request #29 from ament/suppress_cmp0026 set cmp0026 to OLD until we can migrate to use \$<TARGET_FILE:...>
  • update comment and set the policy in two other places
  • Merge pull request #28 from ament/gtest_location fix location of gtest / gmock executables on Windows
  • add type as extension to test result files
  • fix location of gtest executable on Windows
  • Merge pull request #25 from ament/use_gmock_vendor optionally use gmock_vendor
  • optionally use gtest/gmock_vendor
  • Merge pull request #18 from ament/gtest_docs adding basic usage to description
  • adding basic usage documentation
  • Merge pull request #19 from ament/improve_test_runner improve test runner
  • improve test runner
  • add note that gtest target might not be created
  • fix linking of gtest libraries (regression of #16)
  • Merge pull request #16 from ament/gtest_main_libraries automatically link gtest main libraries and add an option to skip it
  • automatically link gtest main libraries and add an option to skip it
  • add explicit build type
  • disable debug output
  • add missing copyright / license information, update format of existing license information
  • update quoting of additional ament_add_test() arguments
  • use project(.. NONE)
  • refactor several low-level packages into ament_cmake_core (environment, environment_hooks, index, package_templates, symlink_install)
  • invert dependency between ament_cmake_environment and ament_cmake_environment_hooks, add dependency on ament_cmake_environment
  • deal with CMake double expansion
  • update cmake code style
  • add ament_cmake_gmock
  • add ament_cmake_environment_hooks
  • tests are always built when being enabled
  • add ament_cmake_test, ament_cmake_gtest, ament_cmake_nose
  • Contributors: Dirk Thomas, Lennart Nachtigall, Mikael Arguedas, Tully Foote, William Woodall

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Package Dependencies

System Dependencies

Name
gtest

Dependant Packages

Name Repo Deps
angles github-ros-angles
behaviortree_cpp github-BehaviorTree-BehaviorTree-CPP
test_bond github-ros-bond_core
class_loader github-ros-class_loader
control_toolbox github-ros-controls-control_toolbox
depthimage_to_laserscan github-ros-perception-depthimage_to_laserscan
diagnostic_aggregator github-ros-diagnostics
diagnostic_updater github-ros-diagnostics
self_test github-ros-diagnostics
ecl_command_line github-stonier-ecl_core
ecl_concepts github-stonier-ecl_core
ecl_containers github-stonier-ecl_core
ecl_converters github-stonier-ecl_core
ecl_devices github-stonier-ecl_core
ecl_filesystem github-stonier-ecl_core
ecl_geometry github-stonier-ecl_core
ecl_ipc github-stonier-ecl_core
ecl_linear_algebra github-stonier-ecl_core
ecl_manipulators github-stonier-ecl_core
ecl_math github-stonier-ecl_core
ecl_mobile_robot github-stonier-ecl_core
ecl_mpl github-stonier-ecl_core
ecl_sigslots github-stonier-ecl_core
ecl_statistics github-stonier-ecl_core
ecl_streams github-stonier-ecl_core
ecl_threads github-stonier-ecl_core
ecl_time github-stonier-ecl_core
ecl_type_traits github-stonier-ecl_core
ecl_utilities github-stonier-ecl_core
ecl_config github-stonier-ecl_lite
ecl_converters_lite github-stonier-ecl_lite
filters github-ros-filters
fmi_adapter github-boschresearch-fmi_adapter
foxglove_bridge github-foxglove-ros-foxglove-bridge
fuse_constraints github-locusrobotics-fuse
fuse_core github-locusrobotics-fuse
fuse_graphs github-locusrobotics-fuse
fuse_loss github-locusrobotics-fuse
fuse_models github-locusrobotics-fuse
fuse_optimizers github-locusrobotics-fuse
fuse_publishers github-locusrobotics-fuse
fuse_variables github-locusrobotics-fuse
gazebo_plugins github-ros-simulation-gazebo_ros_pkgs
gazebo_ros github-ros-simulation-gazebo_ros_pkgs
geographic_msgs github-ros-geographic-info-geographic_info
geometric_shapes github-ros-planning-geometric_shapes
test_tf2 github-ros2-geometry2
tf2 github-ros2-geometry2
tf2_bullet github-ros2-geometry2
tf2_eigen github-ros2-geometry2
tf2_eigen_kdl github-ros2-geometry2
tf2_geometry_msgs github-ros2-geometry2
tf2_kdl github-ros2-geometry2
tf2_ros github-ros2-geometry2
tf2_sensor_msgs github-ros2-geometry2
grid_map_core github-ANYbotics-grid_map
grid_map_costmap_2d github-ANYbotics-grid_map
grid_map_cv github-ANYbotics-grid_map
grid_map_demos github-ANYbotics-grid_map
grid_map_filters github-ANYbotics-grid_map
grid_map_loader github-ANYbotics-grid_map
grid_map_octomap github-ANYbotics-grid_map
grid_map_pcl github-ANYbotics-grid_map
grid_map_ros github-ANYbotics-grid_map
grid_map_sdf github-ANYbotics-grid_map
grid_map_visualization github-ANYbotics-grid_map
gscam github-ros-drivers-gscam
camera_calibration_parsers github-ros-perception-image_common
camera_info_manager github-ros-perception-image_common
image_transport github-ros-perception-image_common
compressed_depth_image_transport github-ros-perception-image_transport_plugins
imu_filter_madgwick github-CCNYRoboticsLab-imu_tools
interactive_markers github-ros-visualization-interactive_markers
wiimote github-ros-drivers-joystick_drivers
kdl_parser github-ros-kdl_parser
laser_filters github-ros-perception-laser_filters
laser_geometry github-ros-perception-laser_geometry
swri_geometry_util github-swri-robotics-marti_common
swri_image_util github-swri-robotics-marti_common
swri_math_util github-swri-robotics-marti_common
swri_roscpp github-swri-robotics-marti_common
swri_system_util github-swri-robotics-marti_common
swri_transform_util github-swri-robotics-marti_common
libmavconn github-mavlink-mavros
mavros github-mavlink-mavros
mavros_extras github-mavlink-mavros
microstrain_inertial_driver github-LORD-MicroStrain-microstrain_inertial
moveit_core github-ros-planning-moveit2
moveit_kinematics github-ros-planning-moveit2
moveit_planners_ompl github-ros-planning-moveit2
pilz_industrial_motion_planner github-ros-planning-moveit2
moveit_hybrid_planning github-ros-planning-moveit2
moveit_ros_move_group github-ros-planning-moveit2
moveit_servo github-ros-planning-moveit2
moveit_ros_planning github-ros-planning-moveit2
moveit_ros_planning_interface github-ros-planning-moveit2
moveit_ros_robot_interaction github-ros-planning-moveit2
moveit_ros_tests github-ros-planning-moveit2
moveit_setup_app_plugins github-ros-planning-moveit2
moveit_setup_assistant github-ros-planning-moveit2
moveit_setup_controllers github-ros-planning-moveit2
moveit_setup_srdf_plugins github-ros-planning-moveit2
mvsim github-MRPT-mvsim
naoqi_libqi github-ros-naoqi-libqi
novatel_gps_driver github-swri-robotics-novatel_gps_driver
octomap_ros github-OctoMap-octomap_ros
pcl_conversions github-ros-perception-perception_pcl
pcl_ros github-ros-perception-perception_pcl
plotjuggler_msgs github-facontidavide-plotjuggler_msgs
pluginlib github-ros-pluginlib
pose_cov_ops github-mrpt-ros-pkg-pose_cov_ops
quaternion_operation github-OUXT-Polaris-quaternion_operation
realsense2_camera github-IntelRealSense-realsense-ros
resource_retriever github-ros-resource_retriever
robot_calibration github-mikeferguson-robot_calibration
robot_localization github-cra-ros-pkg-robot_localization
robot_state_publisher github-ros-robot_state_publisher
rviz_common github-ros2-rviz
rviz_default_plugins github-ros2-rviz
rviz_rendering github-ros2-rviz
rviz_rendering_tests github-ros2-rviz
rviz_visual_testing_framework github-ros2-rviz
rviz_satellite github-nobleo-rviz_satellite
rviz_visual_tools github-PickNikRobotics-rviz_visual_tools
slam_toolbox github-SteveMacenski-slam_toolbox
srdfdom github-ros-planning-srdfdom
tf2_2d github-locusrobotics-tf2_2d
tuw_geometry github-tuw-robotics-tuw_geometry
ur_calibration github-UniversalRobots-Universal_Robots_ROS2_Driver
usb_cam github-ros-drivers-usb_cam
velodyne_driver github-ros-drivers-velodyne
velodyne_pointcloud github-ros-drivers-velodyne
vision_msgs github-ros-perception-vision_msgs
cv_bridge github-ros-perception-vision_opencv
image_geometry github-ros-perception-vision_opencv
warehouse_ros_mongo github-ros-planning-warehouse_ros_mongo
warehouse_ros_sqlite github-ros-planning-warehouse_ros_sqlite
ament_cmake_auto github-ament-ament_cmake
ament_cmake_gen_version_h github-ament-ament_cmake
ament_cmake_gmock github-ament-ament_cmake
ament_cmake_ros github-ros2-ament_cmake_ros
ament_index_cpp github-ament-ament_index
apex_test_tools gitlab-ApexAI-apex_test_tools
rclcpp_cascade_lifecycle github-fmrico-cascade_lifecycle
color_util github-MetroRobots-color_util
sensor_msgs github-ros2-common_interfaces
dummy_map_server github-ros2-demos
dummy_robot_bringup github-ros2-demos
dummy_sensors github-ros2-demos
dolly_tests github-chapulina-dolly
gazebo_ros2_control github-ros-simulation-gazebo_ros2_control
gazebo_ros2_control_demos github-ros-simulation-gazebo_ros2_control
test_launch_testing github-ros2-launch
libstatistics_collector github-ros-tooling-libstatistics_collector
libyaml_vendor github-ros2-libyaml_vendor
message_filters github-ros2-message_filters
micro_ros_diagnostic_bridge github-micro-ROS-micro_ros_diagnostics
micro_ros_diagnostic_updater github-micro-ROS-micro_ros_diagnostics
nav2_behavior_tree github-ros-planning-navigation2
nav2_behaviors github-ros-planning-navigation2
nav2_bringup github-ros-planning-navigation2
nav2_collision_monitor github-ros-planning-navigation2
nav2_constrained_smoother github-ros-planning-navigation2
nav2_controller github-ros-planning-navigation2
nav2_core github-ros-planning-navigation2
nav2_costmap_2d github-ros-planning-navigation2
costmap_queue github-ros-planning-navigation2
dwb_core github-ros-planning-navigation2
dwb_critics github-ros-planning-navigation2
dwb_plugins github-ros-planning-navigation2
nav_2d_utils github-ros-planning-navigation2
nav2_lifecycle_manager github-ros-planning-navigation2
nav2_map_server github-ros-planning-navigation2
nav2_mppi_controller github-ros-planning-navigation2
nav2_navfn_planner github-ros-planning-navigation2
nav2_regulated_pure_pursuit_controller github-ros-planning-navigation2
nav2_rotation_shim_controller github-ros-planning-navigation2
nav2_smac_planner github-ros-planning-navigation2
nav2_smoother github-ros-planning-navigation2
nav2_system_tests github-ros-planning-navigation2
nav2_theta_star_planner github-ros-planning-navigation2
nav2_util github-ros-planning-navigation2
nav2_velocity_smoother github-ros-planning-navigation2
nav2_voxel_grid github-ros-planning-navigation2
nav2_waypoint_follower github-ros-planning-navigation2
ouxt_lint_common github-OUXT-Polaris-ouxt_common
performance_test gitlab-ApexAI-performance_test
point_cloud_msg_wrapper gitlab-ApexAI-point_cloud_msg_wrapper
rcl github-ros2-rcl
rcl_action github-ros2-rcl
rcl_lifecycle github-ros2-rcl
rcl_yaml_param_parser github-ros2-rcl
test_msgs github-ros2-rcl_interfaces
rcl_logging_noop github-ros2-rcl_logging
rclc github-ros2-rclc
rclc_lifecycle github-ros2-rclc
rclc_parameter github-ros2-rclc
rclcpp github-ros2-rclcpp
rclcpp_action github-ros2-rclcpp
rclcpp_components github-ros2-rclcpp
rclcpp_lifecycle github-ros2-rclcpp
rclpy github-ros2-rclpy
rcpputils github-ros2-rcpputils
rcutils github-ros2-rcutils
rttest github-ros2-realtime_support
tlsf_cpp github-ros2-realtime_support
rmw_fastrtps_cpp github-ros2-rmw_fastrtps
rmw_fastrtps_dynamic_cpp github-ros2-rmw_fastrtps
rmw_implementation github-ros2-rmw_implementation
test_rmw_implementation github-ros2-rmw_implementation
ros1_bridge github-ros2-ros1_bridge
joint_limits github-ros-controls-ros2_control
joint_limits_interface github-ros-controls-ros2_control
plansys2_bt_actions github-PlanSys2-ros2_planning_system
plansys2_core github-PlanSys2-ros2_planning_system
plansys2_domain_expert github-PlanSys2-ros2_planning_system
plansys2_executor github-PlanSys2-ros2_planning_system
plansys2_lifecycle_manager github-PlanSys2-ros2_planning_system
plansys2_pddl_parser github-PlanSys2-ros2_planning_system
plansys2_planner github-PlanSys2-ros2_planning_system
plansys2_popf_plan_solver github-PlanSys2-ros2_planning_system
plansys2_problem_expert github-PlanSys2-ros2_planning_system
plansys2_terminal github-PlanSys2-ros2_planning_system
plansys2_tests github-PlanSys2-ros2_planning_system
plansys2_tools github-PlanSys2-ros2_planning_system
ros2_socketcan github-autowarefoundation-ros2_socketcan
test_tracetools github-ros2-ros2_tracing
tracetools github-ros2-ros2_tracing
rosbag2_performance_benchmarking_msgs github-ros2-rosbag2
rosbag2_storage github-ros2-rosbag2
rosidl_generator_tests github-ros2-rosidl
rosidl_runtime_cpp github-ros2-rosidl
rosidl_typesupport_interface github-ros2-rosidl
rosidl_typesupport_introspection_tests github-ros2-rosidl
rosidl_typesupport_tests github-ros2-rosidl_typesupport
rosidl_typesupport_fastrtps_c github-ros2-rosidl_typesupport_fastrtps
rosidl_typesupport_fastrtps_cpp github-ros2-rosidl_typesupport_fastrtps
system_modes github-micro-ROS-system_modes
system_modes_examples github-micro-ROS-system_modes
test_communication github-ros2-system_tests
test_quality_of_service github-ros2-system_tests
test_rclcpp github-ros2-system_tests
test_security github-ros2-system_tests
asio_cmake_module github-ros-drivers-transport_drivers
io_context github-ros-drivers-transport_drivers
serial_driver github-ros-drivers-transport_drivers
udp_driver github-ros-drivers-transport_drivers
ros_core github-ros2-variants
nao_lola github-ros-sports-nao_lola
rcss3d_agent github-ros-sports-rcss3d_agent
ros_image_to_qimage github-ros-sports-ros_image_to_qimage
rqt_image_overlay github-ros-sports-rqt_image_overlay
sdformat_urdf github-ros-sdformat_urdf
soccer_marker_generation github-ijnek-soccer_visualization
topic_tools github-ros-tooling-topic_tools
tcb_span github-PickNikRobotics-cpp_polyfills
event_camera_codecs github-ros-event-camera-event_camera_codecs
parameter_traits github-PickNikRobotics-generate_parameter_library
gz_ros2_control_demos github-ros-controls-gz_ros2_control
gz_ros2_control_tests github-ros-controls-gz_ros2_control
mola_bridge_ros2 github-MOLAorg-mola
mola_demos github-MOLAorg-mola
mola_launcher github-MOLAorg-mola
mola_metric_maps github-MOLAorg-mola
mola_common github-MOLAorg-mola_common
mola_test_datasets github-MOLAorg-mola_test_datasets
open3d_conversions github-ros-perception-perception_open3d
rcl_logging_rcutils github-sloretz-rcl_logging_rcutils
rcss3d_nao github-ros-sports-rcss3d_nao
ros_gz_bridge github-gazebosim-ros_gz
test_ros_gz_bridge github-gazebosim-ros_gz

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged ament_cmake_gtest at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 2.3.2
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ament/ament_cmake.git
VCS Type git
VCS Version rolling
Last Updated 2024-03-13
Dev Status DEVELOPED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

The ability to add gtest-based tests in the ament buildsystem in CMake.

Additional Links

No additional links.

Maintainers

  • Chris Lalancette

Authors

  • Dirk Thomas
  • Michel Hidalgo
README
No README found. No README in repository either.
CHANGELOG

Changelog for package ament_cmake_gtest

2.3.2 (2023-12-26)

  • Split ament_add_gmock into _executable and _test. (#497)
  • ament_add_gtest_test: add TEST_NAME parameter (#492)
  • Contributors: Chris Lalancette, Christopher Wecht

2.3.1 (2023-11-06)

2.3.0 (2023-09-07)

2.2.2 (2023-08-21)

2.2.1 (2023-06-21)

2.2.0 (2023-06-07)

2.1.0 (2023-04-26)

2.0.2 (2023-04-12)

2.0.1 (2023-04-11)

2.0.0 (2023-04-11)

1.5.3 (2023-02-13)

  • Fix compiler warnings related to gtest/gmock (#408) * Suppress compiler warnings when building gmock definition of implicit copy constructor ... is deprecated because it has a user-declared copy assignment operator [-Wdeprecated-copy]

    • Declare gtest/gmock include dirs as SYSTEM PRIVATE for test targets
  • [rolling] Update maintainers - 2022-11-07 (#411)

    • Update maintainers to Michael Jeronimo
  • Contributors: Audrow Nash, Robert Haschke

1.5.2 (2022-11-02)

1.5.1 (2022-09-13)

1.5.0 (2022-07-11)

1.4.0 (2022-04-29)

1.3.1 (2022-03-28)

1.3.0 (2022-02-17)

  • Update forthcoming version in changelog
  • Contributors: Audrow Nash

1.2.1 (2022-01-14)

  • Update maintainers to Michael Jeronimo and Michel Hidalgo (#362)
  • Contributors: Audrow Nash

1.2.0 (2021-10-29)

  • Use FindPython3 instead of FindPythonInterp (#355)
  • Update maintainers (#336)
  • Contributors: Chris Lalancette, Shane Loretz

1.1.4 (2021-05-06)

1.1.3 (2021-03-09)

1.1.2 (2021-02-26 22:59)

1.1.1 (2021-02-26 19:12)

1.1.0 (2021-02-24)

1.0.4 (2021-01-25)

1.0.3 (2020-12-10)

1.0.2 (2020-12-07)

  • Update package maintainers. (#286)
  • Contributors: Michel Hidalgo

1.0.1 (2020-09-10)

  • [ament_cmake_gtest] ensure gtest to consume the correct headers. (#267)
    • ensure gtest to consume the correct headers.
    • add another patch.
  • Contributors: Sean Yen

1.0.0 (2020-07-22)

0.9.6 (2020-06-23)

0.9.5 (2020-06-02)

0.9.4 (2020-05-26)

0.9.3 (2020-05-19)

0.9.2 (2020-05-07)

0.9.1 (2020-04-24 15:45)

0.9.0 (2020-04-24 12:25)

0.8.1 (2019-10-23)

0.8.0 (2019-10-04)

  • Revert \"Add gtest and gmock headers as system headers: (#175)\" (#184) This reverts commit e1ff1c1a0a1e08d43e939cdb943a88be601808bd.
  • Add gtest and gmock headers as system headers: (#175) Certain gtest and gmock header files contain constructs which generate warnings when certain compile flags are enabled. By including the header files as system headers, the compiler knows that it doesn\'t need to generate these warnings since they are coming from (third-party) system headers
  • Add runner option to ament_add_test (#174)
    • ament_cmake allow speficiation of a different test runner
    • By default, still uses run_test.py
    • Example use case: ament_cmake_ros can use a test runner that sets a ROS_DOMAIN_ID
    • ament_cmake move run_test.py to a python module
    • This should let us see the history
    • ament_cmake refactor run_test.py into an importable python module
    • Adds an ament_cmake_test python package
  • Contributors: Peter Baughman, Shane Loretz, jpsamper2009

0.7.3 (2019-05-29)

0.7.2 (2019-05-20)

0.7.1 (2019-05-07)

  • Fix unused-arg check in ament_cmake packages: (#167) Arguments to a macro are not variables, so it\'s not possible to do \'if(ARGN)\' to check for arguments; however, copying ARGN to a variable works.
  • Contributors: jpsamper2009

0.7.0 (2019-04-08)

0.6.0 (2018-11-13)

0.5.1 (2018-07-17)

0.5.0 (2018-06-13)

0.4.0 (2017-12-08)

  • 0.0.3
  • Merge pull request #104 from ament/googletest update to googletest 1.8
  • update to googletest 1.8
  • 0.0.2
  • Merge pull request #86 from ament/remove_include remove unnecessary include
  • remove unnecessary include
  • Merge pull request #85 from ament/split_gtest_function Split ament_add_gtest function
  • refactor ament_add_gtest to be composed out of two separate functions to create the executable and register it as a test
  • duplicate ament_add_gtest.cmake before refactoring it
  • add missing doc for SKIP_TEST
  • Merge pull request #82 from firesurfer/master Fixed rebasing error, fixed indentation, looking for pthread on non w...
  • removed GTEST argument form target_link_libraries
  • Fixed rebasing error, fixed indentation, looking for pthread on non windows systems
  • Skipped tests (#80)
    • support skipping tests
    • add SKIP_TEST to ament_add_nose_test
    • use keyword args not positional
    • discard positional args after first
  • update schema url
  • add schema to manifest files
  • Merge pull request #72 from ament/cmake35 require CMake 3.5
  • remove trailing spaces from comparisons, obsolete quotes and explicit variable expansion
  • remove obsolete policies
  • require CMake 3.5
  • Merge pull request #54 from ament/test_working_dir support WORKING_DIRECTORY in ament_add_nose_test
  • fix WORKING_DIRECTORY for ament_add_gtest/gmock
  • follow fixes from #52
  • Merge pull request #52 from ament/add_test_append_env_option add APPEND_ENV and APPEND_LIBRARY_DIRS options to ament_add_*test macros
  • add APPEND_ENV and APPEND_LIBRARY_DIRS options to ament_add_*test macros
  • Merge pull request #50 from ament/pass_extra_env_to_tests add option to pass extra env to ament_add_*test
  • addressing comments
  • add option to pass extra env to ament_add_*test
  • Merge pull request #37 from ament/test_labels add labels to tests
  • add labels to tests
  • Merge pull request #34 from ament/prevent_gtest_in_cache refactor finding GTest / GMock
  • refactor finding GTest / GMock
  • Merge pull request #29 from ament/suppress_cmp0026 set cmp0026 to OLD until we can migrate to use \$<TARGET_FILE:...>
  • update comment and set the policy in two other places
  • Merge pull request #28 from ament/gtest_location fix location of gtest / gmock executables on Windows
  • add type as extension to test result files
  • fix location of gtest executable on Windows
  • Merge pull request #25 from ament/use_gmock_vendor optionally use gmock_vendor
  • optionally use gtest/gmock_vendor
  • Merge pull request #18 from ament/gtest_docs adding basic usage to description
  • adding basic usage documentation
  • Merge pull request #19 from ament/improve_test_runner improve test runner
  • improve test runner
  • add note that gtest target might not be created
  • fix linking of gtest libraries (regression of #16)
  • Merge pull request #16 from ament/gtest_main_libraries automatically link gtest main libraries and add an option to skip it
  • automatically link gtest main libraries and add an option to skip it
  • add explicit build type
  • disable debug output
  • add missing copyright / license information, update format of existing license information
  • update quoting of additional ament_add_test() arguments
  • use project(.. NONE)
  • refactor several low-level packages into ament_cmake_core (environment, environment_hooks, index, package_templates, symlink_install)
  • invert dependency between ament_cmake_environment and ament_cmake_environment_hooks, add dependency on ament_cmake_environment
  • deal with CMake double expansion
  • update cmake code style
  • add ament_cmake_gmock
  • add ament_cmake_environment_hooks
  • tests are always built when being enabled
  • add ament_cmake_test, ament_cmake_gtest, ament_cmake_nose
  • Contributors: Dirk Thomas, Lennart Nachtigall, Mikael Arguedas, Tully Foote, William Woodall

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Package Dependencies

System Dependencies

Name
gtest

Dependant Packages

Name Repo Deps
angles github-ros-angles
behaviortree_cpp github-BehaviorTree-BehaviorTree-CPP
test_bond github-ros-bond_core
class_loader github-ros-class_loader
control_toolbox github-ros-controls-control_toolbox
depthimage_to_laserscan github-ros-perception-depthimage_to_laserscan
diagnostic_aggregator github-ros-diagnostics
diagnostic_updater github-ros-diagnostics
self_test github-ros-diagnostics
ecl_command_line github-stonier-ecl_core
ecl_concepts github-stonier-ecl_core
ecl_containers github-stonier-ecl_core
ecl_converters github-stonier-ecl_core
ecl_devices github-stonier-ecl_core
ecl_filesystem github-stonier-ecl_core
ecl_geometry github-stonier-ecl_core
ecl_ipc github-stonier-ecl_core
ecl_linear_algebra github-stonier-ecl_core
ecl_manipulators github-stonier-ecl_core
ecl_math github-stonier-ecl_core
ecl_mobile_robot github-stonier-ecl_core
ecl_mpl github-stonier-ecl_core
ecl_sigslots github-stonier-ecl_core
ecl_statistics github-stonier-ecl_core
ecl_streams github-stonier-ecl_core
ecl_threads github-stonier-ecl_core
ecl_time github-stonier-ecl_core
ecl_type_traits github-stonier-ecl_core
ecl_utilities github-stonier-ecl_core
ecl_config github-stonier-ecl_lite
ecl_converters_lite github-stonier-ecl_lite
filters github-ros-filters
fmi_adapter github-boschresearch-fmi_adapter
foxglove_bridge github-foxglove-ros-foxglove-bridge
fuse_constraints github-locusrobotics-fuse
fuse_core github-locusrobotics-fuse
fuse_graphs github-locusrobotics-fuse
fuse_loss github-locusrobotics-fuse
fuse_models github-locusrobotics-fuse
fuse_optimizers github-locusrobotics-fuse
fuse_publishers github-locusrobotics-fuse
fuse_variables github-locusrobotics-fuse
gazebo_plugins github-ros-simulation-gazebo_ros_pkgs
gazebo_ros github-ros-simulation-gazebo_ros_pkgs
geographic_msgs github-ros-geographic-info-geographic_info
geometric_shapes github-ros-planning-geometric_shapes
test_tf2 github-ros2-geometry2
tf2 github-ros2-geometry2
tf2_bullet github-ros2-geometry2
tf2_eigen github-ros2-geometry2
tf2_eigen_kdl github-ros2-geometry2
tf2_geometry_msgs github-ros2-geometry2
tf2_kdl github-ros2-geometry2
tf2_ros github-ros2-geometry2
tf2_sensor_msgs github-ros2-geometry2
gscam github-ros-drivers-gscam
camera_calibration_parsers github-ros-perception-image_common
camera_info_manager github-ros-perception-image_common
image_transport github-ros-perception-image_common
compressed_depth_image_transport github-ros-perception-image_transport_plugins
imu_filter_madgwick github-CCNYRoboticsLab-imu_tools
interactive_markers github-ros-visualization-interactive_markers
wiimote github-ros-drivers-joystick_drivers
kdl_parser github-ros-kdl_parser
laser_filters github-ros-perception-laser_filters
laser_geometry github-ros-perception-laser_geometry
swri_geometry_util github-swri-robotics-marti_common
swri_image_util github-swri-robotics-marti_common
swri_math_util github-swri-robotics-marti_common
swri_roscpp github-swri-robotics-marti_common
swri_system_util github-swri-robotics-marti_common
swri_transform_util github-swri-robotics-marti_common
libmavconn github-mavlink-mavros
mavros github-mavlink-mavros
mavros_extras github-mavlink-mavros
microstrain_inertial_driver github-LORD-MicroStrain-microstrain_inertial
moveit_core github-ros-planning-moveit2
moveit_kinematics github-ros-planning-moveit2
moveit_planners_ompl github-ros-planning-moveit2
pilz_industrial_motion_planner github-ros-planning-moveit2
moveit_hybrid_planning github-ros-planning-moveit2
moveit_ros_move_group github-ros-planning-moveit2
moveit_servo github-ros-planning-moveit2
moveit_ros_planning github-ros-planning-moveit2
moveit_ros_planning_interface github-ros-planning-moveit2
moveit_ros_robot_interaction github-ros-planning-moveit2
moveit_ros_tests github-ros-planning-moveit2
moveit_setup_app_plugins github-ros-planning-moveit2
moveit_setup_assistant github-ros-planning-moveit2
moveit_setup_controllers github-ros-planning-moveit2
moveit_setup_srdf_plugins github-ros-planning-moveit2
mvsim github-MRPT-mvsim
novatel_gps_driver github-swri-robotics-novatel_gps_driver
octomap_ros github-OctoMap-octomap_ros
pal_statistics github-pal-robotics-pal_statistics
pcl_conversions github-ros-perception-perception_pcl
pcl_ros github-ros-perception-perception_pcl
plotjuggler_msgs github-facontidavide-plotjuggler_msgs
pluginlib github-ros-pluginlib
pose_cov_ops github-mrpt-ros-pkg-pose_cov_ops
quaternion_operation github-OUXT-Polaris-quaternion_operation
resource_retriever github-ros-resource_retriever
robot_calibration github-mikeferguson-robot_calibration
robot_localization github-cra-ros-pkg-robot_localization
robot_state_publisher github-ros-robot_state_publisher
rviz_common github-ros2-rviz
rviz_default_plugins github-ros2-rviz
rviz_rendering github-ros2-rviz
rviz_rendering_tests github-ros2-rviz
rviz_visual_testing_framework github-ros2-rviz
rviz_visual_tools github-PickNikRobotics-rviz_visual_tools
srdfdom github-ros-planning-srdfdom
tf2_2d github-locusrobotics-tf2_2d
tuw_geometry github-tuw-robotics-tuw_geometry
ur_calibration github-UniversalRobots-Universal_Robots_ROS2_Driver
usb_cam github-ros-drivers-usb_cam
velodyne_driver github-ros-drivers-velodyne
velodyne_pointcloud github-ros-drivers-velodyne
vision_msgs github-ros-perception-vision_msgs
cv_bridge github-ros-perception-vision_opencv
image_geometry github-ros-perception-vision_opencv
warehouse_ros_sqlite github-ros-planning-warehouse_ros_sqlite
ament_cmake_auto github-ament-ament_cmake
ament_cmake_gen_version_h github-ament-ament_cmake
ament_cmake_gmock github-ament-ament_cmake
ament_cmake_ros github-ros2-ament_cmake_ros
ament_index_cpp github-ament-ament_index
apex_test_tools gitlab-ApexAI-apex_test_tools
rclcpp_cascade_lifecycle github-fmrico-cascade_lifecycle
color_util github-MetroRobots-color_util
sensor_msgs github-ros2-common_interfaces
dummy_map_server github-ros2-demos
dummy_robot_bringup github-ros2-demos
dummy_sensors github-ros2-demos
dolly_tests github-chapulina-dolly
gazebo_ros2_control github-ros-simulation-gazebo_ros2_control
gazebo_ros2_control_demos github-ros-simulation-gazebo_ros2_control
test_launch_testing github-ros2-launch
libstatistics_collector github-ros-tooling-libstatistics_collector
libyaml_vendor github-ros2-libyaml_vendor
message_filters github-ros2-message_filters
micro_ros_diagnostic_bridge github-micro-ROS-micro_ros_diagnostics
micro_ros_diagnostic_updater github-micro-ROS-micro_ros_diagnostics
ouxt_lint_common github-OUXT-Polaris-ouxt_common
performance_test gitlab-ApexAI-performance_test
point_cloud_msg_wrapper gitlab-ApexAI-point_cloud_msg_wrapper
rcl github-ros2-rcl
rcl_action github-ros2-rcl
rcl_lifecycle github-ros2-rcl
rcl_yaml_param_parser github-ros2-rcl
test_msgs github-ros2-rcl_interfaces
rcl_logging_noop github-ros2-rcl_logging
rclc github-ros2-rclc
rclc_lifecycle github-ros2-rclc
rclc_parameter github-ros2-rclc
rclcpp github-ros2-rclcpp
rclcpp_action github-ros2-rclcpp
rclcpp_components github-ros2-rclcpp
rclcpp_lifecycle github-ros2-rclcpp
rclpy github-ros2-rclpy
rcpputils github-ros2-rcpputils
rcutils github-ros2-rcutils
rttest github-ros2-realtime_support
tlsf_cpp github-ros2-realtime_support
rmw_fastrtps_cpp github-ros2-rmw_fastrtps
rmw_fastrtps_dynamic_cpp github-ros2-rmw_fastrtps
rmw_implementation github-ros2-rmw_implementation
test_rmw_implementation github-ros2-rmw_implementation
ros1_bridge github-ros2-ros1_bridge
joint_limits github-ros-controls-ros2_control
ros2_socketcan github-autowarefoundation-ros2_socketcan
lttngpy github-ros2-ros2_tracing
test_tracetools github-ros2-ros2_tracing
tracetools github-ros2-ros2_tracing
rosbag2_performance_benchmarking_msgs github-ros2-rosbag2
rosbag2_storage github-ros2-rosbag2
rosidl_generator_tests github-ros2-rosidl
rosidl_runtime_cpp github-ros2-rosidl
rosidl_typesupport_interface github-ros2-rosidl
rosidl_typesupport_introspection_tests github-ros2-rosidl
rosidl_typesupport_tests github-ros2-rosidl_typesupport
rosidl_typesupport_fastrtps_c github-ros2-rosidl_typesupport_fastrtps
rosidl_typesupport_fastrtps_cpp github-ros2-rosidl_typesupport_fastrtps
system_modes github-micro-ROS-system_modes
system_modes_examples github-micro-ROS-system_modes
test_communication github-ros2-system_tests
test_quality_of_service github-ros2-system_tests
test_rclcpp github-ros2-system_tests
test_security github-ros2-system_tests
asio_cmake_module github-ros-drivers-transport_drivers
io_context github-ros-drivers-transport_drivers
serial_driver github-ros-drivers-transport_drivers
udp_driver github-ros-drivers-transport_drivers
ros_core github-ros2-variants
nao_lola github-ros-sports-nao_lola
nao_lola_client github-ros-sports-nao_lola
rcss3d_agent github-ros-sports-rcss3d_agent
ros_image_to_qimage github-ros-sports-ros_image_to_qimage
rqt_image_overlay github-ros-sports-rqt_image_overlay
sdformat_urdf github-ros-sdformat_urdf
soccer_marker_generation github-ijnek-soccer_visualization
topic_tools github-ros-tooling-topic_tools
tcb_span github-PickNikRobotics-cpp_polyfills
data_tamer_cpp github-PickNikRobotics-data_tamer
event_camera_codecs github-ros-event-camera-event_camera_codecs
parameter_traits github-PickNikRobotics-generate_parameter_library
gz_ros2_control_demos github-ros-controls-gz_ros2_control
gz_ros2_control_tests github-ros-controls-gz_ros2_control
mola_bridge_ros2 github-MOLAorg-mola
mola_demos github-MOLAorg-mola
mola_launcher github-MOLAorg-mola
mola_metric_maps github-MOLAorg-mola
mola_common github-MOLAorg-mola_common
mola_test_datasets github-MOLAorg-mola_test_datasets
open3d_conversions github-ros-perception-perception_open3d
rcl_logging_rcutils github-sloretz-rcl_logging_rcutils
rcss3d_nao github-ros-sports-rcss3d_nao
ros_gz_bridge github-gazebosim-ros_gz
test_ros_gz_bridge github-gazebosim-ros_gz

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged ament_cmake_gtest at Robotics Stack Exchange

No version for distro noetic. Known supported distros are highlighted in the buttons above.

Package Summary

Tags No category tags.
Version 0.4.0
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ament/ament_cmake.git
VCS Type git
VCS Version ardent
Last Updated 2017-12-09
Dev Status DEVELOPED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

The ability to add gtest-based tests in the ament buildsystem in CMake.

Additional Links

No additional links.

Maintainers

  • Dirk Thomas

Authors

No additional authors.
README
No README found. No README in repository either.
CHANGELOG
No CHANGELOG found.

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged ament_cmake_gtest at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 0.5.1
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ament/ament_cmake.git
VCS Type git
VCS Version bouncy
Last Updated 2018-07-17
Dev Status DEVELOPED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

The ability to add gtest-based tests in the ament buildsystem in CMake.

Additional Links

No additional links.

Maintainers

  • Dirk Thomas

Authors

No additional authors.
README
No README found. No README in repository either.
CHANGELOG
No CHANGELOG found.

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Package Dependencies

System Dependencies

Name
gtest

Dependant Packages

Name Repo Deps
angles github-ros-angles
class_loader github-ros-class_loader
depthimage_to_laserscan github-ros2-depthimage_to_laserscan
ecl_command_line github-stonier-ecl_core
ecl_concepts github-stonier-ecl_core
ecl_containers github-stonier-ecl_core
ecl_converters github-stonier-ecl_core
ecl_devices github-stonier-ecl_core
ecl_filesystem github-stonier-ecl_core
ecl_geometry github-stonier-ecl_core
ecl_ipc github-stonier-ecl_core
ecl_linear_algebra github-stonier-ecl_core
ecl_manipulators github-stonier-ecl_core
ecl_math github-stonier-ecl_core
ecl_mobile_robot github-stonier-ecl_core
ecl_mpl github-stonier-ecl_core
ecl_sigslots github-stonier-ecl_core
ecl_statistics github-stonier-ecl_core
ecl_streams github-stonier-ecl_core
ecl_threads github-stonier-ecl_core
ecl_time github-stonier-ecl_core
ecl_type_traits github-stonier-ecl_core
ecl_utilities github-stonier-ecl_core
ecl_config github-stonier-ecl_lite
ecl_converters_lite github-stonier-ecl_lite
tf2 github-ros2-geometry2
tf2_eigen github-ros2-geometry2
tf2_geometry_msgs github-ros2-geometry2
laser_geometry github-ros-perception-laser_geometry
map_server github-ros2-navigation
resource_retriever github-ros-resource_retriever
rviz_common github-ros2-rviz
rviz_default_plugins github-ros2-rviz
rviz_rendering github-ros2-rviz
rviz_rendering_tests github-ros2-rviz
rviz_visual_testing_framework github-ros2-rviz
pcl_conversions github-ros2-pcl_conversions
ament_cmake_gmock github-ament-ament_cmake
ament_index_cpp github-ament-ament_index
dummy_map_server github-ros2-demos
dummy_robot_bringup github-ros2-demos
dummy_sensors github-ros2-demos
fastcdr github-eProsima-Fast-CDR
rcl github-ros2-rcl
rcl_lifecycle github-ros2-rcl
rcl_yaml_param_parser github-ros2-rcl
rclcpp github-ros2-rclcpp
rclcpp_lifecycle github-ros2-rclcpp
rcutils github-ros2-rcutils
rttest github-ros2-realtime_support
tlsf_cpp github-ros2-realtime_support
rosidl_generator_c github-ros2-rosidl
rosidl_generator_cpp github-ros2-rosidl
ros_core github-ros2-variants

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged ament_cmake_gtest at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 0.6.1
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ament/ament_cmake.git
VCS Type git
VCS Version crystal
Last Updated 2019-03-10
Dev Status DEVELOPED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

The ability to add gtest-based tests in the ament buildsystem in CMake.

Additional Links

No additional links.

Maintainers

  • Dirk Thomas

Authors

No additional authors.
README
No README found. No README in repository either.
CHANGELOG
No CHANGELOG found.

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Package Dependencies

System Dependencies

Name
gtest

Dependant Packages

Name Repo Deps
angles github-ros-angles
behaviortree_cpp github-BehaviorTree-BehaviorTree-CPP
class_loader github-ros-class_loader
depthimage_to_laserscan github-ros-perception-depthimage_to_laserscan
ecl_command_line github-stonier-ecl_core
ecl_concepts github-stonier-ecl_core
ecl_containers github-stonier-ecl_core
ecl_converters github-stonier-ecl_core
ecl_devices github-stonier-ecl_core
ecl_filesystem github-stonier-ecl_core
ecl_geometry github-stonier-ecl_core
ecl_ipc github-stonier-ecl_core
ecl_linear_algebra github-stonier-ecl_core
ecl_manipulators github-stonier-ecl_core
ecl_math github-stonier-ecl_core
ecl_mobile_robot github-stonier-ecl_core
ecl_mpl github-stonier-ecl_core
ecl_sigslots github-stonier-ecl_core
ecl_statistics github-stonier-ecl_core
ecl_streams github-stonier-ecl_core
ecl_threads github-stonier-ecl_core
ecl_time github-stonier-ecl_core
ecl_type_traits github-stonier-ecl_core
ecl_utilities github-stonier-ecl_core
ecl_config github-stonier-ecl_lite
ecl_converters_lite github-stonier-ecl_lite
gazebo_plugins github-ros-simulation-gazebo_ros_pkgs
gazebo_ros github-ros-simulation-gazebo_ros_pkgs
tf2 github-ros2-geometry2
tf2_eigen github-ros2-geometry2
tf2_geometry_msgs github-ros2-geometry2
tf2_ros github-ros2-geometry2
tf2_sensor_msgs github-ros2-geometry2
camera_calibration_parsers github-ros-perception-image_common
camera_info_manager github-ros-perception-image_common
image_transport github-ros-perception-image_common
laser_geometry github-ros-perception-laser_geometry
pluginlib github-ros-pluginlib
rviz_common github-ros2-rviz
rviz_default_plugins github-ros2-rviz
rviz_rendering github-ros2-rviz
rviz_rendering_tests github-ros2-rviz
rviz_visual_testing_framework github-ros2-rviz
pcl_conversions github-ros2-pcl_conversions
ament_cmake_gmock github-ament-ament_cmake
ament_index_cpp github-ament-ament_index
dummy_map_server github-ros2-demos
dummy_robot_bringup github-ros2-demos
dummy_sensors github-ros2-demos
message_filters github-ros2-message_filters
nav2_amcl github-ros-planning-navigation2
nav2_bringup github-ros-planning-navigation2
nav2_bt_navigator github-ros-planning-navigation2
nav2_costmap_2d github-ros-planning-navigation2
costmap_queue github-ros-planning-navigation2
dwb_controller github-ros-planning-navigation2
dwb_core github-ros-planning-navigation2
dwb_critics github-ros-planning-navigation2
dwb_msgs github-ros-planning-navigation2
dwb_plugins github-ros-planning-navigation2
nav2_dwb_controller github-ros-planning-navigation2
nav_2d_msgs github-ros-planning-navigation2
nav_2d_utils github-ros-planning-navigation2
nav2_dynamic_params github-ros-planning-navigation2
nav2_map_server github-ros-planning-navigation2
nav2_mission_executor github-ros-planning-navigation2
nav2_motion_primitives github-ros-planning-navigation2
nav2_msgs github-ros-planning-navigation2
nav2_navfn_planner github-ros-planning-navigation2
nav2_robot github-ros-planning-navigation2
nav2_simple_navigator github-ros-planning-navigation2
nav2_system_tests github-ros-planning-navigation2
nav2_tasks github-ros-planning-navigation2
nav2_util github-ros-planning-navigation2
nav2_voxel_grid github-ros-planning-navigation2
nav2_world_model github-ros-planning-navigation2
navigation2 github-ros-planning-navigation2
rcl github-ros2-rcl
rcl_action github-ros2-rcl
rcl_lifecycle github-ros2-rcl
rcl_yaml_param_parser github-ros2-rcl
test_msgs github-ros2-rcl_interfaces
rcl_logging_log4cxx github-ros2-rcl_logging
rcl_logging_noop github-ros2-rcl_logging
rclcpp github-ros2-rclcpp
rclcpp_action github-ros2-rclcpp
rclcpp_lifecycle github-ros2-rclcpp
rcutils github-ros2-rcutils
rttest github-ros2-realtime_support
tlsf_cpp github-ros2-realtime_support
realsense_ros2_camera github-intel-ros2_intel_realsense
rosbag2_storage github-ros2-rosbag2
rosidl_generator_c github-ros2-rosidl
rosidl_generator_cpp github-ros2-rosidl
system_modes github-microROS-system_modes
ros_core github-ros2-variants
object_analytics_node github-intel-ros2_object_analytics

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged ament_cmake_gtest at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 0.8.3
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ament/ament_cmake.git
VCS Type git
VCS Version eloquent
Last Updated 2020-11-30
Dev Status DEVELOPED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

The ability to add gtest-based tests in the ament buildsystem in CMake.

Additional Links

No additional links.

Maintainers

  • Dirk Thomas

Authors

No additional authors.
README
No README found. No README in repository either.
CHANGELOG
No CHANGELOG found.

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Package Dependencies

System Dependencies

Name
gtest

Dependant Packages

Name Repo Deps
angles github-ros-angles
class_loader github-ros-class_loader
costmap_converter github-rst-tu-dortmund-costmap_converter
depthimage_to_laserscan github-ros-perception-depthimage_to_laserscan
diagnostic_updater github-ros-diagnostics
self_test github-ros-diagnostics
ecl_command_line github-stonier-ecl_core
ecl_concepts github-stonier-ecl_core
ecl_containers github-stonier-ecl_core
ecl_converters github-stonier-ecl_core
ecl_devices github-stonier-ecl_core
ecl_filesystem github-stonier-ecl_core
ecl_geometry github-stonier-ecl_core
ecl_ipc github-stonier-ecl_core
ecl_linear_algebra github-stonier-ecl_core
ecl_manipulators github-stonier-ecl_core
ecl_math github-stonier-ecl_core
ecl_mobile_robot github-stonier-ecl_core
ecl_mpl github-stonier-ecl_core
ecl_sigslots github-stonier-ecl_core
ecl_statistics github-stonier-ecl_core
ecl_streams github-stonier-ecl_core
ecl_threads github-stonier-ecl_core
ecl_time github-stonier-ecl_core
ecl_type_traits github-stonier-ecl_core
ecl_utilities github-stonier-ecl_core
ecl_config github-stonier-ecl_lite
ecl_converters_lite github-stonier-ecl_lite
filters github-ros-filters
gazebo_plugins github-ros-simulation-gazebo_ros_pkgs
gazebo_ros github-ros-simulation-gazebo_ros_pkgs
geographic_msgs github-ros-geographic-info-geographic_info
tf2 github-ros2-geometry2
tf2_eigen github-ros2-geometry2
tf2_geometry_msgs github-ros2-geometry2
tf2_kdl github-ros2-geometry2
tf2_ros github-ros2-geometry2
tf2_sensor_msgs github-ros2-geometry2
camera_calibration_parsers github-ros-perception-image_common
camera_info_manager github-ros-perception-image_common
image_transport github-ros-perception-image_common
interactive_markers github-ros-visualization-interactive_markers
laser_geometry github-ros-perception-laser_geometry
pcl_conversions github-ros-perception-perception_pcl
plotjuggler_msgs github-facontidavide-plotjuggler_msgs
pluginlib github-ros-pluginlib
rviz_common github-ros2-rviz
rviz_default_plugins github-ros2-rviz
rviz_rendering github-ros2-rviz
rviz_rendering_tests github-ros2-rviz
rviz_visual_testing_framework github-ros2-rviz
slam_toolbox github-SteveMacenski-slam_toolbox
velodyne_driver github-ros-drivers-velodyne
velodyne_pointcloud github-ros-drivers-velodyne
vision_msgs github-Kukanani-vision_msgs
cv_bridge github-ros-perception-vision_opencv
image_geometry github-ros-perception-vision_opencv
ament_cmake_gmock github-ament-ament_cmake
ament_cmake_ros github-ros2-ament_cmake_ros
ament_index_cpp github-ament-ament_index
apex_test_tools gitlab-ApexAI-apex_test_tools
sensor_msgs github-ros2-common_interfaces
dummy_map_server github-ros2-demos
dummy_robot_bringup github-ros2-demos
dummy_sensors github-ros2-demos
test_launch_testing github-ros2-launch
message_filters github-ros2-message_filters
nav2_bringup github-ros-planning-navigation2
nav2_core github-ros-planning-navigation2
nav2_costmap_2d github-ros-planning-navigation2
costmap_queue github-ros-planning-navigation2
dwb_plugins github-ros-planning-navigation2
nav2_map_server github-ros-planning-navigation2
nav2_recoveries github-ros-planning-navigation2
nav2_system_tests github-ros-planning-navigation2
nav2_util github-ros-planning-navigation2
nav2_voxel_grid github-ros-planning-navigation2
rcl github-ros2-rcl
rcl_action github-ros2-rcl
rcl_lifecycle github-ros2-rcl
rcl_yaml_param_parser github-ros2-rcl
test_msgs github-ros2-rcl_interfaces
rcl_logging_log4cxx github-ros2-rcl_logging
rcl_logging_noop github-ros2-rcl_logging
rclc github-ros2-rclc
rclc_lifecycle github-ros2-rclc
rclc_parameter github-ros2-rclc
rclcpp github-ros2-rclcpp
rclcpp_action github-ros2-rclcpp
rclcpp_components github-ros2-rclcpp
rclcpp_lifecycle github-ros2-rclcpp
rcpputils github-ros2-rcpputils
rcutils github-ros2-rcutils
rttest github-ros2-realtime_support
tlsf_cpp github-ros2-realtime_support
plansys2_domain_expert github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_executor github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_lifecycle_manager github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_planner github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_problem_expert github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_terminal github-IntelligentRoboticsLabs-ros2_planning_system
tracetools gitlab-ros-tracing-ros2_tracing
rosbag2_storage github-ros2-rosbag2
rosidl_generator_c github-ros2-rosidl
rosidl_generator_cpp github-ros2-rosidl
sick_scan2 github-SICKAG-sick_scan2
system_modes github-micro-ROS-system_modes
system_modes_examples github-micro-ROS-system_modes
ros_core github-ros2-variants

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged ament_cmake_gtest at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 0.7.6
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ament/ament_cmake.git
VCS Type git
VCS Version dashing
Last Updated 2020-11-24
Dev Status DEVELOPED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

The ability to add gtest-based tests in the ament buildsystem in CMake.

Additional Links

No additional links.

Maintainers

  • Dirk Thomas

Authors

No additional authors.
README
No README found. No README in repository either.
CHANGELOG
No CHANGELOG found.

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Package Dependencies

System Dependencies

Name
gtest

Dependant Packages

Name Repo Deps
angles github-ros-angles
aws_common github-aws-robotics-utils-common
test_bond github-ros-bond_core
class_loader github-ros-class_loader
cloudwatch_logs_common github-aws-robotics-cloudwatch-common
cloudwatch_metrics_common github-aws-robotics-cloudwatch-common
dataflow_lite github-aws-robotics-cloudwatch-common
file_management github-aws-robotics-cloudwatch-common
costmap_converter github-rst-tu-dortmund-costmap_converter
depthimage_to_laserscan github-ros-perception-depthimage_to_laserscan
diagnostic_updater github-ros-diagnostics
self_test github-ros-diagnostics
ecl_command_line github-stonier-ecl_core
ecl_concepts github-stonier-ecl_core
ecl_containers github-stonier-ecl_core
ecl_converters github-stonier-ecl_core
ecl_devices github-stonier-ecl_core
ecl_filesystem github-stonier-ecl_core
ecl_geometry github-stonier-ecl_core
ecl_ipc github-stonier-ecl_core
ecl_linear_algebra github-stonier-ecl_core
ecl_manipulators github-stonier-ecl_core
ecl_math github-stonier-ecl_core
ecl_mobile_robot github-stonier-ecl_core
ecl_mpl github-stonier-ecl_core
ecl_sigslots github-stonier-ecl_core
ecl_statistics github-stonier-ecl_core
ecl_streams github-stonier-ecl_core
ecl_threads github-stonier-ecl_core
ecl_time github-stonier-ecl_core
ecl_type_traits github-stonier-ecl_core
ecl_utilities github-stonier-ecl_core
ecl_config github-stonier-ecl_lite
ecl_converters_lite github-stonier-ecl_lite
fmi_adapter github-boschresearch-fmi_adapter
gazebo_plugins github-ros-simulation-gazebo_ros_pkgs
gazebo_ros github-ros-simulation-gazebo_ros_pkgs
geographic_msgs github-ros-geographic-info-geographic_info
tf2 github-ros2-geometry2
tf2_eigen github-ros2-geometry2
tf2_geometry_msgs github-ros2-geometry2
tf2_kdl github-ros2-geometry2
tf2_ros github-ros2-geometry2
tf2_sensor_msgs github-ros2-geometry2
h264_encoder_core github-aws-robotics-kinesisvideo-encoder-common
h264_video_encoder github-aws-robotics-kinesisvideo-encoder-ros2
camera_calibration_parsers github-ros-perception-image_common
camera_info_manager github-ros-perception-image_common
image_transport github-ros-perception-image_common
kinesis_manager github-aws-robotics-kinesisvideo-common
kinesis_video_streamer github-aws-robotics-kinesisvideo-ros2
laser_geometry github-ros-perception-laser_geometry
lex_common github-aws-robotics-lex-common
pcl_conversions github-ros-perception-perception_pcl
pluginlib github-ros-pluginlib
robot_localization github-cra-ros-pkg-robot_localization
rosauth github-GT-RAIL-rosauth
rviz_common github-ros2-rviz
rviz_default_plugins github-ros2-rviz
rviz_rendering github-ros2-rviz
rviz_rendering_tests github-ros2-rviz
rviz_visual_testing_framework github-ros2-rviz
slam_toolbox github-SteveMacenski-slam_toolbox
velodyne_driver github-ros-drivers-velodyne
velodyne_pointcloud github-ros-drivers-velodyne
vision_msgs github-Kukanani-vision_msgs
ament_cmake_gmock github-ament-ament_cmake
ament_index_cpp github-ament-ament_index
apex_test_tools gitlab-ApexAI-apex_test_tools
sensor_msgs github-ros2-common_interfaces
dummy_map_server github-ros2-demos
dummy_robot_bringup github-ros2-demos
dummy_sensors github-ros2-demos
test_launch_testing github-ros2-launch
message_filters github-ros2-message_filters
nav2_amcl github-ros-planning-navigation2
nav2_behavior_tree github-ros-planning-navigation2
nav2_bringup github-ros-planning-navigation2
nav2_bt_navigator github-ros-planning-navigation2
nav2_costmap_2d github-ros-planning-navigation2
costmap_queue github-ros-planning-navigation2
dwb_controller github-ros-planning-navigation2
dwb_core github-ros-planning-navigation2
dwb_critics github-ros-planning-navigation2
dwb_msgs github-ros-planning-navigation2
dwb_plugins github-ros-planning-navigation2
nav2_dwb_controller github-ros-planning-navigation2
nav_2d_msgs github-ros-planning-navigation2
nav_2d_utils github-ros-planning-navigation2
nav2_dynamic_params github-ros-planning-navigation2
nav2_map_server github-ros-planning-navigation2
nav2_msgs github-ros-planning-navigation2
nav2_navfn_planner github-ros-planning-navigation2
nav2_recoveries github-ros-planning-navigation2
nav2_system_tests github-ros-planning-navigation2
nav2_util github-ros-planning-navigation2
nav2_voxel_grid github-ros-planning-navigation2
nav2_world_model github-ros-planning-navigation2
navigation2 github-ros-planning-navigation2
rcl github-ros2-rcl
rcl_action github-ros2-rcl
rcl_lifecycle github-ros2-rcl
rcl_yaml_param_parser github-ros2-rcl
test_msgs github-ros2-rcl_interfaces
rcl_logging_log4cxx github-ros2-rcl_logging
rcl_logging_noop github-ros2-rcl_logging
rclc github-ros2-rclc
rclc_lifecycle github-ros2-rclc
rclcpp github-ros2-rclcpp
rclcpp_action github-ros2-rclcpp
rclcpp_components github-ros2-rclcpp
rclcpp_lifecycle github-ros2-rclcpp
rcpputils github-ros2-rcpputils
rcutils github-ros2-rcutils
rttest github-ros2-realtime_support
tlsf_cpp github-ros2-realtime_support
controller_interface github-ros-controls-ros2_control
controller_manager github-ros-controls-ros2_control
controller_parameter_server github-ros-controls-ros2_control
hardware_interface github-ros-controls-ros2_control
test_robot_hardware github-ros-controls-ros2_control
ros_controllers github-ros-controls-ros2_controllers
realsense_ros2_camera github-intel-ros2_intel_realsense
tracetools gitlab-ros-tracing-ros2_tracing
rosbag2_storage github-ros2-rosbag2
rosidl_generator_c github-ros2-rosidl
rosidl_generator_cpp github-ros2-rosidl
sick_scan2 github-SICKAG-sick_scan2
system_modes github-micro-ROS-system_modes
system_modes_examples github-micro-ROS-system_modes
serial_driver github-ros-drivers-transport_drivers
udp_driver github-ros-drivers-transport_drivers
ros_core github-ros2-variants
aws_ros2_common github-aws-robotics-utils-ros2
object_analytics_node github-intel-ros2_object_analytics

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged ament_cmake_gtest at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 1.1.6
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ament/ament_cmake.git
VCS Type git
VCS Version galactic
Last Updated 2022-12-02
Dev Status DEVELOPED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

The ability to add gtest-based tests in the ament buildsystem in CMake.

Additional Links

No additional links.

Maintainers

  • Michael Jeronimo
  • Michel Hidalgo

Authors

  • Dirk Thomas
README
No README found. No README in repository either.
CHANGELOG

Changelog for package ament_cmake_gtest

1.1.6 (2022-12-02)

1.1.5 (2022-01-14)

  • Update maintainers (backport #362) (#370).
  • Contributors: Audrow Nash

1.1.4 (2021-05-06)

1.1.3 (2021-03-09)

1.1.2 (2021-02-26 22:59)

1.1.1 (2021-02-26 19:12)

1.1.0 (2021-02-24)

1.0.4 (2021-01-25)

1.0.3 (2020-12-10)

1.0.2 (2020-12-07)

  • Update package maintainers. (#286)
  • Contributors: Michel Hidalgo

1.0.1 (2020-09-10)

  • [ament_cmake_gtest] ensure gtest to consume the correct headers. (#267)
    • ensure gtest to consume the correct headers.
    • add another patch.
  • Contributors: Sean Yen

1.0.0 (2020-07-22)

0.9.6 (2020-06-23)

0.9.5 (2020-06-02)

0.9.4 (2020-05-26)

0.9.3 (2020-05-19)

0.9.2 (2020-05-07)

0.9.1 (2020-04-24 15:45)

0.9.0 (2020-04-24 12:25)

0.8.1 (2019-10-23)

0.8.0 (2019-10-04)

  • Revert \"Add gtest and gmock headers as system headers: (#175)\" (#184) This reverts commit e1ff1c1a0a1e08d43e939cdb943a88be601808bd.
  • Add gtest and gmock headers as system headers: (#175) Certain gtest and gmock header files contain constructs which generate warnings when certain compile flags are enabled. By including the header files as system headers, the compiler knows that it doesn\'t need to generate these warnings since they are coming from (third-party) system headers
  • Add runner option to ament_add_test (#174)
    • ament_cmake allow speficiation of a different test runner
    • By default, still uses run_test.py
    • Example use case: ament_cmake_ros can use a test runner that sets a ROS_DOMAIN_ID
    • ament_cmake move run_test.py to a python module
    • This should let us see the history
    • ament_cmake refactor run_test.py into an importable python module
    • Adds an ament_cmake_test python package
  • Contributors: Peter Baughman, Shane Loretz, jpsamper2009

0.7.3 (2019-05-29)

0.7.2 (2019-05-20)

0.7.1 (2019-05-07)

  • Fix unused-arg check in ament_cmake packages: (#167) Arguments to a macro are not variables, so it\'s not possible to do \'if(ARGN)\' to check for arguments; however, copying ARGN to a variable works.
  • Contributors: jpsamper2009

0.7.0 (2019-04-08)

0.6.0 (2018-11-13)

0.5.1 (2018-07-17)

0.5.0 (2018-06-13)

0.4.0 (2017-12-08)

  • 0.0.3
  • Merge pull request #104 from ament/googletest update to googletest 1.8
  • update to googletest 1.8
  • 0.0.2
  • Merge pull request #86 from ament/remove_include remove unnecessary include
  • remove unnecessary include
  • Merge pull request #85 from ament/split_gtest_function Split ament_add_gtest function
  • refactor ament_add_gtest to be composed out of two separate functions to create the executable and register it as a test
  • duplicate ament_add_gtest.cmake before refactoring it
  • add missing doc for SKIP_TEST
  • Merge pull request #82 from firesurfer/master Fixed rebasing error, fixed indentation, looking for pthread on non w...
  • removed GTEST argument form target_link_libraries
  • Fixed rebasing error, fixed indentation, looking for pthread on non windows systems
  • Skipped tests (#80)
    • support skipping tests
    • add SKIP_TEST to ament_add_nose_test
    • use keyword args not positional
    • discard positional args after first
  • update schema url
  • add schema to manifest files
  • Merge pull request #72 from ament/cmake35 require CMake 3.5
  • remove trailing spaces from comparisons, obsolete quotes and explicit variable expansion
  • remove obsolete policies
  • require CMake 3.5
  • Merge pull request #54 from ament/test_working_dir support WORKING_DIRECTORY in ament_add_nose_test
  • fix WORKING_DIRECTORY for ament_add_gtest/gmock
  • follow fixes from #52
  • Merge pull request #52 from ament/add_test_append_env_option add APPEND_ENV and APPEND_LIBRARY_DIRS options to ament_add_*test macros
  • add APPEND_ENV and APPEND_LIBRARY_DIRS options to ament_add_*test macros
  • Merge pull request #50 from ament/pass_extra_env_to_tests add option to pass extra env to ament_add_*test
  • addressing comments
  • add option to pass extra env to ament_add_*test
  • Merge pull request #37 from ament/test_labels add labels to tests
  • add labels to tests
  • Merge pull request #34 from ament/prevent_gtest_in_cache refactor finding GTest / GMock
  • refactor finding GTest / GMock
  • Merge pull request #29 from ament/suppress_cmp0026 set cmp0026 to OLD until we can migrate to use \$<TARGET_FILE:...>
  • update comment and set the policy in two other places
  • Merge pull request #28 from ament/gtest_location fix location of gtest / gmock executables on Windows
  • add type as extension to test result files
  • fix location of gtest executable on Windows
  • Merge pull request #25 from ament/use_gmock_vendor optionally use gmock_vendor
  • optionally use gtest/gmock_vendor
  • Merge pull request #18 from ament/gtest_docs adding basic usage to description
  • adding basic usage documentation
  • Merge pull request #19 from ament/improve_test_runner improve test runner
  • improve test runner
  • add note that gtest target might not be created
  • fix linking of gtest libraries (regression of #16)
  • Merge pull request #16 from ament/gtest_main_libraries automatically link gtest main libraries and add an option to skip it
  • automatically link gtest main libraries and add an option to skip it
  • add explicit build type
  • disable debug output
  • add missing copyright / license information, update format of existing license information
  • update quoting of additional ament_add_test() arguments
  • use project(.. NONE)
  • refactor several low-level packages into ament_cmake_core (environment, environment_hooks, index, package_templates, symlink_install)
  • invert dependency between ament_cmake_environment and ament_cmake_environment_hooks, add dependency on ament_cmake_environment
  • deal with CMake double expansion
  • update cmake code style
  • add ament_cmake_gmock
  • add ament_cmake_environment_hooks
  • tests are always built when being enabled
  • add ament_cmake_test, ament_cmake_gtest, ament_cmake_nose
  • Contributors: Dirk Thomas, Lennart Nachtigall, Mikael Arguedas, Tully Foote, William Woodall

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Package Dependencies

System Dependencies

Name
gtest

Dependant Packages

Name Repo Deps
behaviortree_cpp github-BehaviorTree-BehaviorTree-CPP
test_bond github-ros-bond_core
class_loader github-ros-class_loader
control_toolbox github-ros-controls-control_toolbox
depthimage_to_laserscan github-ros-perception-depthimage_to_laserscan
diagnostic_aggregator github-ros-diagnostics
diagnostic_updater github-ros-diagnostics
self_test github-ros-diagnostics
ecl_command_line github-stonier-ecl_core
ecl_concepts github-stonier-ecl_core
ecl_containers github-stonier-ecl_core
ecl_converters github-stonier-ecl_core
ecl_devices github-stonier-ecl_core
ecl_filesystem github-stonier-ecl_core
ecl_geometry github-stonier-ecl_core
ecl_ipc github-stonier-ecl_core
ecl_linear_algebra github-stonier-ecl_core
ecl_manipulators github-stonier-ecl_core
ecl_math github-stonier-ecl_core
ecl_mobile_robot github-stonier-ecl_core
ecl_mpl github-stonier-ecl_core
ecl_sigslots github-stonier-ecl_core
ecl_statistics github-stonier-ecl_core
ecl_streams github-stonier-ecl_core
ecl_threads github-stonier-ecl_core
ecl_time github-stonier-ecl_core
ecl_type_traits github-stonier-ecl_core
ecl_utilities github-stonier-ecl_core
ecl_config github-stonier-ecl_lite
ecl_converters_lite github-stonier-ecl_lite
filters github-ros-filters
foxglove_bridge github-foxglove-ros-foxglove-bridge
gazebo_plugins github-ros-simulation-gazebo_ros_pkgs
gazebo_ros github-ros-simulation-gazebo_ros_pkgs
geographic_msgs github-ros-geographic-info-geographic_info
geometric_shapes github-ros-planning-geometric_shapes
test_tf2 github-ros2-geometry2
tf2 github-ros2-geometry2
tf2_bullet github-ros2-geometry2
tf2_eigen github-ros2-geometry2
tf2_eigen_kdl github-ros2-geometry2
tf2_geometry_msgs github-ros2-geometry2
tf2_kdl github-ros2-geometry2
tf2_ros github-ros2-geometry2
tf2_sensor_msgs github-ros2-geometry2
gscam github-ros-drivers-gscam
camera_calibration_parsers github-ros-perception-image_common
camera_info_manager github-ros-perception-image_common
image_transport github-ros-perception-image_common
imu_filter_madgwick github-CCNYRoboticsLab-imu_tools
interactive_markers github-ros-visualization-interactive_markers
wiimote github-ros-drivers-joystick_drivers
laser_filters github-ros-perception-laser_filters
laser_geometry github-ros-perception-laser_geometry
libmavconn github-mavlink-mavros
mavros github-mavlink-mavros
mavros_extras github-mavlink-mavros
microstrain_inertial_driver github-LORD-MicroStrain-microstrain_inertial
moveit_core github-ros-planning-moveit2
moveit_kinematics github-ros-planning-moveit2
moveit_planners_ompl github-ros-planning-moveit2
pilz_industrial_motion_planner github-ros-planning-moveit2
moveit_hybrid_planning github-ros-planning-moveit2
moveit_ros_move_group github-ros-planning-moveit2
moveit_servo github-ros-planning-moveit2
moveit_ros_planning github-ros-planning-moveit2
moveit_ros_planning_interface github-ros-planning-moveit2
moveit_ros_robot_interaction github-ros-planning-moveit2
moveit_ros_tests github-ros-planning-moveit2
moveit_setup_app_plugins github-ros-planning-moveit2
moveit_setup_assistant github-ros-planning-moveit2
moveit_setup_controllers github-ros-planning-moveit2
moveit_setup_srdf_plugins github-ros-planning-moveit2
naoqi_libqi github-ros-naoqi-libqi
octomap_ros github-OctoMap-octomap_ros
pal_statistics github-pal-robotics-pal_statistics
pcl_conversions github-ros-perception-perception_pcl
pcl_ros github-ros-perception-perception_pcl
plotjuggler_msgs github-facontidavide-plotjuggler_msgs
pluginlib github-ros-pluginlib
pose_cov_ops github-mrpt-ros-pkg-pose_cov_ops
quaternion_operation github-OUXT-Polaris-quaternion_operation
resource_retriever github-ros-resource_retriever
robot_localization github-cra-ros-pkg-robot_localization
robot_state_publisher github-ros-robot_state_publisher
rviz_common github-ros2-rviz
rviz_default_plugins github-ros2-rviz
rviz_rendering github-ros2-rviz
rviz_rendering_tests github-ros2-rviz
rviz_visual_testing_framework github-ros2-rviz
rviz_visual_tools github-PickNikRobotics-rviz_visual_tools
slam_toolbox github-SteveMacenski-slam_toolbox
srdfdom github-ros-planning-srdfdom
ur_calibration github-UniversalRobots-Universal_Robots_ROS2_Driver
usb_cam github-ros-drivers-usb_cam
velodyne_driver github-ros-drivers-velodyne
velodyne_pointcloud github-ros-drivers-velodyne
vision_msgs github-ros-perception-vision_msgs
cv_bridge github-ros-perception-vision_opencv
image_geometry github-ros-perception-vision_opencv
warehouse_ros_mongo github-ros-planning-warehouse_ros_mongo
warehouse_ros_sqlite github-ros-planning-warehouse_ros_sqlite
ament_cmake_gmock github-ament-ament_cmake
ament_cmake_ros github-ros2-ament_cmake_ros
ament_index_cpp github-ament-ament_index
apex_test_tools gitlab-ApexAI-apex_test_tools
rclcpp_cascade_lifecycle github-fmrico-cascade_lifecycle
sensor_msgs github-ros2-common_interfaces
dummy_map_server github-ros2-demos
dummy_robot_bringup github-ros2-demos
dummy_sensors github-ros2-demos
dolly_tests github-chapulina-dolly
gazebo_ros2_control github-ros-simulation-gazebo_ros2_control
gazebo_ros2_control_demos github-ros-simulation-gazebo_ros2_control
ign_ros2_control_demos github-ignitionrobotics-ign_ros2_control
test_launch_testing github-ros2-launch
libstatistics_collector github-ros-tooling-libstatistics_collector
libyaml_vendor github-ros2-libyaml_vendor
message_filters github-ros2-message_filters
micro_ros_diagnostic_bridge github-micro-ROS-micro_ros_diagnostics
micro_ros_diagnostic_updater github-micro-ROS-micro_ros_diagnostics
nav2_behavior_tree github-ros-planning-navigation2
nav2_bringup github-ros-planning-navigation2
nav2_controller github-ros-planning-navigation2
nav2_core github-ros-planning-navigation2
nav2_costmap_2d github-ros-planning-navigation2
costmap_queue github-ros-planning-navigation2
dwb_core github-ros-planning-navigation2
dwb_critics github-ros-planning-navigation2
dwb_plugins github-ros-planning-navigation2
nav_2d_utils github-ros-planning-navigation2
nav2_lifecycle_manager github-ros-planning-navigation2
nav2_map_server github-ros-planning-navigation2
nav2_recoveries github-ros-planning-navigation2
nav2_regulated_pure_pursuit_controller github-ros-planning-navigation2
nav2_rotation_shim_controller github-ros-planning-navigation2
nav2_smac_planner github-ros-planning-navigation2
nav2_system_tests github-ros-planning-navigation2
nav2_theta_star_planner github-ros-planning-navigation2
nav2_util github-ros-planning-navigation2
nav2_voxel_grid github-ros-planning-navigation2
nav2_waypoint_follower github-ros-planning-navigation2
ouxt_lint_common github-OUXT-Polaris-ouxt_common
performance_test gitlab-ApexAI-performance_test
point_cloud_msg_wrapper gitlab-ApexAI-point_cloud_msg_wrapper
rcl github-ros2-rcl
rcl_action github-ros2-rcl
rcl_lifecycle github-ros2-rcl
rcl_yaml_param_parser github-ros2-rcl
test_msgs github-ros2-rcl_interfaces
rcl_logging_log4cxx github-ros2-rcl_logging
rcl_logging_noop github-ros2-rcl_logging
rclc github-ros2-rclc
rclc_lifecycle github-ros2-rclc
rclc_parameter github-ros2-rclc
rclcpp github-ros2-rclcpp
rclcpp_action github-ros2-rclcpp
rclcpp_components github-ros2-rclcpp
rclcpp_lifecycle github-ros2-rclcpp
rclpy github-ros2-rclpy
rcpputils github-ros2-rcpputils
rcutils github-ros2-rcutils
rttest github-ros2-realtime_support
tlsf_cpp github-ros2-realtime_support
rmw_fastrtps_cpp github-ros2-rmw_fastrtps
rmw_fastrtps_dynamic_cpp github-ros2-rmw_fastrtps
rmw_implementation github-ros2-rmw_implementation
test_rmw_implementation github-ros2-rmw_implementation
controller_manager github-ros-controls-ros2_control
joint_limits_interface github-ros-controls-ros2_control
joint_trajectory_controller github-ros-controls-ros2_controllers
plansys2_bt_actions github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_core github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_domain_expert github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_executor github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_lifecycle_manager github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_pddl_parser github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_planner github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_popf_plan_solver github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_problem_expert github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_terminal github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_tests github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_tools github-IntelligentRoboticsLabs-ros2_planning_system
ros2_socketcan github-autowarefoundation-ros2_socketcan
tracetools github-ros2-ros2_tracing
tracetools_test github-ros2-ros2_tracing
vda5050_connector github-inorbit-ai-ros_amr_interop
ros_ign_bridge github-ignitionrobotics-ros_ign
rosbag2_storage github-ros2-rosbag2
rosidl_generator_c github-ros2-rosidl
rosidl_generator_cpp github-ros2-rosidl
rosidl_runtime_cpp github-ros2-rosidl
rosidl_typesupport_interface github-ros2-rosidl
rosidl_typesupport_fastrtps_c github-ros2-rosidl_typesupport_fastrtps
rosidl_typesupport_fastrtps_cpp github-ros2-rosidl_typesupport_fastrtps
system_modes github-micro-ROS-system_modes
system_modes_examples github-micro-ROS-system_modes
test_communication github-ros2-system_tests
test_quality_of_service github-ros2-system_tests
test_rclcpp github-ros2-system_tests
test_security github-ros2-system_tests
asio_cmake_module github-ros-drivers-transport_drivers
io_context github-ros-drivers-transport_drivers
serial_driver github-ros-drivers-transport_drivers
udp_driver github-ros-drivers-transport_drivers
ros_core github-ros2-variants
foros github-42dot-foros
nao_lola github-ros-sports-nao_lola
rcss3d_agent github-ros-sports-rcss3d_agent
rqt_image_overlay github-ros-sports-rqt_image_overlay
sdformat_urdf github-ros-sdformat_urdf
soccer_marker_generation github-ijnek-soccer_visualization
topic_tools github-ros-tooling-topic_tools

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged ament_cmake_gtest at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 0.9.12
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ament/ament_cmake.git
VCS Type git
VCS Version foxy
Last Updated 2023-05-27
Dev Status DEVELOPED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

The ability to add gtest-based tests in the ament buildsystem in CMake.

Additional Links

No additional links.

Maintainers

  • Dirk Thomas

Authors

No additional authors.
README
No README found. No README in repository either.
CHANGELOG
No CHANGELOG found.

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Package Dependencies

System Dependencies

Name
gtest

Dependant Packages

Name Repo Deps
behaviortree_cpp_v3 github-BehaviorTree-BehaviorTree-CPP
test_bond github-ros-bond_core
class_loader github-ros-class_loader
control_toolbox github-ros-controls-control_toolbox
dataspeed_can_msg_filters bitbucket-dataspeedinc-dataspeed_can
dataspeed_can_tools bitbucket-dataspeedinc-dataspeed_can
dataspeed_can_usb bitbucket-dataspeedinc-dataspeed_can
depthimage_to_laserscan github-ros-perception-depthimage_to_laserscan
diagnostic_aggregator github-ros-diagnostics
diagnostic_updater github-ros-diagnostics
self_test github-ros-diagnostics
ecl_command_line github-stonier-ecl_core
ecl_concepts github-stonier-ecl_core
ecl_containers github-stonier-ecl_core
ecl_converters github-stonier-ecl_core
ecl_devices github-stonier-ecl_core
ecl_filesystem github-stonier-ecl_core
ecl_geometry github-stonier-ecl_core
ecl_ipc github-stonier-ecl_core
ecl_linear_algebra github-stonier-ecl_core
ecl_manipulators github-stonier-ecl_core
ecl_math github-stonier-ecl_core
ecl_mobile_robot github-stonier-ecl_core
ecl_mpl github-stonier-ecl_core
ecl_sigslots github-stonier-ecl_core
ecl_statistics github-stonier-ecl_core
ecl_streams github-stonier-ecl_core
ecl_threads github-stonier-ecl_core
ecl_time github-stonier-ecl_core
ecl_type_traits github-stonier-ecl_core
ecl_utilities github-stonier-ecl_core
ecl_config github-stonier-ecl_lite
ecl_converters_lite github-stonier-ecl_lite
filters github-ros-filters
fmi_adapter github-boschresearch-fmi_adapter
gazebo_plugins github-ros-simulation-gazebo_ros_pkgs
gazebo_ros github-ros-simulation-gazebo_ros_pkgs
geographic_msgs github-ros-geographic-info-geographic_info
geometric_shapes github-ros-planning-geometric_shapes
test_tf2 github-ros2-geometry2
tf2 github-ros2-geometry2
tf2_bullet github-ros2-geometry2
tf2_eigen github-ros2-geometry2
tf2_eigen_kdl github-ros2-geometry2
tf2_geometry_msgs github-ros2-geometry2
tf2_kdl github-ros2-geometry2
tf2_ros github-ros2-geometry2
tf2_sensor_msgs github-ros2-geometry2
gscam github-ros-drivers-gscam
camera_calibration_parsers github-ros-perception-image_common
camera_info_manager github-ros-perception-image_common
image_transport github-ros-perception-image_common
imu_filter_madgwick github-CCNYRoboticsLab-imu_tools
interactive_markers github-ros-visualization-interactive_markers
wiimote github-ros-drivers-joystick_drivers
laser_filters github-ros-perception-laser_filters
laser_geometry github-ros-perception-laser_geometry
swri_geometry_util github-swri-robotics-marti_common
swri_image_util github-swri-robotics-marti_common
swri_math_util github-swri-robotics-marti_common
swri_roscpp github-swri-robotics-marti_common
swri_system_util github-swri-robotics-marti_common
swri_transform_util github-swri-robotics-marti_common
libmavconn github-mavlink-mavros
mavros github-mavlink-mavros
mavros_extras github-mavlink-mavros
microstrain_inertial_driver github-LORD-MicroStrain-microstrain_inertial
moveit_core github-ros-planning-moveit2
moveit_kinematics github-ros-planning-moveit2
moveit_planners_ompl github-ros-planning-moveit2
pilz_industrial_motion_planner github-ros-planning-moveit2
moveit_hybrid_planning github-ros-planning-moveit2
moveit_ros_move_group github-ros-planning-moveit2
moveit_servo github-ros-planning-moveit2
moveit_ros_planning github-ros-planning-moveit2
moveit_ros_planning_interface github-ros-planning-moveit2
moveit_ros_robot_interaction github-ros-planning-moveit2
moveit_ros_tests github-ros-planning-moveit2
moveit_setup_app_plugins github-ros-planning-moveit2
moveit_setup_assistant github-ros-planning-moveit2
moveit_setup_controllers github-ros-planning-moveit2
moveit_setup_srdf_plugins github-ros-planning-moveit2
mvsim github-MRPT-mvsim
naoqi_libqi github-ros-naoqi-libqi
octomap_ros github-OctoMap-octomap_ros
pal_statistics github-pal-robotics-pal_statistics
pcl_conversions github-ros-perception-perception_pcl
pcl_ros github-ros-perception-perception_pcl
plotjuggler_msgs github-facontidavide-plotjuggler_msgs
pluginlib github-ros-pluginlib
pose_cov_ops github-mrpt-ros-pkg-pose_cov_ops
psen_scan_v2 github-PilzDE-psen_scan_v2
quaternion_operation github-OUXT-Polaris-quaternion_operation
resource_retriever github-ros-resource_retriever
robot_controllers github-fetchrobotics-robot_controllers
robot_localization github-cra-ros-pkg-robot_localization
robot_state_publisher github-ros-robot_state_publisher
rosauth github-GT-RAIL-rosauth
rviz_common github-ros2-rviz
rviz_default_plugins github-ros2-rviz
rviz_rendering github-ros2-rviz
rviz_rendering_tests github-ros2-rviz
rviz_visual_testing_framework github-ros2-rviz
rviz_visual_tools github-PickNikRobotics-rviz_visual_tools
slam_toolbox github-SteveMacenski-slam_toolbox
srdfdom github-ros-planning-srdfdom
tuw_geometry github-tuw-robotics-tuw_geometry
ur_calibration github-UniversalRobots-Universal_Robots_ROS2_Driver
usb_cam github-ros-drivers-usb_cam
velodyne_driver github-ros-drivers-velodyne
velodyne_pointcloud github-ros-drivers-velodyne
vision_msgs github-Kukanani-vision_msgs
cv_bridge github-ros-perception-vision_opencv
image_geometry github-ros-perception-vision_opencv
warehouse_ros_mongo github-ros-planning-warehouse_ros_mongo
warehouse_ros_sqlite github-ros-planning-warehouse_ros_sqlite
ament_cmake_gmock github-ament-ament_cmake
ament_cmake_ros github-ros2-ament_cmake_ros
ament_index_cpp github-ament-ament_index
apex_test_tools gitlab-ApexAI-apex_test_tools
rclcpp_cascade_lifecycle github-fmrico-cascade_lifecycle
color_util github-MetroRobots-color_util
sensor_msgs github-ros2-common_interfaces
dataspeed_dbw_common bitbucket-dataspeedinc-dbw_ros
dataspeed_ulc_can bitbucket-dataspeedinc-dbw_ros
dbw_fca_can bitbucket-dataspeedinc-dbw_ros
dbw_ford_can bitbucket-dataspeedinc-dbw_ros
dbw_polaris_can bitbucket-dataspeedinc-dbw_ros
ds_dbw_can bitbucket-dataspeedinc-dbw_ros
dummy_map_server github-ros2-demos
dummy_robot_bringup github-ros2-demos
dummy_sensors github-ros2-demos
gazebo_ros2_control github-ros-simulation-gazebo_ros2_control
gazebo_ros2_control_demos github-ros-simulation-gazebo_ros2_control
ign_ros2_control_demos github-ignitionrobotics-ign_ros2_control
test_launch_testing github-ros2-launch
libstatistics_collector github-ros-tooling-libstatistics_collector
libyaml_vendor github-ros2-libyaml_vendor
maliput github-maliput-maliput
maliput_dragway github-maliput-maliput_dragway
maliput_integration github-maliput-maliput_integration
maliput_integration_tests github-maliput-maliput_integration_tests
maliput_malidrive github-maliput-maliput_malidrive
maliput_multilane github-maliput-maliput_multilane
maliput_object github-maliput-maliput_object
maliput_osm github-maliput-maliput_osm
maliput_ros github-maliput-maliput_ros
maliput_ros_translation github-maliput-maliput_ros
maliput_sparse github-maliput-maliput_sparse
maliput_viz github-maliput-maliput_viz
message_filters github-ros2-message_filters
micro_ros_diagnostic_bridge github-micro-ROS-micro_ros_diagnostics
micro_ros_diagnostic_updater github-micro-ROS-micro_ros_diagnostics
mppic github-FastSense-mppic
nav2_bringup github-ros-planning-navigation2
nav2_core github-ros-planning-navigation2
nav2_costmap_2d github-ros-planning-navigation2
costmap_queue github-ros-planning-navigation2
dwb_plugins github-ros-planning-navigation2
nav2_map_server github-ros-planning-navigation2
nav2_recoveries github-ros-planning-navigation2
nav2_regulated_pure_pursuit_controller github-ros-planning-navigation2
nav2_system_tests github-ros-planning-navigation2
nav2_util github-ros-planning-navigation2
nav2_voxel_grid github-ros-planning-navigation2
ouxt_lint_common github-OUXT-Polaris-ouxt_common
performance_test gitlab-ApexAI-performance_test
point_cloud_msg_wrapper gitlab-ApexAI-point_cloud_msg_wrapper
rcl github-ros2-rcl
rcl_action github-ros2-rcl
rcl_lifecycle github-ros2-rcl
rcl_yaml_param_parser github-ros2-rcl
test_msgs github-ros2-rcl_interfaces
rcl_logging_log4cxx github-ros2-rcl_logging
rcl_logging_noop github-ros2-rcl_logging
rclc github-ros2-rclc
rclc_lifecycle github-ros2-rclc
rclc_parameter github-ros2-rclc
rclcpp github-ros2-rclcpp
rclcpp_action github-ros2-rclcpp
rclcpp_components github-ros2-rclcpp
rclcpp_lifecycle github-ros2-rclcpp
rclpy github-ros2-rclpy
rcpputils github-ros2-rcpputils
rcutils github-ros2-rcutils
rttest github-ros2-realtime_support
tlsf_cpp github-ros2-realtime_support
rmw_fastrtps_cpp github-ros2-rmw_fastrtps
rmw_fastrtps_dynamic_cpp github-ros2-rmw_fastrtps
rmw_implementation github-ros2-rmw_implementation
test_rmw_implementation github-ros2-rmw_implementation
controller_manager github-ros-controls-ros2_control
joint_limits_interface github-ros-controls-ros2_control
joint_trajectory_controller github-ros-controls-ros2_controllers
realsense_ros github-intel-ros2_intel_realsense
plansys2_bt_actions github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_domain_expert github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_executor github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_lifecycle_manager github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_planner github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_popf_plan_solver github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_problem_expert github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_terminal github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_tests github-IntelligentRoboticsLabs-ros2_planning_system
ros2_socketcan github-autowarefoundation-ros2_socketcan
tracetools_test github-ros2-ros2_tracing
ros_ign_bridge github-ignitionrobotics-ros_ign
rosbag2_storage github-ros2-rosbag2
rosidl_generator_c github-ros2-rosidl
rosidl_generator_cpp github-ros2-rosidl
rosidl_runtime_cpp github-ros2-rosidl
rosidl_typesupport_interface github-ros2-rosidl
rosidl_typesupport_fastrtps_c github-ros2-rosidl_typesupport_fastrtps
rosidl_typesupport_fastrtps_cpp github-ros2-rosidl_typesupport_fastrtps
sick_scan2 github-SICKAG-sick_scan2
system_metrics_collector github-ros-tooling-system_metrics_collector
system_modes github-micro-ROS-system_modes
system_modes_examples github-micro-ROS-system_modes
test_communication github-ros2-system_tests
test_quality_of_service github-ros2-system_tests
test_rclcpp github-ros2-system_tests
test_security github-ros2-system_tests
asio_cmake_module github-ros-drivers-transport_drivers
io_context github-ros-drivers-transport_drivers
serial_driver github-ros-drivers-transport_drivers
udp_driver github-ros-drivers-transport_drivers
ros_core github-ros2-variants

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged ament_cmake_gtest at Robotics Stack Exchange

No version for distro lunar. Known supported distros are highlighted in the buttons above.
No version for distro jade. Known supported distros are highlighted in the buttons above.
No version for distro indigo. Known supported distros are highlighted in the buttons above.
No version for distro hydro. Known supported distros are highlighted in the buttons above.
No version for distro kinetic. Known supported distros are highlighted in the buttons above.
No version for distro melodic. Known supported distros are highlighted in the buttons above.