-
 

Package Summary

Tags No category tags.
Version 1.3.10
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-11-01
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.10 (2024-07-26)

1.3.9 (2024-05-15)

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

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Package Dependencies

System Dependencies

Name
gtest

Dependant Packages

Name Deps
behaviortree_cpp
test_bond
class_loader
control_toolbox
dataspeed_can_msg_filters
dataspeed_can_tools
dataspeed_can_usb
depthimage_to_laserscan
diagnostic_aggregator
diagnostic_updater
self_test
ecl_command_line
ecl_concepts
ecl_containers
ecl_converters
ecl_devices
ecl_filesystem
ecl_geometry
ecl_ipc
ecl_linear_algebra
ecl_manipulators
ecl_math
ecl_mobile_robot
ecl_mpl
ecl_sigslots
ecl_statistics
ecl_streams
ecl_threads
ecl_time
ecl_type_traits
ecl_utilities
ecl_config
ecl_converters_lite
filters
fmi_adapter
foxglove_bridge
gazebo_plugins
gazebo_ros
geographic_msgs
geometric_shapes
test_tf2
tf2
tf2_bullet
tf2_eigen
tf2_eigen_kdl
tf2_geometry_msgs
tf2_kdl
tf2_ros
tf2_sensor_msgs
grid_map_core
grid_map_costmap_2d
grid_map_cv
grid_map_demos
grid_map_filters
grid_map_loader
grid_map_octomap
grid_map_pcl
grid_map_ros
grid_map_sdf
grid_map_visualization
gscam
camera_calibration_parsers
camera_info_manager
image_transport
imu_filter_madgwick
interactive_markers
wiimote
laser_filters
laser_geometry
hri
swri_geometry_util
swri_image_util
swri_math_util
swri_roscpp
swri_system_util
swri_transform_util
libmavconn
mavros
mavros_extras
microstrain_inertial_driver
moveit_core
moveit_kinematics
moveit_planners_ompl
pilz_industrial_motion_planner
moveit_hybrid_planning
moveit_ros_move_group
moveit_servo
moveit_ros_planning
moveit_ros_planning_interface
moveit_ros_robot_interaction
moveit_ros_tests
moveit_setup_app_plugins
moveit_setup_assistant
moveit_setup_controllers
moveit_setup_srdf_plugins
mvsim
naoqi_libqi
novatel_gps_driver
octomap_ros
pal_statistics
pcl_conversions
pcl_ros
plotjuggler_msgs
pluginlib
pose_cov_ops
qb_device_ros2_control
quaternion_operation
realsense2_camera
resource_retriever
robot_calibration
robot_controllers
robot_localization
robot_state_publisher
ros_babel_fish
rviz_common
rviz_default_plugins
rviz_rendering
rviz_rendering_tests
rviz_visual_testing_framework
rviz_satellite
rviz_visual_tools
simple_grasping
slam_toolbox
srdfdom
tuw_geometry
ur_calibration
usb_cam
velodyne_driver
velodyne_pointcloud
vision_msgs
cv_bridge
image_geometry
warehouse_ros_mongo
warehouse_ros_sqlite
clearpath_socketcan_interface
ament_cmake_auto
ament_cmake_gen_version_h
ament_cmake_gmock
ament_cmake_ros
ament_index_cpp
apex_test_tools
rclcpp_cascade_lifecycle
color_util
sensor_msgs
ds_dbw_can
dummy_map_server
dummy_robot_bringup
dummy_sensors
dolly_tests
gazebo_ros2_control
gazebo_ros2_control_demos
test_launch_testing
libstatistics_collector
libyaml_vendor
message_filters
micro_ros_diagnostic_bridge
micro_ros_diagnostic_updater
nav2_behavior_tree
nav2_behaviors
nav2_bringup
nav2_collision_monitor
nav2_constrained_smoother
nav2_controller
nav2_core
nav2_costmap_2d
costmap_queue
dwb_core
dwb_critics
dwb_plugins
nav_2d_utils
nav2_graceful_controller
nav2_lifecycle_manager
nav2_map_server
nav2_mppi_controller
nav2_navfn_planner
nav2_regulated_pure_pursuit_controller
nav2_rotation_shim_controller
nav2_smac_planner
nav2_smoother
nav2_system_tests
nav2_theta_star_planner
nav2_util
nav2_velocity_smoother
nav2_voxel_grid
nav2_waypoint_follower
ouxt_lint_common
performance_test
point_cloud_msg_wrapper
rcl
rcl_action
rcl_lifecycle
rcl_yaml_param_parser
test_msgs
rcl_logging_noop
rclc
rclc_lifecycle
rclc_parameter
rclcpp
rclcpp_action
rclcpp_components
rclcpp_lifecycle
rclpy
rcpputils
rcutils
rttest
tlsf_cpp
rmw_fastrtps_cpp
rmw_fastrtps_dynamic_cpp
rmw_implementation
test_rmw_implementation
ros1_bridge
joint_limits
joint_limits_interface
plansys2_bt_actions
plansys2_core
plansys2_domain_expert
plansys2_executor
plansys2_lifecycle_manager
plansys2_pddl_parser
plansys2_planner
plansys2_popf_plan_solver
plansys2_problem_expert
plansys2_terminal
plansys2_tests
plansys2_tools
ros2_socketcan
test_tracetools
tracetools
rosbag2_storage
rosidl_generator_c
rosidl_generator_cpp
rosidl_runtime_cpp
rosidl_typesupport_interface
rosidl_typesupport_introspection_tests
rosidl_typesupport_fastrtps_c
rosidl_typesupport_fastrtps_cpp
system_modes
system_modes_examples
test_communication
test_quality_of_service
test_rclcpp
test_security
asio_cmake_module
io_context
serial_driver
udp_driver
ros_core
foros
nao_lola
rcss3d_agent
rqt_image_overlay
soccer_marker_generation
topic_tools
bcr_bot
beluga_amcl
beluga_ros
mola_common
qb_softhand_industry_ros2_control
tcb_span
data_tamer_cpp
event_camera_codecs
ffmpeg_encoder_decoder
flex_sync
parameter_traits
ign_ros2_control_demos
laser_segmentation
mola_bridge_ros2
mola_demos
mola_launcher
mola_metric_maps
mola_lidar_odometry
open3d_conversions
qml_ros2_plugin
ros_gz_bridge
test_ros_gz_bridge
lidar_situational_graphs
as2_platform_gazebo
as2_platform_multirotor_simulator
as2_behavior_tree
as2_behavior
as2_behaviors_path_planning
as2_behaviors_platform
as2_behaviors_trajectory_generation
as2_core
as2_realsense_interface
as2_usb_camera_interface
as2_map_server
as2_motion_reference_handlers
as2_state_estimator
as2_alphanumeric_viewer
as2_external_object_to_tf
as2_geozones
affordance_primitives
as2_platform_dji_osdk
as2_platform_dji_psdk
as2_platform_mavlink
as2_platform_pixhawk
as2_platform_tello
metro_benchmark_pub
mocap4r2_control
mocap4r2_dummy_driver
off_highway_can
opennav_docking
opennav_docking_core
play_motion2
tiago_gazebo
vector_pursuit_controller

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.7
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-11-08
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.7 (2024-11-09)

2.0.6 (2024-07-11)

2.0.5 (2024-04-19)

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

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Package Dependencies

System Dependencies

Name
gtest

Dependant Packages

Name Deps
angles
behaviortree_cpp
test_bond
class_loader
control_toolbox
depthimage_to_laserscan
diagnostic_aggregator
diagnostic_updater
self_test
ecl_command_line
ecl_concepts
ecl_containers
ecl_converters
ecl_devices
ecl_filesystem
ecl_geometry
ecl_ipc
ecl_linear_algebra
ecl_manipulators
ecl_math
ecl_mobile_robot
ecl_mpl
ecl_sigslots
ecl_statistics
ecl_streams
ecl_threads
ecl_time
ecl_type_traits
ecl_utilities
ecl_config
ecl_converters_lite
filters
fmi_adapter
foxglove_bridge
fuse_constraints
fuse_core
fuse_graphs
fuse_loss
fuse_models
fuse_optimizers
fuse_publishers
fuse_variables
gazebo_plugins
gazebo_ros
geographic_msgs
geometric_shapes
test_tf2
tf2
tf2_bullet
tf2_eigen
tf2_eigen_kdl
tf2_geometry_msgs
tf2_kdl
tf2_ros
tf2_sensor_msgs
grid_map_core
grid_map_costmap_2d
grid_map_cv
grid_map_demos
grid_map_filters
grid_map_loader
grid_map_octomap
grid_map_pcl
grid_map_ros
grid_map_sdf
grid_map_visualization
gscam
camera_calibration_parsers
camera_info_manager
image_transport
imu_filter_madgwick
interactive_markers
wiimote
kdl_parser
laser_filters
laser_geometry
swri_geometry_util
swri_image_util
swri_math_util
swri_roscpp
swri_system_util
swri_transform_util
libmavconn
mavros
mavros_extras
microstrain_inertial_driver
moveit_core
moveit_kinematics
moveit_planners_ompl
pilz_industrial_motion_planner
moveit_hybrid_planning
moveit_ros_move_group
moveit_servo
moveit_ros_planning
moveit_ros_planning_interface
moveit_ros_robot_interaction
moveit_ros_tests
moveit_setup_app_plugins
moveit_setup_assistant
moveit_setup_controllers
moveit_setup_srdf_plugins
mvsim
naoqi_libqi
novatel_gps_driver
octomap_ros
pcl_conversions
pcl_ros
plotjuggler_msgs
pluginlib
pose_cov_ops
quaternion_operation
realsense2_camera
resource_retriever
robot_calibration
robot_localization
robot_state_publisher
rviz_common
rviz_default_plugins
rviz_rendering
rviz_rendering_tests
rviz_visual_testing_framework
rviz_satellite
rviz_visual_tools
simple_grasping
slam_toolbox
srdfdom
tf2_2d
tuw_geometry
ur_calibration
usb_cam
velodyne_driver
velodyne_pointcloud
vision_msgs
cv_bridge
image_geometry
warehouse_ros_mongo
warehouse_ros_sqlite
ament_cmake_auto
ament_cmake_gen_version_h
ament_cmake_gmock
ament_cmake_ros
ament_index_cpp
apex_test_tools
rclcpp_cascade_lifecycle
color_util
sensor_msgs
dummy_map_server
dummy_robot_bringup
dummy_sensors
dolly_tests
gazebo_ros2_control
gazebo_ros2_control_demos
test_launch_testing
libstatistics_collector
libyaml_vendor
message_filters
micro_ros_diagnostic_bridge
micro_ros_diagnostic_updater
nav2_behavior_tree
nav2_behaviors
nav2_bringup
nav2_collision_monitor
nav2_constrained_smoother
nav2_controller
nav2_core
nav2_costmap_2d
costmap_queue
dwb_core
dwb_critics
dwb_plugins
nav_2d_utils
nav2_lifecycle_manager
nav2_map_server
nav2_mppi_controller
nav2_navfn_planner
nav2_regulated_pure_pursuit_controller
nav2_rotation_shim_controller
nav2_smac_planner
nav2_smoother
nav2_system_tests
nav2_theta_star_planner
nav2_util
nav2_velocity_smoother
nav2_voxel_grid
nav2_waypoint_follower
ouxt_lint_common
performance_test
point_cloud_msg_wrapper
rcl
rcl_action
rcl_lifecycle
rcl_yaml_param_parser
test_msgs
rcl_logging_noop
rclc
rclc_lifecycle
rclc_parameter
rclcpp
rclcpp_action
rclcpp_components
rclcpp_lifecycle
rclpy
rcpputils
rcutils
rttest
tlsf_cpp
rmw_fastrtps_cpp
rmw_fastrtps_dynamic_cpp
rmw_implementation
test_rmw_implementation
ros1_bridge
joint_limits
joint_limits_interface
plansys2_bt_actions
plansys2_core
plansys2_domain_expert
plansys2_executor
plansys2_lifecycle_manager
plansys2_pddl_parser
plansys2_planner
plansys2_popf_plan_solver
plansys2_problem_expert
plansys2_terminal
plansys2_tests
plansys2_tools
ros2_socketcan
test_tracetools
tracetools
rosbag2_performance_benchmarking_msgs
rosbag2_storage
rosidl_generator_tests
rosidl_runtime_cpp
rosidl_typesupport_interface
rosidl_typesupport_introspection_tests
rosidl_typesupport_tests
rosidl_typesupport_fastrtps_c
rosidl_typesupport_fastrtps_cpp
system_modes
system_modes_examples
test_communication
test_quality_of_service
test_rclcpp
test_security
asio_cmake_module
io_context
serial_driver
udp_driver
ros_core
nao_lola
rcss3d_agent
ros_image_to_qimage
rqt_image_overlay
soccer_marker_generation
topic_tools
beluga_amcl
beluga_ros
mola_common
tcb_span
event_camera_codecs
ffmpeg_encoder_decoder
flex_sync
parameter_traits
gz_ros2_control_demos
gz_ros2_control_tests
mola_bridge_ros2
mola_demos
mola_launcher
mola_metric_maps
mola_lidar_odometry
open3d_conversions
rcl_logging_rcutils
rcss3d_nao
ros_gz_bridge
test_ros_gz_bridge
lidar_situational_graphs

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.5.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 jazzy
Last Updated 2024-11-01
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.5.2 (2024-07-02)

2.5.1 (2024-06-27)

2.5.0 (2024-04-16)

2.4.0 (2024-03-28)

  • Update maintainer list in package.xml files (#503)
  • Contributors: Michael Jeronimo

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

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Package Dependencies

System Dependencies

Name
gtest

Dependant Packages

Name Deps
angles
behaviortree_cpp
test_bond
class_loader
control_toolbox
dataspeed_can_msg_filters
dataspeed_can_tools
dataspeed_can_usb
depthimage_to_laserscan
diagnostic_aggregator
diagnostic_updater
self_test
ecl_command_line
ecl_concepts
ecl_containers
ecl_converters
ecl_devices
ecl_filesystem
ecl_geometry
ecl_ipc
ecl_linear_algebra
ecl_manipulators
ecl_math
ecl_mobile_robot
ecl_mpl
ecl_sigslots
ecl_statistics
ecl_streams
ecl_threads
ecl_time
ecl_type_traits
ecl_utilities
ecl_config
ecl_converters_lite
filters
fmi_adapter
foxglove_bridge
fuse_constraints
fuse_core
fuse_graphs
fuse_loss
fuse_models
fuse_optimizers
fuse_publishers
fuse_variables
gazebo_plugins
gazebo_ros
geographic_msgs
geometric_shapes
test_tf2
tf2
tf2_bullet
tf2_eigen
tf2_eigen_kdl
tf2_geometry_msgs
tf2_kdl
tf2_ros
tf2_sensor_msgs
grid_map_core
grid_map_costmap_2d
grid_map_cv
grid_map_demos
grid_map_filters
grid_map_loader
grid_map_octomap
grid_map_pcl
grid_map_ros
grid_map_sdf
grid_map_visualization
gscam
camera_calibration_parsers
camera_info_manager
image_transport
compressed_depth_image_transport
imu_filter_madgwick
interactive_markers
wiimote
kdl_parser
laser_filters
laser_geometry
swri_geometry_util
swri_image_util
swri_math_util
swri_roscpp
swri_system_util
swri_transform_util
libmavconn
mavros
mavros_extras
microstrain_inertial_driver
moveit_core
moveit_kinematics
moveit_planners_ompl
pilz_industrial_motion_planner
moveit_hybrid_planning
moveit_ros_move_group
moveit_servo
moveit_ros_planning
moveit_ros_planning_interface
moveit_ros_robot_interaction
moveit_ros_tests
moveit_setup_app_plugins
moveit_setup_assistant
moveit_setup_controllers
moveit_setup_srdf_plugins
mvsim
novatel_gps_driver
octomap_ros
pal_statistics
pcl_conversions
pcl_ros
plotjuggler_msgs
pluginlib
pose_cov_ops
quaternion_operation
realsense2_camera
resource_retriever
robot_calibration
robot_localization
robot_state_publisher
ros_babel_fish
rviz_common
rviz_default_plugins
rviz_rendering
rviz_rendering_tests
rviz_visual_testing_framework
rviz_satellite
rviz_visual_tools
simple_grasping
slam_toolbox
srdfdom
tf2_2d
tuw_geometry
ur_calibration
usb_cam
velodyne_driver
velodyne_pointcloud
vision_msgs
cv_bridge
image_geometry
warehouse_ros_sqlite
ament_cmake_auto
ament_cmake_gen_version_h
ament_cmake_gmock
ament_cmake_ros
ament_index_cpp
apex_test_tools
rclcpp_cascade_lifecycle
color_util
sensor_msgs
ds_dbw_can
dummy_map_server
dummy_robot_bringup
dummy_sensors
dolly_tests
fastcdr
test_launch_testing
libstatistics_collector
libyaml_vendor
message_filters
micro_ros_diagnostic_bridge
micro_ros_diagnostic_updater
nav2_behavior_tree
nav2_behaviors
nav2_bringup
nav2_collision_monitor
nav2_constrained_smoother
nav2_controller
nav2_core
nav2_costmap_2d
opennav_docking
opennav_docking_core
costmap_queue
dwb_core
dwb_critics
dwb_plugins
nav_2d_utils
nav2_graceful_controller
nav2_lifecycle_manager
nav2_map_server
nav2_mppi_controller
nav2_navfn_planner
nav2_regulated_pure_pursuit_controller
nav2_rotation_shim_controller
nav2_smac_planner
nav2_smoother
nav2_system_tests
nav2_theta_star_planner
nav2_util
nav2_velocity_smoother
nav2_voxel_grid
nav2_waypoint_follower
ouxt_lint_common
performance_test
point_cloud_msg_wrapper
rcl
rcl_action
rcl_lifecycle
rcl_yaml_param_parser
test_msgs
rcl_logging_noop
rclc
rclc_lifecycle
rclc_parameter
rclcpp
rclcpp_action
rclcpp_components
rclcpp_lifecycle
rclpy
rcpputils
rcutils
rttest
tlsf_cpp
rmw_fastrtps_cpp
rmw_fastrtps_dynamic_cpp
rmw_implementation
test_rmw_implementation
ros1_bridge
joint_limits
plansys2_bt_actions
plansys2_core
plansys2_domain_expert
plansys2_executor
plansys2_lifecycle_manager
plansys2_pddl_parser
plansys2_planner
plansys2_popf_plan_solver
plansys2_problem_expert
plansys2_terminal
plansys2_tests
plansys2_tools
ros2_socketcan
lttngpy
test_tracetools
tracetools
rosbag2_performance_benchmarking_msgs
rosbag2_storage
rosidl_generator_tests
rosidl_runtime_cpp
rosidl_typesupport_interface
rosidl_typesupport_introspection_tests
rosidl_typesupport_tests
rosidl_typesupport_fastrtps_c
rosidl_typesupport_fastrtps_cpp
system_modes
system_modes_examples
test_communication
test_quality_of_service
test_rclcpp
test_security
asio_cmake_module
io_context
serial_driver
udp_driver
ros_core
nao_lola
nao_lola_client
rcss3d_agent
ros_image_to_qimage
rqt_image_overlay
sdformat_urdf
topic_tools
beluga_amcl
beluga_ros
mola_common
tcb_span
data_tamer_cpp
event_camera_codecs
ffmpeg_encoder_decoder
flex_sync
parameter_traits
gz_ros2_control_demos
gz_ros2_control_tests
mola_bridge_ros2
mola_demos
mola_launcher
mola_metric_maps
mola_lidar_odometry
open3d_conversions
qml_ros2_plugin
rcl_logging_rcutils
rcss3d_nao
ros_gz_bridge
test_ros_gz_bridge

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.7.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 rolling
Last Updated 2024-11-14
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.7.1 (2024-10-03)

  • set search path args and then append (#543)
  • Contributors: Will

2.7.0 (2024-06-25)

2.6.1 (2024-06-17)

2.6.0 (2024-04-26)

2.5.0 (2024-04-16)

2.4.0 (2024-03-28)

  • Update maintainer list in package.xml files (#503)
  • Contributors: Michael Jeronimo

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

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Package Dependencies

System Dependencies

Name
gtest

Dependant Packages

Name Deps
angles
behaviortree_cpp
test_bond
class_loader
control_toolbox
depthimage_to_laserscan
diagnostic_aggregator
diagnostic_updater
self_test
ecl_command_line
ecl_concepts
ecl_containers
ecl_converters
ecl_devices
ecl_filesystem
ecl_geometry
ecl_ipc
ecl_linear_algebra
ecl_manipulators
ecl_math
ecl_mobile_robot
ecl_mpl
ecl_sigslots
ecl_statistics
ecl_streams
ecl_threads
ecl_time
ecl_type_traits
ecl_utilities
ecl_config
ecl_converters_lite
filters
fmi_adapter
foxglove_bridge
fuse_constraints
fuse_core
fuse_graphs
fuse_loss
fuse_models
fuse_optimizers
fuse_publishers
fuse_variables
geographic_msgs
geometric_shapes
test_tf2
tf2
tf2_bullet
tf2_eigen
tf2_eigen_kdl
tf2_geometry_msgs
tf2_kdl
tf2_ros
tf2_sensor_msgs
gscam
camera_calibration_parsers
camera_info_manager
image_transport
compressed_depth_image_transport
imu_filter_madgwick
interactive_markers
wiimote
kdl_parser
laser_filters
laser_geometry
swri_geometry_util
swri_image_util
swri_math_util
swri_roscpp
swri_system_util
swri_transform_util
libmavconn
mavros
mavros_extras
microstrain_inertial_driver
moveit_core
moveit_kinematics
moveit_planners_ompl
pilz_industrial_motion_planner
moveit_hybrid_planning
moveit_ros_move_group
moveit_servo
moveit_ros_planning
moveit_ros_planning_interface
moveit_ros_robot_interaction
moveit_ros_tests
moveit_setup_app_plugins
moveit_setup_assistant
moveit_setup_controllers
moveit_setup_srdf_plugins
mvsim
novatel_gps_driver
octomap_ros
pal_statistics
pcl_conversions
pcl_ros
plotjuggler_msgs
pluginlib
pose_cov_ops
quaternion_operation
resource_retriever
robot_calibration
robot_localization
robot_state_publisher
ros_babel_fish
rviz_common
rviz_default_plugins
rviz_rendering
rviz_rendering_tests
rviz_visual_testing_framework
rviz_visual_tools
simple_grasping
srdfdom
tf2_2d
tuw_geometry
ur_calibration
usb_cam
velodyne_driver
velodyne_pointcloud
vision_msgs
cv_bridge
image_geometry
warehouse_ros_sqlite
ament_cmake_auto
ament_cmake_gen_version_h
ament_cmake_gmock
ament_cmake_ros
ament_index_cpp
apex_test_tools
rclcpp_cascade_lifecycle
color_util
sensor_msgs
dummy_map_server
dummy_robot_bringup
dummy_sensors
dolly_tests
fastcdr
test_launch_testing
libstatistics_collector
libyaml_vendor
message_filters
micro_ros_diagnostic_bridge
micro_ros_diagnostic_updater
ouxt_lint_common
performance_test
point_cloud_msg_wrapper
rcl
rcl_action
rcl_lifecycle
rcl_yaml_param_parser
test_msgs
rcl_logging_noop
rclc
rclc_lifecycle
rclc_parameter
rclcpp
rclcpp_action
rclcpp_components
rclcpp_lifecycle
rclpy
rcpputils
rcutils
rttest
tlsf_cpp
rmw_fastrtps_cpp
rmw_fastrtps_dynamic_cpp
rmw_implementation
test_rmw_implementation
ros1_bridge
joint_limits
ros2_socketcan
lttngpy
test_tracetools
tracetools
rosbag2_performance_benchmarking_msgs
rosbag2_storage
rosidl_generator_tests
rosidl_runtime_cpp
rosidl_typesupport_interface
rosidl_typesupport_introspection_tests
rosidl_typesupport_tests
rosidl_typesupport_fastrtps_c
rosidl_typesupport_fastrtps_cpp
system_modes
system_modes_examples
test_communication
test_quality_of_service
test_rclcpp
test_security
asio_cmake_module
io_context
serial_driver
udp_driver
ros_core
nao_lola
nao_lola_client
rcss3d_agent
ros_image_to_qimage
rqt_image_overlay
sdformat_urdf
topic_tools
mola_common
tcb_span
data_tamer_cpp
event_camera_codecs
ffmpeg_encoder_decoder
flex_sync
parameter_traits
gz_ros2_control_demos
gz_ros2_control_tests
laser_segmentation
mola_bridge_ros2
mola_demos
mola_launcher
mola_metric_maps
mola_lidar_odometry
open3d_conversions
qml_ros2_plugin
rcl_logging_rcutils
rcss3d_nao
ros_gz_bridge
test_ros_gz_bridge

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

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

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

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

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

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Package Dependencies

System Dependencies

Name
gtest

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

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Package Dependencies

System Dependencies

Name
gtest

Dependant Packages

Name Deps
angles
class_loader
costmap_converter
depthimage_to_laserscan
diagnostic_updater
self_test
ecl_command_line
ecl_concepts
ecl_containers
ecl_converters
ecl_devices
ecl_filesystem
ecl_geometry
ecl_ipc
ecl_linear_algebra
ecl_manipulators
ecl_math
ecl_mobile_robot
ecl_mpl
ecl_sigslots
ecl_statistics
ecl_streams
ecl_threads
ecl_time
ecl_type_traits
ecl_utilities
ecl_config
ecl_converters_lite
filters
gazebo_plugins
gazebo_ros
geographic_msgs
tf2
tf2_eigen
tf2_geometry_msgs
tf2_kdl
tf2_ros
tf2_sensor_msgs
camera_calibration_parsers
camera_info_manager
image_transport
interactive_markers
laser_geometry
pcl_conversions
plotjuggler_msgs
pluginlib
rviz_common
rviz_default_plugins
rviz_rendering
rviz_rendering_tests
rviz_visual_testing_framework
slam_toolbox
velodyne_driver
velodyne_pointcloud
vision_msgs
cv_bridge
image_geometry
ament_cmake_gmock
ament_cmake_ros
ament_index_cpp
apex_test_tools
sensor_msgs
dummy_map_server
dummy_robot_bringup
dummy_sensors
test_launch_testing
message_filters
nav2_bringup
nav2_core
nav2_costmap_2d
costmap_queue
dwb_plugins
nav2_map_server
nav2_recoveries
nav2_system_tests
nav2_util
nav2_voxel_grid
rcl
rcl_action
rcl_lifecycle
rcl_yaml_param_parser
test_msgs
rcl_logging_log4cxx
rcl_logging_noop
rclc
rclc_lifecycle
rclc_parameter
rclcpp
rclcpp_action
rclcpp_components
rclcpp_lifecycle
rcpputils
rcutils
rttest
tlsf_cpp
plansys2_domain_expert
plansys2_executor
plansys2_lifecycle_manager
plansys2_planner
plansys2_problem_expert
plansys2_terminal
tracetools
rosbag2_storage
rosidl_generator_c
rosidl_generator_cpp
sick_scan2
system_modes
system_modes_examples
ros_core

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

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Package Dependencies

System Dependencies

Name
gtest

Dependant Packages

Name Deps
angles
aws_common
test_bond
class_loader
cloudwatch_logs_common
cloudwatch_metrics_common
dataflow_lite
file_management
costmap_converter
depthimage_to_laserscan
diagnostic_updater
self_test
ecl_command_line
ecl_concepts
ecl_containers
ecl_converters
ecl_devices
ecl_filesystem
ecl_geometry
ecl_ipc
ecl_linear_algebra
ecl_manipulators
ecl_math
ecl_mobile_robot
ecl_mpl
ecl_sigslots
ecl_statistics
ecl_streams
ecl_threads
ecl_time
ecl_type_traits
ecl_utilities
ecl_config
ecl_converters_lite
fmi_adapter
gazebo_plugins
gazebo_ros
geographic_msgs
tf2
tf2_eigen
tf2_geometry_msgs
tf2_kdl
tf2_ros
tf2_sensor_msgs
h264_encoder_core
h264_video_encoder
camera_calibration_parsers
camera_info_manager
image_transport
kinesis_manager
kinesis_video_streamer
laser_geometry
lex_common
pcl_conversions
pluginlib
robot_localization
rosauth
rviz_common
rviz_default_plugins
rviz_rendering
rviz_rendering_tests
rviz_visual_testing_framework
slam_toolbox
velodyne_driver
velodyne_pointcloud
vision_msgs
ament_cmake_gmock
ament_index_cpp
apex_test_tools
sensor_msgs
dummy_map_server
dummy_robot_bringup
dummy_sensors
test_launch_testing
message_filters
nav2_amcl
nav2_behavior_tree
nav2_bringup
nav2_bt_navigator
nav2_costmap_2d
costmap_queue
dwb_controller
dwb_core
dwb_critics
dwb_msgs
dwb_plugins
nav2_dwb_controller
nav_2d_msgs
nav_2d_utils
nav2_dynamic_params
nav2_map_server
nav2_msgs
nav2_navfn_planner
nav2_recoveries
nav2_system_tests
nav2_util
nav2_voxel_grid
nav2_world_model
navigation2
rcl
rcl_action
rcl_lifecycle
rcl_yaml_param_parser
test_msgs
rcl_logging_log4cxx
rcl_logging_noop
rclc
rclc_lifecycle
rclcpp
rclcpp_action
rclcpp_components
rclcpp_lifecycle
rcpputils
rcutils
rttest
tlsf_cpp
controller_interface
controller_manager
controller_parameter_server
hardware_interface
test_robot_hardware
ros_controllers
realsense_ros2_camera
tracetools
rosbag2_storage
rosidl_generator_c
rosidl_generator_cpp
sick_scan2
system_modes
system_modes_examples
serial_driver
udp_driver
ros_core
aws_ros2_common
object_analytics_node

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

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Package Dependencies

System Dependencies

Name
gtest

Dependant Packages

Name Deps
behaviortree_cpp
test_bond
class_loader
control_toolbox
depthimage_to_laserscan
diagnostic_aggregator
diagnostic_updater
self_test
ecl_command_line
ecl_concepts
ecl_containers
ecl_converters
ecl_devices
ecl_filesystem
ecl_geometry
ecl_ipc
ecl_linear_algebra
ecl_manipulators
ecl_math
ecl_mobile_robot
ecl_mpl
ecl_sigslots
ecl_statistics
ecl_streams
ecl_threads
ecl_time
ecl_type_traits
ecl_utilities
ecl_config
ecl_converters_lite
filters
foxglove_bridge
gazebo_plugins
gazebo_ros
geographic_msgs
geometric_shapes
test_tf2
tf2
tf2_bullet
tf2_eigen
tf2_eigen_kdl
tf2_geometry_msgs
tf2_kdl
tf2_ros
tf2_sensor_msgs
gscam
camera_calibration_parsers
camera_info_manager
image_transport
imu_filter_madgwick
interactive_markers
wiimote
laser_filters
laser_geometry
libmavconn
mavros
mavros_extras
microstrain_inertial_driver
moveit_core
moveit_kinematics
moveit_planners_ompl
pilz_industrial_motion_planner
moveit_hybrid_planning
moveit_ros_move_group
moveit_servo
moveit_ros_planning
moveit_ros_planning_interface
moveit_ros_robot_interaction
moveit_ros_tests
moveit_setup_app_plugins
moveit_setup_assistant
moveit_setup_controllers
moveit_setup_srdf_plugins
naoqi_libqi
octomap_ros
pal_statistics
pcl_conversions
pcl_ros
plotjuggler_msgs
pluginlib
pose_cov_ops
quaternion_operation
resource_retriever
robot_localization
robot_state_publisher
rviz_common
rviz_default_plugins
rviz_rendering
rviz_rendering_tests
rviz_visual_testing_framework
rviz_visual_tools
slam_toolbox
srdfdom
ur_calibration
usb_cam
velodyne_driver
velodyne_pointcloud
vision_msgs
cv_bridge
image_geometry
warehouse_ros_mongo
warehouse_ros_sqlite
ament_cmake_gmock
ament_cmake_ros
ament_index_cpp
apex_test_tools
rclcpp_cascade_lifecycle
sensor_msgs
dummy_map_server
dummy_robot_bringup
dummy_sensors
dolly_tests
gazebo_ros2_control
gazebo_ros2_control_demos
ign_ros2_control_demos
test_launch_testing
libstatistics_collector
libyaml_vendor
message_filters
micro_ros_diagnostic_bridge
micro_ros_diagnostic_updater
nav2_behavior_tree
nav2_bringup
nav2_controller
nav2_core
nav2_costmap_2d
costmap_queue
dwb_core
dwb_critics
dwb_plugins
nav_2d_utils
nav2_lifecycle_manager
nav2_map_server
nav2_recoveries
nav2_regulated_pure_pursuit_controller
nav2_rotation_shim_controller
nav2_smac_planner
nav2_system_tests
nav2_theta_star_planner
nav2_util
nav2_voxel_grid
nav2_waypoint_follower
ouxt_lint_common
performance_test
point_cloud_msg_wrapper
rcl
rcl_action
rcl_lifecycle
rcl_yaml_param_parser
test_msgs
rcl_logging_log4cxx
rcl_logging_noop
rclc
rclc_lifecycle
rclc_parameter
rclcpp
rclcpp_action
rclcpp_components
rclcpp_lifecycle
rclpy
rcpputils
rcutils
rttest
tlsf_cpp
rmw_fastrtps_cpp
rmw_fastrtps_dynamic_cpp
rmw_implementation
test_rmw_implementation
controller_manager
joint_limits_interface
joint_trajectory_controller
plansys2_bt_actions
plansys2_core
plansys2_domain_expert
plansys2_executor
plansys2_lifecycle_manager
plansys2_pddl_parser
plansys2_planner
plansys2_popf_plan_solver
plansys2_problem_expert
plansys2_terminal
plansys2_tests
plansys2_tools
ros2_socketcan
tracetools
tracetools_test
vda5050_connector
ros_ign_bridge
rosbag2_storage
rosidl_generator_c
rosidl_generator_cpp
rosidl_runtime_cpp
rosidl_typesupport_interface
rosidl_typesupport_fastrtps_c
rosidl_typesupport_fastrtps_cpp
system_modes
system_modes_examples
test_communication
test_quality_of_service
test_rclcpp
test_security
asio_cmake_module
io_context
serial_driver
udp_driver
ros_core
foros
nao_lola
rcss3d_agent
rqt_image_overlay
sdformat_urdf
soccer_marker_generation
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

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Package Dependencies

System Dependencies

Name
gtest

Dependant Packages

Name Deps
behaviortree_cpp_v3
test_bond
class_loader
control_toolbox
dataspeed_can_msg_filters
dataspeed_can_tools
dataspeed_can_usb
depthimage_to_laserscan
diagnostic_aggregator
diagnostic_updater
self_test
ecl_command_line
ecl_concepts
ecl_containers
ecl_converters
ecl_devices
ecl_filesystem
ecl_geometry
ecl_ipc
ecl_linear_algebra
ecl_manipulators
ecl_math
ecl_mobile_robot
ecl_mpl
ecl_sigslots
ecl_statistics
ecl_streams
ecl_threads
ecl_time
ecl_type_traits
ecl_utilities
ecl_config
ecl_converters_lite
filters
fmi_adapter
gazebo_plugins
gazebo_ros
geographic_msgs
geometric_shapes
test_tf2
tf2
tf2_bullet
tf2_eigen
tf2_eigen_kdl
tf2_geometry_msgs
tf2_kdl
tf2_ros
tf2_sensor_msgs
gscam
camera_calibration_parsers
camera_info_manager
image_transport
imu_filter_madgwick
interactive_markers
wiimote
laser_filters
laser_geometry
swri_geometry_util
swri_image_util
swri_math_util
swri_roscpp
swri_system_util
swri_transform_util
libmavconn
mavros
mavros_extras
microstrain_inertial_driver
moveit_core
moveit_kinematics
moveit_planners_ompl
pilz_industrial_motion_planner
moveit_hybrid_planning
moveit_ros_move_group
moveit_servo
moveit_ros_planning
moveit_ros_planning_interface
moveit_ros_robot_interaction
moveit_ros_tests
moveit_setup_app_plugins
moveit_setup_assistant
moveit_setup_controllers
moveit_setup_srdf_plugins
mvsim
naoqi_libqi
octomap_ros
pal_statistics
pcl_conversions
pcl_ros
plotjuggler_msgs
pluginlib
pose_cov_ops
psen_scan_v2
quaternion_operation
resource_retriever
robot_controllers
robot_localization
robot_state_publisher
rosauth
rviz_common
rviz_default_plugins
rviz_rendering
rviz_rendering_tests
rviz_visual_testing_framework
rviz_visual_tools
slam_toolbox
srdfdom
tuw_geometry
ur_calibration
usb_cam
velodyne_driver
velodyne_pointcloud
vision_msgs
cv_bridge
image_geometry
warehouse_ros_mongo
warehouse_ros_sqlite
ament_cmake_gmock
ament_cmake_ros
ament_index_cpp
apex_test_tools
rclcpp_cascade_lifecycle
color_util
sensor_msgs
ds_dbw_can
dummy_map_server
dummy_robot_bringup
dummy_sensors
gazebo_ros2_control
gazebo_ros2_control_demos
ign_ros2_control_demos
test_launch_testing
libstatistics_collector
libyaml_vendor
maliput
maliput_dragway
maliput_integration
maliput_integration_tests
maliput_malidrive
maliput_multilane
maliput_object
maliput_osm
maliput_ros
maliput_ros_translation
maliput_sparse
maliput_viz
message_filters
micro_ros_diagnostic_bridge
micro_ros_diagnostic_updater
mppic
nav2_bringup
nav2_core
nav2_costmap_2d
costmap_queue
dwb_plugins
nav2_map_server
nav2_recoveries
nav2_regulated_pure_pursuit_controller
nav2_system_tests
nav2_util
nav2_voxel_grid
ouxt_lint_common
performance_test
point_cloud_msg_wrapper
rcl
rcl_action
rcl_lifecycle
rcl_yaml_param_parser
test_msgs
rcl_logging_log4cxx
rcl_logging_noop
rclc
rclc_lifecycle
rclc_parameter
rclcpp
rclcpp_action
rclcpp_components
rclcpp_lifecycle
rclpy
rcpputils
rcutils
rttest
tlsf_cpp
rmw_fastrtps_cpp
rmw_fastrtps_dynamic_cpp
rmw_implementation
test_rmw_implementation
controller_manager
joint_limits_interface
joint_trajectory_controller
realsense_ros
plansys2_bt_actions
plansys2_domain_expert
plansys2_executor
plansys2_lifecycle_manager
plansys2_planner
plansys2_popf_plan_solver
plansys2_problem_expert
plansys2_terminal
plansys2_tests
ros2_socketcan
tracetools_test
ros_ign_bridge
rosbag2_storage
rosidl_generator_c
rosidl_generator_cpp
rosidl_runtime_cpp
rosidl_typesupport_interface
rosidl_typesupport_fastrtps_c
rosidl_typesupport_fastrtps_cpp
sick_scan2
system_metrics_collector
system_modes
system_modes_examples
test_communication
test_quality_of_service
test_rclcpp
test_security
asio_cmake_module
io_context
serial_driver
udp_driver
ros_core

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.